45 local_planner_started_ =
false;
47 return ReactionResult(event,
"", moveit_msgs::msg::MoveItErrorCodes::SUCCESS,
51 return ReactionResult(event,
"Do nothing", moveit_msgs::msg::MoveItErrorCodes::SUCCESS);
54 if (!local_planner_started_)
56 local_planner_started_ =
true;
57 return ReactionResult(event,
"", moveit_msgs::msg::MoveItErrorCodes::SUCCESS,
60 return ReactionResult(event,
"", moveit_msgs::msg::MoveItErrorCodes::SUCCESS);
63 return ReactionResult(event,
"Global planner failed to find a solution",
64 moveit_msgs::msg::MoveItErrorCodes::PLANNING_FAILED);
67 return ReactionResult(event,
"", moveit_msgs::msg::MoveItErrorCodes::SUCCESS,
71 return ReactionResult(event,
"Local planner failed to find a solution",
72 moveit_msgs::msg::MoveItErrorCodes::PLANNING_FAILED);
75 return ReactionResult(event,
"Unknown event", moveit_msgs::msg::MoveItErrorCodes::FAILURE,