moveit2
The MoveIt Motion Planning Framework for ROS 2.
Public Member Functions | Static Public Attributes | Protected Attributes | List of all members
test_moveit_controller_manager::TestRos2ControlManager Class Reference

#include <test_moveit_controller_manager.h>

Inheritance diagram for test_moveit_controller_manager::TestRos2ControlManager:
Inheritance graph
[legend]
Collaboration diagram for test_moveit_controller_manager::TestRos2ControlManager:
Collaboration graph
[legend]

Public Member Functions

 TestRos2ControlManager ()
 
void initialize (const rclcpp::Node::SharedPtr &) override
 
moveit_controller_manager::MoveItControllerHandlePtr getControllerHandle (const std::string &name) override
 
void getControllersList (std::vector< std::string > &names) override
 
void getActiveControllers (std::vector< std::string > &names) override
 
void getControllerJoints (const std::string &name, std::vector< std::string > &joints) override
 
moveit_controller_manager::Ros2ControlManager::ControllerState getControllerState (const std::string &name) override
 
bool switchControllers (const std::vector< std::string > &activate, const std::vector< std::string > &deactivate) override
 

Static Public Attributes

static const int ACTIVE = 1
 
static const int DEFAULT = 2
 

Protected Attributes

std::map< std::string, int > controllers_
 
std::map< std::string, std::vector< std::string > > controller_joints_
 

Detailed Description

Definition at line 75 of file test_moveit_controller_manager.h.

Constructor & Destructor Documentation

◆ TestRos2ControlManager()

test_moveit_controller_manager::TestRos2ControlManager::TestRos2ControlManager ( )
inline

Definition at line 81 of file test_moveit_controller_manager.h.

Member Function Documentation

◆ getActiveControllers()

void test_moveit_controller_manager::TestRos2ControlManager::getActiveControllers ( std::vector< std::string > &  names)
inlineoverride

Definition at line 128 of file test_moveit_controller_manager.h.

◆ getControllerHandle()

moveit_controller_manager::MoveItControllerHandlePtr test_moveit_controller_manager::TestRos2ControlManager::getControllerHandle ( const std::string &  name)
inlineoverride

Definition at line 116 of file test_moveit_controller_manager.h.

◆ getControllerJoints()

void test_moveit_controller_manager::TestRos2ControlManager::getControllerJoints ( const std::string &  name,
std::vector< std::string > &  joints 
)
inlineoverride

Definition at line 136 of file test_moveit_controller_manager.h.

◆ getControllersList()

void test_moveit_controller_manager::TestRos2ControlManager::getControllersList ( std::vector< std::string > &  names)
inlineoverride

Definition at line 121 of file test_moveit_controller_manager.h.

◆ getControllerState()

moveit_controller_manager::Ros2ControlManager::ControllerState test_moveit_controller_manager::TestRos2ControlManager::getControllerState ( const std::string &  name)
inlineoverride

Definition at line 141 of file test_moveit_controller_manager.h.

◆ initialize()

void test_moveit_controller_manager::TestRos2ControlManager::initialize ( const rclcpp::Node::SharedPtr &  )
inlineoverride

Definition at line 112 of file test_moveit_controller_manager.h.

◆ switchControllers()

bool test_moveit_controller_manager::TestRos2ControlManager::switchControllers ( const std::vector< std::string > &  activate,
const std::vector< std::string > &  deactivate 
)
inlineoverride

Definition at line 149 of file test_moveit_controller_manager.h.

Member Data Documentation

◆ ACTIVE

const int test_moveit_controller_manager::TestRos2ControlManager::ACTIVE = 1
static

Definition at line 78 of file test_moveit_controller_manager.h.

◆ controller_joints_

std::map<std::string, std::vector<std::string> > test_moveit_controller_manager::TestRos2ControlManager::controller_joints_
protected

Definition at line 166 of file test_moveit_controller_manager.h.

◆ controllers_

std::map<std::string, int> test_moveit_controller_manager::TestRos2ControlManager::controllers_
protected

Definition at line 165 of file test_moveit_controller_manager.h.

◆ DEFAULT

const int test_moveit_controller_manager::TestRos2ControlManager::DEFAULT = 2
static

Definition at line 79 of file test_moveit_controller_manager.h.


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