Skip to content

Commit

Permalink
[JTC] Remove unused test code (#1095)
Browse files Browse the repository at this point in the history
  • Loading branch information
bmagyar committed Apr 9, 2024
1 parent 689efe7 commit 9e97c00
Showing 1 changed file with 0 additions and 4 deletions.
Original file line number Diff line number Diff line change
Expand Up @@ -51,17 +51,13 @@ using lifecycle_msgs::msg::State;
using test_trajectory_controllers::TrajectoryControllerTest;
using test_trajectory_controllers::TrajectoryControllerTestParameterized;

void spin(rclcpp::executors::MultiThreadedExecutor * exe) { exe->spin(); }

TEST_P(TrajectoryControllerTestParameterized, configure_state_ignores_commands)
{
rclcpp::executors::MultiThreadedExecutor executor;
SetUpTrajectoryController(executor);
traj_controller_->get_node()->set_parameter(
rclcpp::Parameter("allow_nonzero_velocity_at_trajectory_end", true));

// const auto future_handle_ = std::async(std::launch::async, spin, &executor);

const auto state = traj_controller_->get_node()->configure();
ASSERT_EQ(state.id(), State::PRIMARY_STATE_INACTIVE);

Expand Down

0 comments on commit 9e97c00

Please sign in to comment.