moveit2
The MoveIt Motion Planning Framework for ROS 2.
|
moveit_controller_manager::Ros2ControlManager sub class that interfaces one ros_control controller_manager instance. All services and names are relative to ns_. More...
Public Member Functions | |
Ros2ControlManager () | |
The default constructor. Reads the namespace from ~ros_control_namespace param and defaults to /. | |
Ros2ControlManager (const std::string &ns) | |
Configure interface with namespace. | |
void | initialize (const rclcpp::Node::SharedPtr &node) override |
moveit_controller_manager::MoveItControllerHandlePtr | getControllerHandle (const std::string &name) override |
Find and return the pre-allocated handle for the given controller. | |
void | getControllersList (std::vector< std::string > &names) override |
Refresh controller list and output all managed controllers. | |
void | getActiveControllers (std::vector< std::string > &names) override |
Refresh controller list and output all active, managed controllers. | |
void | getControllerJoints (const std::string &name, std::vector< std::string > &joints) override |
Read interface names required by each controller from the cached controller state info. | |
ControllerState | getControllerState (const std::string &name) override |
Refresh controller state and output the state of the given one, only active_ will be set. | |
bool | switchControllers (const std::vector< std::string > &activate_base, const std::vector< std::string > &deactivate_base) override |
Filter lists for managed controller and computes switching set. Stopped list might be extended by unsupported controllers that claim needed resources. | |
bool | fixChainedControllers (std::shared_ptr< controller_manager_msgs::srv::ListControllers::Response > &result) |
fixChainedControllers modifies ListControllers service response if it contains chained controllers. Since chained controllers cannot be written to directly, they are removed from the response and their interfaces are propagated back to the first controller with a non-chained input | |
![]() | |
MoveItControllerManager () | |
Default constructor. This needs to have no arguments so that the plugin system can construct the object. | |
virtual | ~MoveItControllerManager () |
moveit_controller_manager::Ros2ControlManager sub class that interfaces one ros_control controller_manager instance. All services and names are relative to ns_.
Definition at line 132 of file controller_manager_plugin.cpp.
|
inline |
The default constructor. Reads the namespace from ~ros_control_namespace param and defaults to /.
Definition at line 290 of file controller_manager_plugin.cpp.
|
inline |
Configure interface with namespace.
ns | namespace of ros_control node (without /controller_manager/) |
Definition at line 299 of file controller_manager_plugin.cpp.
|
inline |
fixChainedControllers modifies ListControllers service response if it contains chained controllers. Since chained controllers cannot be written to directly, they are removed from the response and their interfaces are propagated back to the first controller with a non-chained input
Definition at line 571 of file controller_manager_plugin.cpp.
|
inlineoverridevirtual |
Refresh controller list and output all active, managed controllers.
[out] | names | list of controllers (with namespace) |
Implements moveit_controller_manager::MoveItControllerManager.
Definition at line 364 of file controller_manager_plugin.cpp.
|
inlineoverridevirtual |
Find and return the pre-allocated handle for the given controller.
name |
Implements moveit_controller_manager::MoveItControllerManager.
Definition at line 333 of file controller_manager_plugin.cpp.
|
inlineoverridevirtual |
Read interface names required by each controller from the cached controller state info.
[in] | name | name of controller (with namespace) |
[out] | joints |
Implements moveit_controller_manager::MoveItControllerManager.
Definition at line 382 of file controller_manager_plugin.cpp.
|
inlineoverridevirtual |
Refresh controller list and output all managed controllers.
[out] | names | list of controllers (with namespace) |
Implements moveit_controller_manager::MoveItControllerManager.
Definition at line 348 of file controller_manager_plugin.cpp.
|
inlineoverridevirtual |
Refresh controller state and output the state of the given one, only active_ will be set.
[in] | name | name of controller (with namespace) |
Implements moveit_controller_manager::MoveItControllerManager.
Definition at line 400 of file controller_manager_plugin.cpp.
|
inlineoverridevirtual |
Implements moveit_controller_manager::MoveItControllerManager.
Definition at line 305 of file controller_manager_plugin.cpp.
|
inlineoverridevirtual |
Filter lists for managed controller and computes switching set. Stopped list might be extended by unsupported controllers that claim needed resources.
activate_base | vector of controllers to be activated |
deactivate_base | vector of controllers to be deactivated |
Implements moveit_controller_manager::MoveItControllerManager.
Definition at line 421 of file controller_manager_plugin.cpp.