moveit2
The MoveIt Motion Planning Framework for ROS 2.
Public Member Functions | List of all members
moveit_ros_control_interface::EmptyControllerAllocator Class Reference

This class allows MoveIt's controller manager to start and stop a controller that does not have a corresponding controller handle implementation without actually executing MoveIt trajectories through the controller handle. More...

Inheritance diagram for moveit_ros_control_interface::EmptyControllerAllocator:
Inheritance graph
[legend]
Collaboration diagram for moveit_ros_control_interface::EmptyControllerAllocator:
Collaboration graph
[legend]

Public Member Functions

moveit_controller_manager::MoveItControllerHandlePtr alloc (const rclcpp::Node::SharedPtr &, const std::string &name, const std::vector< std::string > &) override
 
- Public Member Functions inherited from moveit_ros_control_interface::ControllerHandleAllocator
virtual ~ControllerHandleAllocator ()
 

Detailed Description

This class allows MoveIt's controller manager to start and stop a controller that does not have a corresponding controller handle implementation without actually executing MoveIt trajectories through the controller handle.

Allocator plugin for the EmptyControllerAllocator.

Definition at line 51 of file empty_controller_plugin.cpp.

Member Function Documentation

◆ alloc()

moveit_controller_manager::MoveItControllerHandlePtr moveit_ros_control_interface::EmptyControllerAllocator::alloc ( const rclcpp::Node::SharedPtr &  ,
const std::string &  name,
const std::vector< std::string > &   
)
inlineoverridevirtual

The documentation for this class was generated from the following file: