#include <service_caller.h>

Public Member Functions | |
| bool | getOk () |
| void | startControllers (const std::vector< std::string > &controllers) |
| void | stopControllers (const std::vector< std::string > &controllers) |
| SwitchControllersServiceCaller (ros::NodeHandle &nh) | |
Public Member Functions inherited from rm_common::ServiceCallerBase< controller_manager_msgs::SwitchController > | |
| void | callService () |
| controller_manager_msgs::SwitchController & | getService () |
| bool | isCalling () |
| ServiceCallerBase (ros::NodeHandle &nh, const std::string &service_name="") | |
| ServiceCallerBase (ros::NodeHandle &nh, std::string &service_name) | |
| ServiceCallerBase (XmlRpc::XmlRpcValue &controllers, ros::NodeHandle &nh, const std::string &service_name="") | |
| ~ServiceCallerBase () | |
Additional Inherited Members | |
Protected Member Functions inherited from rm_common::ServiceCallerBase< controller_manager_msgs::SwitchController > | |
| void | callingThread () |
Protected Attributes inherited from rm_common::ServiceCallerBase< controller_manager_msgs::SwitchController > | |
| ros::ServiceClient | client_ |
| int | fail_count_ |
| int | fail_limit_ |
| std::mutex | mutex_ |
| controller_manager_msgs::SwitchController | service_ |
| std::string | service_name_ |
| std::thread * | thread_ |
Definition at line 167 of file service_caller.h.
|
inlineexplicit |
Definition at line 170 of file service_caller.h.
|
inline |
Definition at line 184 of file service_caller.h.
|
inline |
Definition at line 176 of file service_caller.h.
|
inline |
Definition at line 180 of file service_caller.h.