This namespace includes the base class for MoveIt planners. More...
Classes | |
struct | MotionPlanDetailedResponse |
struct | MotionPlanResponse |
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... | |
Typedefs | |
typedef moveit_msgs::MotionPlanRequest | MotionPlanRequest |
typedef std::map< std::string, PlannerConfigurationSettings > | PlannerConfigurationMap |
Map from PlannerConfigurationSettings.name to PlannerConfigurationSettings. | |
Functions | |
MOVEIT_CLASS_FORWARD (PlanningContext) | |
MOVEIT_CLASS_FORWARD (PlannerManager) |
This namespace includes the base class for MoveIt planners.
typedef moveit_msgs::MotionPlanRequest planning_interface::MotionPlanRequest |
Definition at line 47 of file planning_request.h.
typedef std::map<std::string, PlannerConfigurationSettings> planning_interface::PlannerConfigurationMap |
Map from PlannerConfigurationSettings.name to PlannerConfigurationSettings.
Definition at line 73 of file planning_interface.h.
planning_interface::MOVEIT_CLASS_FORWARD | ( | PlanningContext | ) |
planning_interface::MOVEIT_CLASS_FORWARD | ( | PlannerManager | ) |