41#include <moveit_msgs/msg/move_it_error_codes.hpp>
46struct ExecutableMotionPlan;
56 std::vector<std::string> controller_names = {})
This namespace includes functionality specific to the execution and monitoring of motion plans.
std::function< bool(ExecutableMotionPlan &)> ExecutableMotionPlanComputationFn
The signature of a function that can compute a motion plan.
A generic representation on what a computed motion plan looks like.
std::vector< ExecutableTrajectory > plan_components
robot_trajectory::RobotTrajectoryPtr executed_trajectory
The trace of the trajectory recorded during execution.
planning_scene_monitor::PlanningSceneMonitorPtr planning_scene_monitor
planning_scene::PlanningSceneConstPtr planning_scene
moveit_msgs::msg::MoveItErrorCodes error_code
An error code reflecting what went wrong (if anything)
Representation of a trajectory that can be executed.
robot_trajectory::RobotTrajectoryPtr trajectory
collision_detection::AllowedCollisionMatrixConstPtr allowed_collision_matrix
bool trajectory_monitoring
std::vector< std::string > controller_name
ExecutableTrajectory(const robot_trajectory::RobotTrajectoryPtr &trajectory, const std::string &description, std::vector< std::string > controller_names={})
std::function< bool(const ExecutableMotionPlan *)> effect_on_success