Skip to content

WIP adding launch file (still need to make node and port over changes)

Sign in for the full log view
GitHub Actions / Autopep8 failed May 31, 2024 in 0s

4 errors

Autopep8 found 4 errors

Annotations

Check failure on line 28 in src/perception/radar_object_detection/radar_object_detection_launch/launch/nuscenes_launch.py

See this annotation in the file changed.

@github-actions github-actions / Autopep8

src/perception/radar_object_detection/radar_object_detection_launch/launch/nuscenes_launch.py#L24-L28

     # finalize
     ld.add_action(radar_detection)
 
-    return ld
\ No newline at end of file
+    return ld

Check failure on line 9 in src/perception/radar_object_detection/radar_vis/src/radar_det.py

See this annotation in the file changed.

@github-actions github-actions / Autopep8

src/perception/radar_object_detection/radar_vis/src/radar_det.py#L3-L9

 from std_msgs.msg import Float32
 from radar_velocity_detection.msg import RadarDetections
 import numpy as np
+
 
 class RadarVelocityDetectionNode(Node):
     def __init__(self):

Check failure on line 30 in src/perception/radar_object_detection/radar_vis/src/radar_det.py

See this annotation in the file changed.

@github-actions github-actions / Autopep8

src/perception/radar_object_detection/radar_vis/src/radar_det.py#L24-L30

         velocities = [np.sqrt(d.vx**2 + d.vy**2) for d in detections]
         return velocities
 
+
 def main(args=None):
     rclpy.init(args=args)
     node = RadarVelocityDetectionNode()

Check failure on line 36 in src/perception/radar_object_detection/radar_vis/src/radar_det.py

See this annotation in the file changed.

@github-actions github-actions / Autopep8

src/perception/radar_object_detection/radar_vis/src/radar_det.py#L31-L36

     node.destroy_node()
     rclpy.shutdown()
 
+
 if __name__ == '__main__':
     main()