#include <shm_topic.hpp>
Public Member Functions | |
| template<class M > | |
| Publisher | advertise (const std::string &topic, uint32_t queue_size, uint32_t mem_size) |
| template<class M > | |
| Subscriber< M > | subscribe (const std::string &topic, uint32_t queue_size, void(*fp)(const boost::shared_ptr< const M > &)) |
| Topic (const ros::NodeHandle &parent) | |
| ~Topic () | |
Private Attributes | |
| ros::NodeHandle | nh_ |
Definition at line 11 of file shm_topic.hpp.
| shm_transport::Topic::Topic | ( | const ros::NodeHandle & | parent | ) | [inline] |
Definition at line 14 of file shm_topic.hpp.
| shm_transport::Topic::~Topic | ( | ) | [inline] |
Definition at line 18 of file shm_topic.hpp.
| Publisher shm_transport::Topic::advertise | ( | const std::string & | topic, |
| uint32_t | queue_size, | ||
| uint32_t | mem_size | ||
| ) | [inline] |
Definition at line 22 of file shm_topic.hpp.
| Subscriber< M > shm_transport::Topic::subscribe | ( | const std::string & | topic, |
| uint32_t | queue_size, | ||
| void(*)(const boost::shared_ptr< const M > &) | fp | ||
| ) | [inline] |
Definition at line 28 of file shm_topic.hpp.
ros::NodeHandle shm_transport::Topic::nh_ [private] |
Definition at line 35 of file shm_topic.hpp.