moveit2
The MoveIt Motion Planning Framework for ROS 2.
Classes | Namespaces | Typedefs | Functions
planning_component.h File Reference
#include <rclcpp/rclcpp.hpp>
#include <moveit/moveit_cpp/moveit_cpp.h>
#include <moveit/robot_state/robot_state.h>
#include <geometry_msgs/msg/pose_stamped.hpp>
#include <moveit/robot_state/conversions.h>
#include <moveit/utils/moveit_error_code.h>
Include dependency graph for planning_component.h:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Classes

class  moveit_cpp::PlanningComponent
 
struct  moveit_cpp::PlanningComponent::PlanSolution
 The representation of a plan solution. More...
 
struct  moveit_cpp::PlanningComponent::PlanRequestParameters
 Planner parameters provided with the MotionPlanRequest. More...
 

Namespaces

 moveit_cpp
 
 moveit
 Main namespace for MoveIt.
 
 moveit::planning_interface
 Simple interface to MoveIt components.
 

Typedefs

using moveit::planning_interface::PlanningComponent = moveit_cpp::PlanningComponent
 

Functions

 moveit_cpp::MOVEIT_CLASS_FORWARD (PlanningComponent)
 
 moveit::planning_interface::MOVEIT_DECLARE_PTR (PlanningComponent, moveit_cpp::PlanningComponent)