moveit2
The MoveIt Motion Planning Framework for ROS 2.
|
This namespace includes the base class for MoveIt planners. More...
Classes | |
struct | MotionPlanDetailedResponse |
struct | MotionPlanResponse |
Response to a planning query. More... | |
struct | PlannerConfigurationSettings |
Specify the settings for a particular planning algorithm, for a particular group. The Planner plugin uses these settings to configure the algorithm. More... | |
class | PlannerManager |
Base class for a MoveIt planner. More... | |
class | PlanningContext |
Representation of a particular planning context – the planning scene and the request are known, solution is not yet computed. More... | |
class | PlanningRequestAdapter |
Concept in MoveIt which can be used to modify the planning problem(pre-processing) in a planning pipeline. PlanningRequestAdapters enable adjusting to or validating a planning problem for a subsequent planning algorithm. More... | |
class | PlanningResponseAdapter |
Concept in MoveIt which can be used to modify the planning solution (post-processing) in a planning pipeline. PlanningResponseAdapters enable using for example smoothing and trajectory generation algorithms in sequence to produce a trajectory. More... | |
Typedefs | |
typedef std::map< std::string, PlannerConfigurationSettings > | PlannerConfigurationMap |
Map from PlannerConfigurationSettings.name to PlannerConfigurationSettings. | |
typedef moveit_msgs::msg::MotionPlanRequest | MotionPlanRequest |
Functions | |
MOVEIT_CLASS_FORWARD (PlanningContext) | |
MOVEIT_CLASS_FORWARD (PlannerManager) | |
MOVEIT_CLASS_FORWARD (PlanningRequestAdapter) | |
MOVEIT_CLASS_FORWARD (PlanningResponseAdapter) | |
This namespace includes the base class for MoveIt planners.
typedef moveit_msgs::msg::MotionPlanRequest planning_interface::MotionPlanRequest |
Definition at line 45 of file planning_request.h.
typedef std::map<std::string, PlannerConfigurationSettings> planning_interface::PlannerConfigurationMap |
Map from PlannerConfigurationSettings.name to PlannerConfigurationSettings.
Definition at line 72 of file planning_interface.h.
planning_interface::MOVEIT_CLASS_FORWARD | ( | PlannerManager | ) |
planning_interface::MOVEIT_CLASS_FORWARD | ( | PlanningContext | ) |
planning_interface::MOVEIT_CLASS_FORWARD | ( | PlanningRequestAdapter | ) |
planning_interface::MOVEIT_CLASS_FORWARD | ( | PlanningResponseAdapter | ) |