Skip to content

Commit

Permalink
ci(pre-commit): autofix
Browse files Browse the repository at this point in the history
  • Loading branch information
pre-commit-ci[bot] committed Jul 13, 2022
1 parent 29037e9 commit e8e8ad6
Showing 1 changed file with 3 additions and 2 deletions.
Original file line number Diff line number Diff line change
Expand Up @@ -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
Expand Down Expand Up @@ -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(
Expand Down

0 comments on commit e8e8ad6

Please sign in to comment.