Public Member Functions | |
DummyController (const std::string &name) | |
virtual std::string | getHardwareInterfaceType () const |
virtual bool | initRequest (hardware_interface::RobotHW *, ros::NodeHandle &, ros::NodeHandle &controller_nh, std::set< std::string > &claimed_resources) |
virtual void | update (const ros::Time &, const ros::Duration &) |
Private Attributes | |
const std::string | type_name |
Definition at line 223 of file hwi_switch_test.cpp.
DummyControllerLoader::DummyController::DummyController | ( | const std::string & | name | ) | [inline] |
Definition at line 227 of file hwi_switch_test.cpp.
virtual std::string DummyControllerLoader::DummyController::getHardwareInterfaceType | ( | ) | const [inline, virtual] |
Implements controller_interface::ControllerBase.
Definition at line 244 of file hwi_switch_test.cpp.
virtual bool DummyControllerLoader::DummyController::initRequest | ( | hardware_interface::RobotHW * | , |
ros::NodeHandle & | , | ||
ros::NodeHandle & | controller_nh, | ||
std::set< std::string > & | claimed_resources | ||
) | [inline, virtual] |
Implements controller_interface::ControllerBase.
Definition at line 229 of file hwi_switch_test.cpp.
virtual void DummyControllerLoader::DummyController::update | ( | const ros::Time & | , |
const ros::Duration & | |||
) | [inline, virtual] |
Implements controller_interface::ControllerBase.
Definition at line 228 of file hwi_switch_test.cpp.
const std::string DummyControllerLoader::DummyController::type_name [private] |
Definition at line 225 of file hwi_switch_test.cpp.