Skip to content

Commit

Permalink
Fix cm construction
Browse files Browse the repository at this point in the history
  • Loading branch information
christophfroehlich committed Dec 4, 2024
1 parent 5d68ee8 commit 627b0fd
Showing 1 changed file with 1 addition and 1 deletion.
Original file line number Diff line number Diff line change
Expand Up @@ -30,7 +30,7 @@ TEST(TestLoadForwardCommandController, load_controller)
std::make_shared<rclcpp::executors::SingleThreadedExecutor>();

controller_manager::ControllerManager cm(
executor, ros2_control_test_assets::minimal_robot_urdf, "test_controller_manager");
executor, ros2_control_test_assets::minimal_robot_urdf, true, "test_controller_manager");

ASSERT_NE(
cm.load_controller(
Expand Down

0 comments on commit 627b0fd

Please sign in to comment.