Public Member Functions | Protected Attributes | Private Member Functions | Private Attributes | List of all members
ros::NodeHandle_< Hardware, MAX_SUBSCRIBERS, MAX_PUBLISHERS, INPUT_SIZE, OUTPUT_SIZE > Class Template Reference

#include <node_handle.h>

Inheritance diagram for ros::NodeHandle_< Hardware, MAX_SUBSCRIBERS, MAX_PUBLISHERS, INPUT_SIZE, OUTPUT_SIZE >:
Inheritance graph
[legend]

Public Member Functions

bool advertise (Publisher &p)
 
template<typename MReq , typename MRes , typename ObjT >
bool advertiseService (ServiceServer< MReq, MRes, ObjT > &srv)
 
virtual bool connected ()
 
Hardware * getHardware ()
 
bool getParam (const char *name, int *param, int length=1, int timeout=1000)
 
bool getParam (const char *name, float *param, int length=1, int timeout=1000)
 
bool getParam (const char *name, char **param, int length=1, int timeout=1000)
 
bool getParam (const char *name, bool *param, int length=1, int timeout=1000)
 
void initNode ()
 
void initNode (char *portName)
 
void logdebug (const char *msg)
 
void logerror (const char *msg)
 
void logfatal (const char *msg)
 
void loginfo (const char *msg)
 
void logwarn (const char *msg)
 
void negotiateTopics ()
 
 NodeHandle_ ()
 
Time now ()
 
virtual int publish (int id, const Msg *msg)
 
void requestSyncTime ()
 
template<typename MReq , typename MRes >
bool serviceClient (ServiceClient< MReq, MRes > &srv)
 
void setNow (Time &new_now)
 
void setSpinTimeout (const uint32_t &timeout)
 Sets the maximum time in millisconds that spinOnce() can work. This will not effect the processing of the buffer, as spinOnce processes one byte at a time. It simply sets the maximum time that one call can process for. You can choose to clear the buffer if that is beneficial if SPIN_TIMEOUT is returned from spinOnce(). More...
 
virtual int spinOnce ()
 
template<typename SubscriberT >
bool subscribe (SubscriberT &s)
 
void syncTime (uint8_t *data)
 

Protected Attributes

int bytes_
 
int checksum_
 
bool configured_
 
Hardware hardware_
 
int index_
 
uint32_t last_msg_timeout_time
 
uint32_t last_sync_receive_time
 
uint32_t last_sync_time
 
uint8_t message_in [INPUT_SIZE]
 
uint8_t message_out [OUTPUT_SIZE]
 
int mode_
 
uint32_t nsec_offset
 
Publisherpublishers [MAX_PUBLISHERS]
 
uint32_t rt_time
 
uint32_t sec_offset
 
uint32_t spin_timeout_
 
Subscriber_subscribers [MAX_SUBSCRIBERS]
 
int topic_
 

Private Member Functions

void log (char byte, const char *msg)
 
bool requestParam (const char *name, int time_out=1000)
 

Private Attributes

bool param_recieved
 
rosserial_msgs::RequestParamResponse req_param_resp
 

Detailed Description

template<class Hardware, int MAX_SUBSCRIBERS = 25, int MAX_PUBLISHERS = 25, int INPUT_SIZE = 512, int OUTPUT_SIZE = 512>
class ros::NodeHandle_< Hardware, MAX_SUBSCRIBERS, MAX_PUBLISHERS, INPUT_SIZE, OUTPUT_SIZE >

Definition at line 104 of file node_handle.h.

Constructor & Destructor Documentation

template<class Hardware , int MAX_SUBSCRIBERS = 25, int MAX_PUBLISHERS = 25, int INPUT_SIZE = 512, int OUTPUT_SIZE = 512>
ros::NodeHandle_< Hardware, MAX_SUBSCRIBERS, MAX_PUBLISHERS, INPUT_SIZE, OUTPUT_SIZE >::NodeHandle_ ( )
inline

Definition at line 128 of file node_handle.h.

Member Function Documentation

template<class Hardware , int MAX_SUBSCRIBERS = 25, int MAX_PUBLISHERS = 25, int INPUT_SIZE = 512, int OUTPUT_SIZE = 512>
bool ros::NodeHandle_< Hardware, MAX_SUBSCRIBERS, MAX_PUBLISHERS, INPUT_SIZE, OUTPUT_SIZE >::advertise ( Publisher p)
inline

Definition at line 415 of file node_handle.h.

template<class Hardware , int MAX_SUBSCRIBERS = 25, int MAX_PUBLISHERS = 25, int INPUT_SIZE = 512, int OUTPUT_SIZE = 512>
template<typename MReq , typename MRes , typename ObjT >
bool ros::NodeHandle_< Hardware, MAX_SUBSCRIBERS, MAX_PUBLISHERS, INPUT_SIZE, OUTPUT_SIZE >::advertiseService ( ServiceServer< MReq, MRes, ObjT > &  srv)
inline

Definition at line 448 of file node_handle.h.

template<class Hardware , int MAX_SUBSCRIBERS = 25, int MAX_PUBLISHERS = 25, int INPUT_SIZE = 512, int OUTPUT_SIZE = 512>
virtual bool ros::NodeHandle_< Hardware, MAX_SUBSCRIBERS, MAX_PUBLISHERS, INPUT_SIZE, OUTPUT_SIZE >::connected ( )
inlinevirtual

Implements ros::NodeHandleBase_.

Definition at line 363 of file node_handle.h.

template<class Hardware , int MAX_SUBSCRIBERS = 25, int MAX_PUBLISHERS = 25, int INPUT_SIZE = 512, int OUTPUT_SIZE = 512>
Hardware* ros::NodeHandle_< Hardware, MAX_SUBSCRIBERS, MAX_PUBLISHERS, INPUT_SIZE, OUTPUT_SIZE >::getHardware ( )
inline

Definition at line 153 of file node_handle.h.

template<class Hardware , int MAX_SUBSCRIBERS = 25, int MAX_PUBLISHERS = 25, int INPUT_SIZE = 512, int OUTPUT_SIZE = 512>
bool ros::NodeHandle_< Hardware, MAX_SUBSCRIBERS, MAX_PUBLISHERS, INPUT_SIZE, OUTPUT_SIZE >::getParam ( const char *  name,
int *  param,
int  length = 1,
int  timeout = 1000 
)
inline

Definition at line 610 of file node_handle.h.

template<class Hardware , int MAX_SUBSCRIBERS = 25, int MAX_PUBLISHERS = 25, int INPUT_SIZE = 512, int OUTPUT_SIZE = 512>
bool ros::NodeHandle_< Hardware, MAX_SUBSCRIBERS, MAX_PUBLISHERS, INPUT_SIZE, OUTPUT_SIZE >::getParam ( const char *  name,
float *  param,
int  length = 1,
int  timeout = 1000 
)
inline

Definition at line 628 of file node_handle.h.

template<class Hardware , int MAX_SUBSCRIBERS = 25, int MAX_PUBLISHERS = 25, int INPUT_SIZE = 512, int OUTPUT_SIZE = 512>
bool ros::NodeHandle_< Hardware, MAX_SUBSCRIBERS, MAX_PUBLISHERS, INPUT_SIZE, OUTPUT_SIZE >::getParam ( const char *  name,
char **  param,
int  length = 1,
int  timeout = 1000 
)
inline

Definition at line 646 of file node_handle.h.

template<class Hardware , int MAX_SUBSCRIBERS = 25, int MAX_PUBLISHERS = 25, int INPUT_SIZE = 512, int OUTPUT_SIZE = 512>
bool ros::NodeHandle_< Hardware, MAX_SUBSCRIBERS, MAX_PUBLISHERS, INPUT_SIZE, OUTPUT_SIZE >::getParam ( const char *  name,
bool *  param,
int  length = 1,
int  timeout = 1000 
)
inline

Definition at line 664 of file node_handle.h.

template<class Hardware , int MAX_SUBSCRIBERS = 25, int MAX_PUBLISHERS = 25, int INPUT_SIZE = 512, int OUTPUT_SIZE = 512>
void ros::NodeHandle_< Hardware, MAX_SUBSCRIBERS, MAX_PUBLISHERS, INPUT_SIZE, OUTPUT_SIZE >::initNode ( )
inline

Definition at line 159 of file node_handle.h.

template<class Hardware , int MAX_SUBSCRIBERS = 25, int MAX_PUBLISHERS = 25, int INPUT_SIZE = 512, int OUTPUT_SIZE = 512>
void ros::NodeHandle_< Hardware, MAX_SUBSCRIBERS, MAX_PUBLISHERS, INPUT_SIZE, OUTPUT_SIZE >::initNode ( char *  portName)
inline

Definition at line 169 of file node_handle.h.

template<class Hardware , int MAX_SUBSCRIBERS = 25, int MAX_PUBLISHERS = 25, int INPUT_SIZE = 512, int OUTPUT_SIZE = 512>
void ros::NodeHandle_< Hardware, MAX_SUBSCRIBERS, MAX_PUBLISHERS, INPUT_SIZE, OUTPUT_SIZE >::log ( char  byte,
const char *  msg 
)
inlineprivate

Definition at line 552 of file node_handle.h.

template<class Hardware , int MAX_SUBSCRIBERS = 25, int MAX_PUBLISHERS = 25, int INPUT_SIZE = 512, int OUTPUT_SIZE = 512>
void ros::NodeHandle_< Hardware, MAX_SUBSCRIBERS, MAX_PUBLISHERS, INPUT_SIZE, OUTPUT_SIZE >::logdebug ( const char *  msg)
inline

Definition at line 561 of file node_handle.h.

template<class Hardware , int MAX_SUBSCRIBERS = 25, int MAX_PUBLISHERS = 25, int INPUT_SIZE = 512, int OUTPUT_SIZE = 512>
void ros::NodeHandle_< Hardware, MAX_SUBSCRIBERS, MAX_PUBLISHERS, INPUT_SIZE, OUTPUT_SIZE >::logerror ( const char *  msg)
inline

Definition at line 573 of file node_handle.h.

template<class Hardware , int MAX_SUBSCRIBERS = 25, int MAX_PUBLISHERS = 25, int INPUT_SIZE = 512, int OUTPUT_SIZE = 512>
void ros::NodeHandle_< Hardware, MAX_SUBSCRIBERS, MAX_PUBLISHERS, INPUT_SIZE, OUTPUT_SIZE >::logfatal ( const char *  msg)
inline

Definition at line 577 of file node_handle.h.

template<class Hardware , int MAX_SUBSCRIBERS = 25, int MAX_PUBLISHERS = 25, int INPUT_SIZE = 512, int OUTPUT_SIZE = 512>
void ros::NodeHandle_< Hardware, MAX_SUBSCRIBERS, MAX_PUBLISHERS, INPUT_SIZE, OUTPUT_SIZE >::loginfo ( const char *  msg)
inline

Definition at line 565 of file node_handle.h.

template<class Hardware , int MAX_SUBSCRIBERS = 25, int MAX_PUBLISHERS = 25, int INPUT_SIZE = 512, int OUTPUT_SIZE = 512>
void ros::NodeHandle_< Hardware, MAX_SUBSCRIBERS, MAX_PUBLISHERS, INPUT_SIZE, OUTPUT_SIZE >::logwarn ( const char *  msg)
inline

Definition at line 569 of file node_handle.h.

template<class Hardware , int MAX_SUBSCRIBERS = 25, int MAX_PUBLISHERS = 25, int INPUT_SIZE = 512, int OUTPUT_SIZE = 512>
void ros::NodeHandle_< Hardware, MAX_SUBSCRIBERS, MAX_PUBLISHERS, INPUT_SIZE, OUTPUT_SIZE >::negotiateTopics ( )
inline

Definition at line 480 of file node_handle.h.

template<class Hardware , int MAX_SUBSCRIBERS = 25, int MAX_PUBLISHERS = 25, int INPUT_SIZE = 512, int OUTPUT_SIZE = 512>
Time ros::NodeHandle_< Hardware, MAX_SUBSCRIBERS, MAX_PUBLISHERS, INPUT_SIZE, OUTPUT_SIZE >::now ( )
inline

Definition at line 392 of file node_handle.h.

template<class Hardware , int MAX_SUBSCRIBERS = 25, int MAX_PUBLISHERS = 25, int INPUT_SIZE = 512, int OUTPUT_SIZE = 512>
virtual int ros::NodeHandle_< Hardware, MAX_SUBSCRIBERS, MAX_PUBLISHERS, INPUT_SIZE, OUTPUT_SIZE >::publish ( int  id,
const Msg msg 
)
inlinevirtual

Implements ros::NodeHandleBase_.

Definition at line 511 of file node_handle.h.

template<class Hardware , int MAX_SUBSCRIBERS = 25, int MAX_PUBLISHERS = 25, int INPUT_SIZE = 512, int OUTPUT_SIZE = 512>
bool ros::NodeHandle_< Hardware, MAX_SUBSCRIBERS, MAX_PUBLISHERS, INPUT_SIZE, OUTPUT_SIZE >::requestParam ( const char *  name,
int  time_out = 1000 
)
inlineprivate

Definition at line 590 of file node_handle.h.

template<class Hardware , int MAX_SUBSCRIBERS = 25, int MAX_PUBLISHERS = 25, int INPUT_SIZE = 512, int OUTPUT_SIZE = 512>
void ros::NodeHandle_< Hardware, MAX_SUBSCRIBERS, MAX_PUBLISHERS, INPUT_SIZE, OUTPUT_SIZE >::requestSyncTime ( )
inline

Definition at line 372 of file node_handle.h.

template<class Hardware , int MAX_SUBSCRIBERS = 25, int MAX_PUBLISHERS = 25, int INPUT_SIZE = 512, int OUTPUT_SIZE = 512>
template<typename MReq , typename MRes >
bool ros::NodeHandle_< Hardware, MAX_SUBSCRIBERS, MAX_PUBLISHERS, INPUT_SIZE, OUTPUT_SIZE >::serviceClient ( ServiceClient< MReq, MRes > &  srv)
inline

Definition at line 465 of file node_handle.h.

template<class Hardware , int MAX_SUBSCRIBERS = 25, int MAX_PUBLISHERS = 25, int INPUT_SIZE = 512, int OUTPUT_SIZE = 512>
void ros::NodeHandle_< Hardware, MAX_SUBSCRIBERS, MAX_PUBLISHERS, INPUT_SIZE, OUTPUT_SIZE >::setNow ( Time new_now)
inline

Definition at line 402 of file node_handle.h.

template<class Hardware , int MAX_SUBSCRIBERS = 25, int MAX_PUBLISHERS = 25, int INPUT_SIZE = 512, int OUTPUT_SIZE = 512>
void ros::NodeHandle_< Hardware, MAX_SUBSCRIBERS, MAX_PUBLISHERS, INPUT_SIZE, OUTPUT_SIZE >::setSpinTimeout ( const uint32_t &  timeout)
inline

Sets the maximum time in millisconds that spinOnce() can work. This will not effect the processing of the buffer, as spinOnce processes one byte at a time. It simply sets the maximum time that one call can process for. You can choose to clear the buffer if that is beneficial if SPIN_TIMEOUT is returned from spinOnce().

Parameters
timeoutThe timeout in milliseconds that spinOnce will function.

Definition at line 186 of file node_handle.h.

template<class Hardware , int MAX_SUBSCRIBERS = 25, int MAX_PUBLISHERS = 25, int INPUT_SIZE = 512, int OUTPUT_SIZE = 512>
virtual int ros::NodeHandle_< Hardware, MAX_SUBSCRIBERS, MAX_PUBLISHERS, INPUT_SIZE, OUTPUT_SIZE >::spinOnce ( )
inlinevirtual

Implements ros::NodeHandleBase_.

Definition at line 212 of file node_handle.h.

template<class Hardware , int MAX_SUBSCRIBERS = 25, int MAX_PUBLISHERS = 25, int INPUT_SIZE = 512, int OUTPUT_SIZE = 512>
template<typename SubscriberT >
bool ros::NodeHandle_< Hardware, MAX_SUBSCRIBERS, MAX_PUBLISHERS, INPUT_SIZE, OUTPUT_SIZE >::subscribe ( SubscriberT &  s)
inline

Definition at line 432 of file node_handle.h.

template<class Hardware , int MAX_SUBSCRIBERS = 25, int MAX_PUBLISHERS = 25, int INPUT_SIZE = 512, int OUTPUT_SIZE = 512>
void ros::NodeHandle_< Hardware, MAX_SUBSCRIBERS, MAX_PUBLISHERS, INPUT_SIZE, OUTPUT_SIZE >::syncTime ( uint8_t *  data)
inline

Definition at line 379 of file node_handle.h.

Member Data Documentation

template<class Hardware , int MAX_SUBSCRIBERS = 25, int MAX_PUBLISHERS = 25, int INPUT_SIZE = 512, int OUTPUT_SIZE = 512>
int ros::NodeHandle_< Hardware, MAX_SUBSCRIBERS, MAX_PUBLISHERS, INPUT_SIZE, OUTPUT_SIZE >::bytes_
protected

Definition at line 194 of file node_handle.h.

template<class Hardware , int MAX_SUBSCRIBERS = 25, int MAX_PUBLISHERS = 25, int INPUT_SIZE = 512, int OUTPUT_SIZE = 512>
int ros::NodeHandle_< Hardware, MAX_SUBSCRIBERS, MAX_PUBLISHERS, INPUT_SIZE, OUTPUT_SIZE >::checksum_
protected

Definition at line 197 of file node_handle.h.

template<class Hardware , int MAX_SUBSCRIBERS = 25, int MAX_PUBLISHERS = 25, int INPUT_SIZE = 512, int OUTPUT_SIZE = 512>
bool ros::NodeHandle_< Hardware, MAX_SUBSCRIBERS, MAX_PUBLISHERS, INPUT_SIZE, OUTPUT_SIZE >::configured_
protected

Definition at line 199 of file node_handle.h.

template<class Hardware , int MAX_SUBSCRIBERS = 25, int MAX_PUBLISHERS = 25, int INPUT_SIZE = 512, int OUTPUT_SIZE = 512>
Hardware ros::NodeHandle_< Hardware, MAX_SUBSCRIBERS, MAX_PUBLISHERS, INPUT_SIZE, OUTPUT_SIZE >::hardware_
protected

Definition at line 107 of file node_handle.h.

template<class Hardware , int MAX_SUBSCRIBERS = 25, int MAX_PUBLISHERS = 25, int INPUT_SIZE = 512, int OUTPUT_SIZE = 512>
int ros::NodeHandle_< Hardware, MAX_SUBSCRIBERS, MAX_PUBLISHERS, INPUT_SIZE, OUTPUT_SIZE >::index_
protected

Definition at line 196 of file node_handle.h.

template<class Hardware , int MAX_SUBSCRIBERS = 25, int MAX_PUBLISHERS = 25, int INPUT_SIZE = 512, int OUTPUT_SIZE = 512>
uint32_t ros::NodeHandle_< Hardware, MAX_SUBSCRIBERS, MAX_PUBLISHERS, INPUT_SIZE, OUTPUT_SIZE >::last_msg_timeout_time
protected

Definition at line 204 of file node_handle.h.

template<class Hardware , int MAX_SUBSCRIBERS = 25, int MAX_PUBLISHERS = 25, int INPUT_SIZE = 512, int OUTPUT_SIZE = 512>
uint32_t ros::NodeHandle_< Hardware, MAX_SUBSCRIBERS, MAX_PUBLISHERS, INPUT_SIZE, OUTPUT_SIZE >::last_sync_receive_time
protected

Definition at line 203 of file node_handle.h.

template<class Hardware , int MAX_SUBSCRIBERS = 25, int MAX_PUBLISHERS = 25, int INPUT_SIZE = 512, int OUTPUT_SIZE = 512>
uint32_t ros::NodeHandle_< Hardware, MAX_SUBSCRIBERS, MAX_PUBLISHERS, INPUT_SIZE, OUTPUT_SIZE >::last_sync_time
protected

Definition at line 202 of file node_handle.h.

template<class Hardware , int MAX_SUBSCRIBERS = 25, int MAX_PUBLISHERS = 25, int INPUT_SIZE = 512, int OUTPUT_SIZE = 512>
uint8_t ros::NodeHandle_< Hardware, MAX_SUBSCRIBERS, MAX_PUBLISHERS, INPUT_SIZE, OUTPUT_SIZE >::message_in[INPUT_SIZE]
protected

Definition at line 118 of file node_handle.h.

template<class Hardware , int MAX_SUBSCRIBERS = 25, int MAX_PUBLISHERS = 25, int INPUT_SIZE = 512, int OUTPUT_SIZE = 512>
uint8_t ros::NodeHandle_< Hardware, MAX_SUBSCRIBERS, MAX_PUBLISHERS, INPUT_SIZE, OUTPUT_SIZE >::message_out[OUTPUT_SIZE]
protected

Definition at line 119 of file node_handle.h.

template<class Hardware , int MAX_SUBSCRIBERS = 25, int MAX_PUBLISHERS = 25, int INPUT_SIZE = 512, int OUTPUT_SIZE = 512>
int ros::NodeHandle_< Hardware, MAX_SUBSCRIBERS, MAX_PUBLISHERS, INPUT_SIZE, OUTPUT_SIZE >::mode_
protected

Definition at line 193 of file node_handle.h.

template<class Hardware , int MAX_SUBSCRIBERS = 25, int MAX_PUBLISHERS = 25, int INPUT_SIZE = 512, int OUTPUT_SIZE = 512>
uint32_t ros::NodeHandle_< Hardware, MAX_SUBSCRIBERS, MAX_PUBLISHERS, INPUT_SIZE, OUTPUT_SIZE >::nsec_offset
protected

Definition at line 113 of file node_handle.h.

template<class Hardware , int MAX_SUBSCRIBERS = 25, int MAX_PUBLISHERS = 25, int INPUT_SIZE = 512, int OUTPUT_SIZE = 512>
bool ros::NodeHandle_< Hardware, MAX_SUBSCRIBERS, MAX_PUBLISHERS, INPUT_SIZE, OUTPUT_SIZE >::param_recieved
private

Definition at line 587 of file node_handle.h.

template<class Hardware , int MAX_SUBSCRIBERS = 25, int MAX_PUBLISHERS = 25, int INPUT_SIZE = 512, int OUTPUT_SIZE = 512>
Publisher* ros::NodeHandle_< Hardware, MAX_SUBSCRIBERS, MAX_PUBLISHERS, INPUT_SIZE, OUTPUT_SIZE >::publishers[MAX_PUBLISHERS]
protected

Definition at line 121 of file node_handle.h.

template<class Hardware , int MAX_SUBSCRIBERS = 25, int MAX_PUBLISHERS = 25, int INPUT_SIZE = 512, int OUTPUT_SIZE = 512>
rosserial_msgs::RequestParamResponse ros::NodeHandle_< Hardware, MAX_SUBSCRIBERS, MAX_PUBLISHERS, INPUT_SIZE, OUTPUT_SIZE >::req_param_resp
private

Definition at line 588 of file node_handle.h.

template<class Hardware , int MAX_SUBSCRIBERS = 25, int MAX_PUBLISHERS = 25, int INPUT_SIZE = 512, int OUTPUT_SIZE = 512>
uint32_t ros::NodeHandle_< Hardware, MAX_SUBSCRIBERS, MAX_PUBLISHERS, INPUT_SIZE, OUTPUT_SIZE >::rt_time
protected

Definition at line 110 of file node_handle.h.

template<class Hardware , int MAX_SUBSCRIBERS = 25, int MAX_PUBLISHERS = 25, int INPUT_SIZE = 512, int OUTPUT_SIZE = 512>
uint32_t ros::NodeHandle_< Hardware, MAX_SUBSCRIBERS, MAX_PUBLISHERS, INPUT_SIZE, OUTPUT_SIZE >::sec_offset
protected

Definition at line 113 of file node_handle.h.

template<class Hardware , int MAX_SUBSCRIBERS = 25, int MAX_PUBLISHERS = 25, int INPUT_SIZE = 512, int OUTPUT_SIZE = 512>
uint32_t ros::NodeHandle_< Hardware, MAX_SUBSCRIBERS, MAX_PUBLISHERS, INPUT_SIZE, OUTPUT_SIZE >::spin_timeout_
protected

Definition at line 116 of file node_handle.h.

template<class Hardware , int MAX_SUBSCRIBERS = 25, int MAX_PUBLISHERS = 25, int INPUT_SIZE = 512, int OUTPUT_SIZE = 512>
Subscriber_* ros::NodeHandle_< Hardware, MAX_SUBSCRIBERS, MAX_PUBLISHERS, INPUT_SIZE, OUTPUT_SIZE >::subscribers[MAX_SUBSCRIBERS]
protected

Definition at line 122 of file node_handle.h.

template<class Hardware , int MAX_SUBSCRIBERS = 25, int MAX_PUBLISHERS = 25, int INPUT_SIZE = 512, int OUTPUT_SIZE = 512>
int ros::NodeHandle_< Hardware, MAX_SUBSCRIBERS, MAX_PUBLISHERS, INPUT_SIZE, OUTPUT_SIZE >::topic_
protected

Definition at line 195 of file node_handle.h.


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


rosserial_client
Author(s): Michael Ferguson, Adam Stambler
autogenerated on Fri Jun 7 2019 22:02:43