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...
 
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...
 
struct  MotionPlanResponse
 Response to a planning query. More...
 
struct  MotionPlanDetailedResponse
 
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, PlannerConfigurationSettingsPlannerConfigurationMap
 Map from PlannerConfigurationSettings.name to PlannerConfigurationSettings. More...
 
typedef moveit_msgs::msg::MotionPlanRequest MotionPlanRequest
 

Functions

 MOVEIT_CLASS_FORWARD (PlanningContext)
 
 MOVEIT_CLASS_FORWARD (PlannerManager)
 
 MOVEIT_CLASS_FORWARD (PlanningRequestAdapter)
 
 MOVEIT_CLASS_FORWARD (PlanningResponseAdapter)
 

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/4]

planning_interface::MOVEIT_CLASS_FORWARD ( PlannerManager  )

◆ MOVEIT_CLASS_FORWARD() [2/4]

planning_interface::MOVEIT_CLASS_FORWARD ( PlanningContext  )

◆ MOVEIT_CLASS_FORWARD() [3/4]

planning_interface::MOVEIT_CLASS_FORWARD ( PlanningRequestAdapter  )

◆ MOVEIT_CLASS_FORWARD() [4/4]

planning_interface::MOVEIT_CLASS_FORWARD ( PlanningResponseAdapter  )