Skip to content

Commit

Permalink
conflict fixup
Browse files Browse the repository at this point in the history
  • Loading branch information
bmagyar authored Jul 16, 2024
1 parent 2be0010 commit e6e6ac1
Show file tree
Hide file tree
Showing 2 changed files with 0 additions and 29 deletions.
Original file line number Diff line number Diff line change
Expand Up @@ -517,16 +517,9 @@ TEST_P(TrajectoryControllerTestParameterized, position_error_not_angle_wraparoun
rclcpp::executors::MultiThreadedExecutor executor;
constexpr double k_p = 10.0;
std::vector<rclcpp::Parameter> 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();

Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -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
Expand Down

0 comments on commit e6e6ac1

Please sign in to comment.