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 () override
 
Hardware * getHardware ()
 
bool getParam (const char *name, bool *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, float *param, int length=1, int timeout=1000)
 
bool getParam (const char *name, int *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 ()
 
Time now ()
 
virtual int publish (int id, const Msg *msg) override
 
void requestSyncTime ()
 
template<typename MReq , typename MRes >
bool serviceClient (ServiceClient< MReq, MRes > &srv)
 
void setNow (const 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 () override
 
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_ {0}
 
int checksum_ {0}
 
bool configured_ {false}
 
Hardware hardware_ {}
 
int index_ {0}
 
uint32_t last_msg_timeout_time {0}
 
uint32_t last_sync_receive_time {0}
 
uint32_t last_sync_time {0}
 
uint8_t message_in [INPUT_SIZE] = {0}
 
uint8_t message_out [OUTPUT_SIZE] = {0}
 
int mode_ {0}
 
uint32_t nsec_offset {0}
 
bool param_received {false}
 
Publisherpublishers [MAX_PUBLISHERS] = {nullptr}
 
rosserial_msgs::RequestParamResponse req_param_resp {}
 
uint32_t rt_time {0}
 
uint32_t sec_offset {0}
 
uint32_t spin_timeout_ {0}
 
Subscriber_subscribers [MAX_SUBSCRIBERS] {nullptr}
 
int topic_ {0}
 

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 106 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 397 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 429 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 ( )
inlineoverridevirtual

Implements ros::NodeHandleBase_.

Definition at line 345 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 130 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,
bool *  param,
int  length = 1,
int  timeout = 1000 
)
inline

Definition at line 629 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,
char **  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,
float *  param,
int  length = 1,
int  timeout = 1000 
)
inline

Definition at line 593 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,
int *  param,
int  length = 1,
int  timeout = 1000 
)
inline

Definition at line 575 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 136 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 146 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 517 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 526 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 538 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 542 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 530 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 534 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 445 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 374 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 
)
inlineoverridevirtual

Implements ros::NodeHandleBase_.

Definition at line 476 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 555 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 354 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 438 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 ( const Time new_now)
inline

Definition at line 384 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 163 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 ( )
inlineoverridevirtual

Implements ros::NodeHandleBase_.

Definition at line 189 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 413 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 361 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_ {0}
protected

Definition at line 171 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_ {0}
protected

Definition at line 174 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_ {false}
protected

Definition at line 176 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 109 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_ {0}
protected

Definition at line 173 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 {0}
protected

Definition at line 181 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 {0}
protected

Definition at line 180 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 {0}
protected

Definition at line 179 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] = {0}
protected

Definition at line 120 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] = {0}
protected

Definition at line 121 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_ {0}
protected

Definition at line 170 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 {0}
protected

Definition at line 115 of file node_handle.h.

◆ param_received

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_received {false}
protected

Definition at line 552 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] = {nullptr}
protected

Definition at line 123 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 553 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 {0}
protected

Definition at line 112 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 {0}
protected

Definition at line 115 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_ {0}
protected

Definition at line 118 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] {nullptr}
protected

Definition at line 124 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_ {0}
protected

Definition at line 172 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 Wed Mar 2 2022 00:58:01