|
moveit2
The MoveIt Motion Planning Framework for ROS 2.
|
#include <moveit/planning_scene_monitor/planning_scene_monitor.hpp>#include <moveit/robot_trajectory/robot_trajectory.hpp>#include <moveit_msgs/msg/move_it_error_codes.hpp>#include <functional>

Go to the source code of this file.
Classes | |
| struct | plan_execution::ExecutableTrajectory |
| Representation of a trajectory that can be executed. More... | |
| struct | plan_execution::ExecutableMotionPlan |
| A generic representation on what a computed motion plan looks like. More... | |
Namespaces | |
| namespace | plan_execution |
| This namespace includes functionality specific to the execution and monitoring of motion plans. | |
Typedefs | |
| using | plan_execution::ExecutableMotionPlanComputationFn = std::function< bool(ExecutableMotionPlan &)> |
| The signature of a function that can compute a motion plan. | |