Public Member Functions | Protected Member Functions | Protected 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 ()
 
bool subscribe (Subscriber_ &s)
 
void syncTime (uint8_t *data)
 

Protected Member Functions

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

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
 
bool param_recieved
 
Publisherpublishers [MAX_PUBLISHERS]
 
rosserial_msgs::RequestParamResponse req_param_resp
 
uint32_t rt_time
 
uint32_t sec_offset
 
uint32_t spin_timeout_
 
Subscriber_subscribers [MAX_SUBSCRIBERS]
 
int topic_
 

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

◆ NodeHandle_()

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

◆ advertise()

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.

◆ advertiseService()

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 447 of file node_handle.h.

◆ connected()

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.

◆ getHardware()

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.

◆ getParam() [1/4]

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 593 of file node_handle.h.

◆ getParam() [2/4]

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 611 of file node_handle.h.

◆ getParam() [3/4]

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 629 of file node_handle.h.

◆ getParam() [4/4]

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 647 of file node_handle.h.

◆ initNode() [1/2]

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.

◆ initNode() [2/2]

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.

◆ log()

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 
)
inlineprotected

Definition at line 535 of file node_handle.h.

◆ logdebug()

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 544 of file node_handle.h.

◆ logerror()

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 556 of file node_handle.h.

◆ logfatal()

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 560 of file node_handle.h.

◆ loginfo()

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 548 of file node_handle.h.

◆ logwarn()

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 552 of file node_handle.h.

◆ negotiateTopics()

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 463 of file node_handle.h.

◆ now()

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.

◆ publish()

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 494 of file node_handle.h.

◆ requestParam()

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 
)
inlineprotected

Definition at line 573 of file node_handle.h.

◆ requestSyncTime()

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.

◆ serviceClient()

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 456 of file node_handle.h.

◆ setNow()

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.

◆ setSpinTimeout()

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.

◆ spinOnce()

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.

◆ subscribe()

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 >::subscribe ( Subscriber_ s)
inline

Definition at line 431 of file node_handle.h.

◆ syncTime()

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

◆ bytes_

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.

◆ checksum_

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.

◆ configured_

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.

◆ hardware_

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.

◆ index_

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.

◆ last_msg_timeout_time

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.

◆ last_sync_receive_time

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.

◆ last_sync_time

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.

◆ message_in

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.

◆ message_out

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.

◆ mode_

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.

◆ nsec_offset

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.

◆ param_recieved

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
protected

Definition at line 570 of file node_handle.h.

◆ publishers

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.

◆ req_param_resp

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
protected

Definition at line 571 of file node_handle.h.

◆ rt_time

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.

◆ sec_offset

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.

◆ spin_timeout_

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.

◆ subscribers

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.

◆ topic_

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 Mon Feb 28 2022 23:35:23