moveit2
The MoveIt Motion Planning Framework for ROS 2.
|
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...
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 () |
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.
|
inlineoverridevirtual |
Implements moveit_ros_control_interface::ControllerHandleAllocator.
Definition at line 54 of file empty_controller_plugin.cpp.