moveit2
The MoveIt Motion Planning Framework for ROS 2.
Classes | Typedefs | Functions
planning_interface Namespace Reference

This namespace includes the base class for MoveIt planners. More...

Classes

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  PlanningContext
 Representation of a particular planning context – the planning scene and the request are known, solution is not yet computed. More...
 
class  PlannerManager
 Base class for a MoveIt planner. More...
 
struct  MotionPlanResponse
 
struct  MotionPlanDetailedResponse
 

Typedefs

typedef std::map< std::string, PlannerConfigurationSettingsPlannerConfigurationMap
 Map from PlannerConfigurationSettings.name to PlannerConfigurationSettings. More...
 
typedef moveit_msgs::msg::MotionPlanRequest MotionPlanRequest
 

Functions

 MOVEIT_CLASS_FORWARD (PlanningContext)
 
 MOVEIT_CLASS_FORWARD (PlannerManager)
 

Detailed Description

This namespace includes the base class for MoveIt planners.

Typedef Documentation

◆ MotionPlanRequest

typedef moveit_msgs::msg::MotionPlanRequest planning_interface::MotionPlanRequest

Definition at line 45 of file planning_request.h.

◆ PlannerConfigurationMap

Function Documentation

◆ MOVEIT_CLASS_FORWARD() [1/2]

planning_interface::MOVEIT_CLASS_FORWARD ( PlannerManager  )

◆ MOVEIT_CLASS_FORWARD() [2/2]

planning_interface::MOVEIT_CLASS_FORWARD ( PlanningContext  )