Skip to content

Commit f661c18

Browse files
sjahrrhaschke
authored andcommitted
Fix MTC unittests for new pipeline refactoring (moveit#515)
1 parent 11c3126 commit f661c18

File tree

1 file changed

+1
-1
lines changed

1 file changed

+1
-1
lines changed

core/test/test_pipeline_planner.cpp

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -11,7 +11,7 @@ using namespace moveit::task_constructor;
1111
struct PipelinePlannerTest : public testing::Test
1212
{
1313
PipelinePlannerTest() {
14-
node->declare_parameter<std::string>("STOMP.planning_plugin", "stomp_moveit/StompPlanner");
14+
node->declare_parameter<std::vector<std::string>>("STOMP.planning_plugins", { "stomp_moveit/StompPlanner" });
1515
};
1616
const rclcpp::Node::SharedPtr node = rclcpp::Node::make_shared("test_pipeline_planner");
1717
const moveit::core::RobotModelPtr robot_model = getModel();

0 commit comments

Comments
 (0)