diff --git a/planning/motion_velocity_smoother/scripts/closest_velocity_checker.py b/planning/motion_velocity_smoother/scripts/closest_velocity_checker.py index 9e31fa43afe63..76dff5932ca6d 100755 --- a/planning/motion_velocity_smoother/scripts/closest_velocity_checker.py +++ b/planning/motion_velocity_smoother/scripts/closest_velocity_checker.py @@ -27,7 +27,8 @@ import numpy as np import rclpy from rclpy.node import Node -from rclpy.qos import QoSProfile, QoSDurabilityPolicy +from rclpy.qos import QoSDurabilityPolicy +from rclpy.qos import QoSProfile from tf2_ros import LookupException from tf2_ros.buffer import Buffer from tf2_ros.transform_listener import TransformListener @@ -71,7 +72,7 @@ def __init__(self): # planning path and trajectories profile = rclpy.qos.QoSProfile(depth=1) transien_local = QoSDurabilityPolicy.RMW_QOS_POLICY_DURABILITY_TRANSIENT_LOCAL - transient_local_profile = rclpy.qos.QoSProfile(depth=1,durability=transien_local) + transient_local_profile = rclpy.qos.QoSProfile(depth=1, durability=transien_local) lane_drv = "/planning/scenario_planning/lane_driving" scenario = "/planning/scenario_planning" self.sub0 = self.create_subscription(