Skip to content

Commit

Permalink
Fix conflicts
Browse files Browse the repository at this point in the history
  • Loading branch information
bmagyar authored Jul 16, 2024
1 parent a17f080 commit 862f511
Show file tree
Hide file tree
Showing 2 changed files with 0 additions and 12 deletions.
Original file line number Diff line number Diff line change
Expand Up @@ -658,16 +658,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 @@ -212,11 +212,6 @@ class TestableJointTrajectoryController
}
}

<<<<<<< HEAD
rclcpp::WaitSet joint_cmd_sub_wait_set_;
=======
rclcpp::NodeOptions node_options_;
>>>>>>> 2674f6d (Fix WaitSet issue in tests (#1206))
};

class TrajectoryControllerTest : public ::testing::Test
Expand Down

0 comments on commit 862f511

Please sign in to comment.