#include <PublisheR.h>
Public Member Functions | |
const char * | getMessageDefinition () |
const char * | getMessageMD5 () |
ros::serialization::OStream * | getMessageStream () |
const char * | getMessageType () |
const char * | getTopic () |
void | publish () |
PublisheR (ros::NodeHandle *handle, const char *cTopic, const char *cMsgType, const char *cMsgDefinition, const char *cMsgMD5) | |
~PublisheR () | |
Private Attributes | |
ros::serialization::OStream * | m_osStream |
ros::Publisher * | m_rosPublisher |
std::string | m_strMsgDefinition |
std::string | m_strMsgMD5 |
std::string | m_strMsgType |
boost::shared_array< uint8_t > * | m_ui8Buffer |
unsigned int | m_uiBufferSize |
Definition at line 6 of file PublisheR.h.
PublisheR::PublisheR | ( | ros::NodeHandle * | handle, |
const char * | cTopic, | ||
const char * | cMsgType, | ||
const char * | cMsgDefinition, | ||
const char * | cMsgMD5 | ||
) | [inline] |
Definition at line 8 of file PublisheR.h.
PublisheR::~PublisheR | ( | ) | [inline] |
Definition at line 25 of file PublisheR.h.
const char* PublisheR::getMessageDefinition | ( | ) | [inline] |
Definition at line 32 of file PublisheR.h.
const char* PublisheR::getMessageMD5 | ( | ) | [inline] |
Definition at line 34 of file PublisheR.h.
ros::serialization::OStream* PublisheR::getMessageStream | ( | ) | [inline] |
Definition at line 52 of file PublisheR.h.
const char* PublisheR::getMessageType | ( | ) | [inline] |
Definition at line 30 of file PublisheR.h.
const char* PublisheR::getTopic | ( | ) | [inline] |
Definition at line 36 of file PublisheR.h.
void PublisheR::publish | ( | ) | [inline] |
Definition at line 39 of file PublisheR.h.
ros::serialization::OStream* PublisheR::m_osStream [private] |
Definition at line 70 of file PublisheR.h.
ros::Publisher* PublisheR::m_rosPublisher [private] |
Definition at line 63 of file PublisheR.h.
std::string PublisheR::m_strMsgDefinition [private] |
Definition at line 65 of file PublisheR.h.
std::string PublisheR::m_strMsgMD5 [private] |
Definition at line 66 of file PublisheR.h.
std::string PublisheR::m_strMsgType [private] |
Definition at line 64 of file PublisheR.h.
boost::shared_array<uint8_t>* PublisheR::m_ui8Buffer [private] |
Definition at line 68 of file PublisheR.h.
unsigned int PublisheR::m_uiBufferSize [private] |
Definition at line 69 of file PublisheR.h.