66 : MoveGroupCapability(
"SequenceAction")
67 , move_feedback_(std::make_shared<moveit_msgs::action::MoveGroupSequence::Feedback>())
74 RCLCPP_INFO_STREAM(getLogger(),
"initialize move group sequence action");
77 action_callback_group_ =
78 context_->moveit_cpp_->getNode()->create_callback_group(rclcpp::CallbackGroupType::MutuallyExclusive);
79 move_action_server_ = rclcpp_action::create_server<moveit_msgs::action::MoveGroupSequence>(
80 context_->moveit_cpp_->getNode(),
"sequence_move_group",
81 [](
const rclcpp_action::GoalUUID& ,
82 const std::shared_ptr<const moveit_msgs::action::MoveGroupSequence::Goal>& ) {
83 RCLCPP_DEBUG(getLogger(),
"Received action goal");
84 return rclcpp_action::GoalResponse::ACCEPT_AND_EXECUTE;
86 [
this](
const std::shared_ptr<MoveGroupSequenceGoalHandle>& ) {
87 RCLCPP_DEBUG(getLogger(),
"Canceling action goal");
88 preemptMoveCallback();
89 return rclcpp_action::CancelResponse::ACCEPT;
91 [
this](
const std::shared_ptr<MoveGroupSequenceGoalHandle>& goal_handle) {
92 RCLCPP_DEBUG(getLogger(),
"Accepting new action goal");
93 executeSequenceCallback(goal_handle);
95 rcl_action_server_get_default_options(), action_callback_group_);
97 command_list_manager_ = std::make_unique<pilz_industrial_motion_planner::CommandListManager>(
98 context_->moveit_cpp_->getNode(),
context_->planning_scene_monitor_->getRobotModel());
101void MoveGroupSequenceAction::executeSequenceCallback(
const std::shared_ptr<MoveGroupSequenceGoalHandle>& goal_handle)
104 goal_handle_ = goal_handle;
105 const auto goal = goal_handle->get_goal();
110 if (goal->request.items.empty())
112 RCLCPP_WARN(getLogger(),
"Received empty request. That's ok but maybe not what you intended.");
114 const auto action_res = std::make_shared<moveit_msgs::action::MoveGroupSequence::Result>();
115 action_res->response.error_code.val = moveit_msgs::msg::MoveItErrorCodes::SUCCESS;
116 goal_handle->succeed(action_res);
122 auto node =
context_->moveit_cpp_->getNode();
123 context_->planning_scene_monitor_->waitForCurrentRobotState(node->get_clock()->now());
124 context_->planning_scene_monitor_->updateFrameTransforms();
126 const auto action_res = std::make_shared<moveit_msgs::action::MoveGroupSequence::Result>();
127 if (goal->planning_options.plan_only || !
context_->allow_trajectory_execution_)
129 if (!goal->planning_options.plan_only)
131 RCLCPP_WARN(getLogger(),
"Only plan will be calculated, although plan_only == false.");
133 executeMoveCallbackPlanOnly(goal, action_res);
137 executeSequenceCallbackPlanAndExecute(goal, action_res);
140 switch (action_res->response.error_code.val)
142 case moveit_msgs::msg::MoveItErrorCodes::SUCCESS:
143 goal_handle->succeed(action_res);
145 case moveit_msgs::msg::MoveItErrorCodes::PREEMPTED:
146 goal_handle->canceled(action_res);
149 goal_handle->abort(action_res);
154 goal_handle_.reset();
157void MoveGroupSequenceAction::executeSequenceCallbackPlanAndExecute(
158 const moveit_msgs::action::MoveGroupSequence::Goal::ConstSharedPtr& goal,
159 const moveit_msgs::action::MoveGroupSequence::Result::SharedPtr& action_res)
161 RCLCPP_INFO(
getLogger(),
"Combined planning and execution request received for MoveGroupSequenceAction.");
164 const moveit_msgs::msg::PlanningScene& planning_scene_diff =
166 goal->planning_options.planning_scene_diff :
169 opt.
replan = goal->planning_options.replan;
175 return planUsingSequenceManager(request, plan);
179 context_->plan_execution_->planAndExecute(plan, planning_scene_diff, opt);
181 StartStatesMsg start_states_msg;
182 convertToMsg(
plan.plan_components, start_states_msg, action_res->response.planned_trajectories);
185 action_res->response.sequence_start = start_states_msg.at(0);
187 catch (std::out_of_range&)
189 RCLCPP_WARN(
getLogger(),
"Can not determine start state from empty sequence.");
194void MoveGroupSequenceAction::convertToMsg(
const ExecutableTrajs& trajs, StartStatesMsg& start_states_msg,
195 PlannedTrajMsgs& planned_trajs_msgs)
197 start_states_msg.resize(trajs.size());
198 planned_trajs_msgs.resize(trajs.size());
199 for (
size_t i = 0; i < trajs.size(); ++i)
202 trajs.at(i).trajectory->getRobotTrajectoryMsg(planned_trajs_msgs.at(i));
206void MoveGroupSequenceAction::executeMoveCallbackPlanOnly(
207 const moveit_msgs::action::MoveGroupSequence::Goal::ConstSharedPtr& goal,
208 const moveit_msgs::action::MoveGroupSequence::Result::SharedPtr& action_res)
210 RCLCPP_INFO(
getLogger(),
"Planning request received for MoveGroupSequenceAction action.");
216 const planning_scene::PlanningSceneConstPtr& the_scene =
218 static_cast<const planning_scene::PlanningSceneConstPtr&
>(lscene) :
219 lscene->diff(goal->planning_options.planning_scene_diff);
221 rclcpp::Time planning_start =
context_->moveit_cpp_->getNode()->now();
231 RCLCPP_ERROR_STREAM(
getLogger(),
"Could not load planning pipeline " << goal->request.items[0].req.pipeline_id);
232 action_res->response.error_code.val = moveit_msgs::msg::MoveItErrorCodes::FAILURE;
236 traj_vec = command_list_manager_->solve(the_scene,
planning_pipeline, goal->request);
238 catch (
const MoveItErrorCodeException& ex)
240 RCLCPP_ERROR_STREAM(
getLogger(),
"> Planning pipeline threw an exception (error code: " << ex.getErrorCode()
241 <<
"): " << ex.what());
242 action_res->response.error_code.val = ex.getErrorCode();
246 catch (
const std::exception& ex)
248 RCLCPP_ERROR(
getLogger(),
"Planning pipeline threw an exception: %s", ex.what());
249 action_res->response.error_code.val = moveit_msgs::msg::MoveItErrorCodes::FAILURE;
254 StartStatesMsg start_states_msg;
255 start_states_msg.resize(traj_vec.size());
256 action_res->response.planned_trajectories.resize(traj_vec.size());
257 for (RobotTrajCont::size_type i = 0; i < traj_vec.size(); ++i)
260 action_res->response.planned_trajectories.at(i));
264 action_res->response.sequence_start = start_states_msg.at(0);
266 catch (std::out_of_range&)
268 RCLCPP_WARN(
getLogger(),
"Can not determine start state from empty sequence.");
271 action_res->response.error_code.val = moveit_msgs::msg::MoveItErrorCodes::SUCCESS;
272 action_res->response.planning_time = (
context_->moveit_cpp_->getNode()->now() - planning_start).seconds();
275bool MoveGroupSequenceAction::planUsingSequenceManager(
const moveit_msgs::msg::MotionSequenceRequest& req,
290 RCLCPP_ERROR_STREAM(
getLogger(),
"Could not load planning pipeline " << req.items[0].req.pipeline_id);
296 catch (
const MoveItErrorCodeException& ex)
298 RCLCPP_ERROR_STREAM(
getLogger(),
"Planning pipeline threw an exception (error code: " << ex.getErrorCode()
299 <<
"): " << ex.what());
304 catch (
const std::exception& ex)
306 RCLCPP_ERROR_STREAM(
getLogger(),
"Planning pipeline threw an exception: " << ex.what());
307 plan.
error_code.val = moveit_msgs::msg::MoveItErrorCodes::FAILURE;
312 if (!traj_vec.empty())
314 plan.plan_components.resize(traj_vec.size());
315 for (
size_t i = 0; i < traj_vec.size(); ++i)
318 plan.plan_components.at(i).description =
"plan";
321 plan.
error_code.val = moveit_msgs::msg::MoveItErrorCodes::SUCCESS;
325void MoveGroupSequenceAction::startMoveExecutionCallback()
330void MoveGroupSequenceAction::preemptMoveCallback()
339 goal_handle_->publish_feedback(move_feedback_);
344#include <pluginlib/class_list_macros.hpp>
PLUGINLIB_EXPORT_CLASS(cached_ik_kinematics_plugin::CachedIKKinematicsPlugin< kdl_kinematics_plugin::KDLKinematicsPlugin >, kinematics::KinematicsBase)
moveit_msgs::msg::PlanningScene clearSceneRobotState(const moveit_msgs::msg::PlanningScene &scene) const
void convertToMsg(const std::vector< plan_execution::ExecutableTrajectory > &trajectory, moveit_msgs::msg::RobotState &first_state_msg, std::vector< moveit_msgs::msg::RobotTrajectory > &trajectory_msg) const
MoveGroupContextPtr context_
std::string stateToStr(MoveGroupState state) const
planning_pipeline::PlanningPipelinePtr resolvePlanningPipeline(const std::string &pipeline_id) const
Provide action to handle multiple trajectories and execute the result in the form of a MoveGroup capa...
void initialize() override
MoveGroupSequenceAction()
This is a convenience class for obtaining access to an instance of a locked PlanningScene.
rclcpp::Logger getLogger()
void robotStateToRobotStateMsg(const RobotState &state, moveit_msgs::msg::RobotState &robot_state, bool copy_attached_bodies=true)
Convert a MoveIt robot state to a robot state message.
bool isEmpty(const moveit_msgs::msg::PlanningScene &msg)
Check if a message includes any information about a planning scene, or whether it is empty.
planning_interface::MotionPlanResponse plan(std::shared_ptr< moveit_cpp::PlanningComponent > &planning_component, std::shared_ptr< moveit_cpp::PlanningComponent::PlanRequestParameters > &single_plan_parameters, std::shared_ptr< moveit_cpp::PlanningComponent::MultiPipelinePlanRequestParameters > &multi_plan_parameters, std::shared_ptr< planning_scene::PlanningScene > &planning_scene, std::optional< const moveit::planning_pipeline_interfaces::SolutionSelectionFunction > solution_selection_function, std::optional< moveit::planning_pipeline_interfaces::StoppingCriterionFunction > stopping_criterion_callback)
rclcpp::Logger getLogger(const std::string &name)
Creates a namespaced logger.
std::vector< robot_trajectory::RobotTrajectoryPtr > RobotTrajCont
A generic representation on what a computed motion plan looks like.
double replan_delay
The amount of time to wait in between replanning attempts (in seconds)
unsigned int replan_attemps
ExecutableMotionPlanComputationFn plan_callback
Callback for computing motion plans. This callback must always be specified.
std::function< void()> before_execution_callback_
bool replan
Flag indicating whether replanning is allowed.
moveit::core::MoveItErrorCode error_code
robot_trajectory::RobotTrajectoryPtr trajectory