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

Simple allocator for moveit_simple_controller_manager::FollowJointTrajectoryControllerHandle instances. More...

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

Public Member Functions

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

Detailed Description

Simple allocator for moveit_simple_controller_manager::FollowJointTrajectoryControllerHandle instances.

Definition at line 48 of file joint_trajectory_controller_plugin.cpp.

Member Function Documentation

◆ alloc()

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

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