Skip to content

Commit

Permalink
Add missing deps
Browse files Browse the repository at this point in the history
  • Loading branch information
christophfroehlich committed Nov 20, 2024
1 parent 79358e3 commit 5a2e4dc
Show file tree
Hide file tree
Showing 3 changed files with 4 additions and 5 deletions.
2 changes: 2 additions & 0 deletions ros2_controllers_test_nodes/package.xml
Original file line number Diff line number Diff line change
Expand Up @@ -21,6 +21,8 @@
<depend>trajectory_msgs</depend>

<test_depend>python3-pytest</test_depend>
<test_depend>launch_testing_ros</test_depend>
<test_depend>launch_ros</test_depend>

<export>
<build_type>ament_python</build_type>
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -35,14 +35,12 @@
from launch import LaunchDescription
from launch.substitutions import PathJoinSubstitution
from launch_ros.substitutions import FindPackageShare
import launch_ros.actions
from launch_testing.actions import ReadyToTest
from launch_testing_ros import WaitForTopics

import launch_testing.markers
import rclpy
import launch_ros.actions
from rclpy.node import Node

from std_msgs.msg import Float64MultiArray


Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -35,12 +35,11 @@
from launch import LaunchDescription
from launch.substitutions import PathJoinSubstitution
from launch_ros.substitutions import FindPackageShare
import launch_ros.actions
from launch_testing.actions import ReadyToTest
from launch_testing_ros import WaitForTopics

import launch_testing.markers
import rclpy
import launch_ros.actions
from rclpy.node import Node
from trajectory_msgs.msg import JointTrajectory

Expand Down

0 comments on commit 5a2e4dc

Please sign in to comment.