diff --git a/joint_trajectory_controller/test/test_trajectory_controller.cpp b/joint_trajectory_controller/test/test_trajectory_controller.cpp index a2768cf270..003480e9c9 100644 --- a/joint_trajectory_controller/test/test_trajectory_controller.cpp +++ b/joint_trajectory_controller/test/test_trajectory_controller.cpp @@ -517,16 +517,9 @@ TEST_P(TrajectoryControllerTestParameterized, position_error_not_angle_wraparoun rclcpp::executors::MultiThreadedExecutor executor; constexpr double k_p = 10.0; std::vector params = {}; -<<<<<<< HEAD bool angle_wraparound = false; SetUpAndActivateTrajectoryController(executor, params, true, k_p, 0.0, angle_wraparound); - subscribeToState(); -======= - SetUpAndActivateTrajectoryController( - executor, params, true, k_p, 0.0, INITIAL_POS_JOINTS, INITIAL_VEL_JOINTS, INITIAL_ACC_JOINTS, - INITIAL_EFF_JOINTS, test_trajectory_controllers::urdf_rrrbot_revolute); subscribeToState(executor); ->>>>>>> 2674f6d (Fix WaitSet issue in tests (#1206)) size_t n_joints = joint_names_.size(); diff --git a/joint_trajectory_controller/test/test_trajectory_controller_utils.hpp b/joint_trajectory_controller/test/test_trajectory_controller_utils.hpp index ca8e09a2f3..cef03fdf6f 100644 --- a/joint_trajectory_controller/test/test_trajectory_controller_utils.hpp +++ b/joint_trajectory_controller/test/test_trajectory_controller_utils.hpp @@ -188,28 +188,6 @@ class TestableJointTrajectoryController trajectory_msgs::msg::JointTrajectoryPoint get_state_reference() { return state_desired_; } trajectory_msgs::msg::JointTrajectoryPoint get_state_error() { return state_error_; } -<<<<<<< HEAD - rclcpp::WaitSet joint_cmd_sub_wait_set_; -======= - /** - * a copy of the private member function - */ - void resize_joint_trajectory_point( - trajectory_msgs::msg::JointTrajectoryPoint & point, size_t size) - { - point.positions.resize(size, 0.0); - if (has_velocity_state_interface_) - { - point.velocities.resize(size, 0.0); - } - if (has_acceleration_state_interface_) - { - point.accelerations.resize(size, 0.0); - } - } - - rclcpp::NodeOptions node_options_; ->>>>>>> 2674f6d (Fix WaitSet issue in tests (#1206)) }; class TrajectoryControllerTest : public ::testing::Test