#include <topic_service_client.h>
Public Types | |
typedef boost::mutex | request_lock_ |
Public Member Functions | |
bool | call (MReq &request, MRes &response) |
void | initialize (ros::NodeHandle &nh, const std::string &service, const std::string &client_name="") |
TopicServiceClientImpl () | |
Public Attributes | |
std::string | name_ |
ros::Publisher | request_pub_ |
boost::shared_ptr< MRes > | response_ |
ros::Subscriber | response_sub_ |
int | sequence_ |
std::string | service_name_ |
ros::Duration | timeout_ |
Private Member Functions | |
void | response_callback (const boost::shared_ptr< MRes > &message) |
Definition at line 44 of file topic_service_client.h.
typedef boost::mutex swri::TopicServiceClientImpl< MReq, MRes >::request_lock_ |
Definition at line 48 of file topic_service_client.h.
|
inline |
Definition at line 59 of file topic_service_client.h.
|
inline |
Definition at line 80 of file topic_service_client.h.
|
inline |
Definition at line 64 of file topic_service_client.h.
|
inlineprivate |
Definition at line 123 of file topic_service_client.h.
std::string swri::TopicServiceClientImpl< MReq, MRes >::name_ |
Definition at line 54 of file topic_service_client.h.
ros::Publisher swri::TopicServiceClientImpl< MReq, MRes >::request_pub_ |
Definition at line 50 of file topic_service_client.h.
boost::shared_ptr<MRes> swri::TopicServiceClientImpl< MReq, MRes >::response_ |
Definition at line 51 of file topic_service_client.h.
ros::Subscriber swri::TopicServiceClientImpl< MReq, MRes >::response_sub_ |
Definition at line 49 of file topic_service_client.h.
int swri::TopicServiceClientImpl< MReq, MRes >::sequence_ |
Definition at line 57 of file topic_service_client.h.
std::string swri::TopicServiceClientImpl< MReq, MRes >::service_name_ |
Definition at line 55 of file topic_service_client.h.
ros::Duration swri::TopicServiceClientImpl< MReq, MRes >::timeout_ |
Definition at line 53 of file topic_service_client.h.