moveit2
The MoveIt Motion Planning Framework for ROS 2.
|
#include <moveit/macros/class_forward.h>
#include <moveit/robot_state/robot_state.h>
#include <moveit/utils/moveit_error_code.h>
#include <moveit_msgs/msg/robot_trajectory.hpp>
#include <moveit_msgs/msg/robot_state.hpp>
#include <moveit_msgs/msg/planner_interface_description.hpp>
#include <moveit_msgs/msg/constraints.hpp>
#include <moveit_msgs/msg/grasp.hpp>
#include <moveit_msgs/action/move_group.hpp>
#include <moveit_msgs/action/execute_trajectory.hpp>
#include <moveit_msgs/msg/motion_plan_request.hpp>
#include <geometry_msgs/msg/pose_stamped.hpp>
#include <rclcpp_action/rclcpp_action.hpp>
#include <memory>
#include <utility>
#include <tf2_ros/buffer.h>
#include <moveit_move_group_interface_export.h>
Go to the source code of this file.
Classes | |
class | moveit::planning_interface::MoveGroupInterface |
Client class to conveniently use the ROS interfaces provided by the move_group node. More... | |
struct | moveit::planning_interface::MoveGroupInterface::Options |
Specification of options to use when constructing the MoveGroupInterface class. More... | |
struct | moveit::planning_interface::MoveGroupInterface::Plan |
The representation of a motion plan (as ROS messasges) More... | |
Namespaces | |
moveit | |
Main namespace for MoveIt. | |
moveit::planning_interface | |
Simple interface to MoveIt components. | |
Typedefs | |
using | moveit::planning_interface::MoveItErrorCode = moveit::core::MoveItErrorCode |
Functions | |
moveit::planning_interface::MOVEIT_CLASS_FORWARD (MoveGroupInterface) | |