From 5a2e4dcb4f18ce1d2223531e57fe1f848f6e399e Mon Sep 17 00:00:00 2001 From: Christoph Froehlich Date: Wed, 20 Nov 2024 07:19:38 +0000 Subject: [PATCH 1/2] Add missing deps --- ros2_controllers_test_nodes/package.xml | 2 ++ .../test/test_publisher_forward_position_controller_launch.py | 4 +--- .../test/test_publisher_joint_trajectory_controller_launch.py | 3 +-- 3 files changed, 4 insertions(+), 5 deletions(-) diff --git a/ros2_controllers_test_nodes/package.xml b/ros2_controllers_test_nodes/package.xml index c53f1b9971..0b97d6bb0c 100644 --- a/ros2_controllers_test_nodes/package.xml +++ b/ros2_controllers_test_nodes/package.xml @@ -21,6 +21,8 @@ trajectory_msgs python3-pytest + launch_testing_ros + launch_ros ament_python diff --git a/ros2_controllers_test_nodes/test/test_publisher_forward_position_controller_launch.py b/ros2_controllers_test_nodes/test/test_publisher_forward_position_controller_launch.py index 8ebb2df7b3..2c68a71554 100644 --- a/ros2_controllers_test_nodes/test/test_publisher_forward_position_controller_launch.py +++ b/ros2_controllers_test_nodes/test/test_publisher_forward_position_controller_launch.py @@ -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 diff --git a/ros2_controllers_test_nodes/test/test_publisher_joint_trajectory_controller_launch.py b/ros2_controllers_test_nodes/test/test_publisher_joint_trajectory_controller_launch.py index d8d6e2a577..ac3cbe1154 100644 --- a/ros2_controllers_test_nodes/test/test_publisher_joint_trajectory_controller_launch.py +++ b/ros2_controllers_test_nodes/test/test_publisher_joint_trajectory_controller_launch.py @@ -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 From 608c25b53e0099a5bce1b9152f4b2e09ef0902ca Mon Sep 17 00:00:00 2001 From: Christoph Froehlich Date: Fri, 22 Nov 2024 08:43:13 +0000 Subject: [PATCH 2/2] Sort alphabetically --- .../test/test_publisher_forward_position_controller_launch.py | 4 ++-- .../test/test_publisher_joint_trajectory_controller_launch.py | 4 ++-- 2 files changed, 4 insertions(+), 4 deletions(-) diff --git a/ros2_controllers_test_nodes/test/test_publisher_forward_position_controller_launch.py b/ros2_controllers_test_nodes/test/test_publisher_forward_position_controller_launch.py index 2c68a71554..3f4c9da21f 100644 --- a/ros2_controllers_test_nodes/test/test_publisher_forward_position_controller_launch.py +++ b/ros2_controllers_test_nodes/test/test_publisher_forward_position_controller_launch.py @@ -34,11 +34,11 @@ from launch import LaunchDescription from launch.substitutions import PathJoinSubstitution -from launch_ros.substitutions import FindPackageShare import launch_ros.actions +from launch_ros.substitutions import FindPackageShare from launch_testing.actions import ReadyToTest -from launch_testing_ros import WaitForTopics import launch_testing.markers +from launch_testing_ros import WaitForTopics import rclpy from rclpy.node import Node from std_msgs.msg import Float64MultiArray diff --git a/ros2_controllers_test_nodes/test/test_publisher_joint_trajectory_controller_launch.py b/ros2_controllers_test_nodes/test/test_publisher_joint_trajectory_controller_launch.py index ac3cbe1154..62ad25550d 100644 --- a/ros2_controllers_test_nodes/test/test_publisher_joint_trajectory_controller_launch.py +++ b/ros2_controllers_test_nodes/test/test_publisher_joint_trajectory_controller_launch.py @@ -34,11 +34,11 @@ from launch import LaunchDescription from launch.substitutions import PathJoinSubstitution -from launch_ros.substitutions import FindPackageShare import launch_ros.actions +from launch_ros.substitutions import FindPackageShare from launch_testing.actions import ReadyToTest -from launch_testing_ros import WaitForTopics import launch_testing.markers +from launch_testing_ros import WaitForTopics import rclpy from rclpy.node import Node from trajectory_msgs.msg import JointTrajectory