#include <topic_handlers.h>
Public Member Functions | |
| std::string | get_topic () |
| Subscriber (ros::NodeHandle &nh, rosserial_msgs::TopicInfo &topic_info, boost::function< void(std::vector< uint8_t > buffer)> write_fn) | |
Private Member Functions | |
| void | handle (const boost::shared_ptr< topic_tools::ShapeShifter const > &msg) |
Private Attributes | |
| ros::Subscriber | subscriber_ |
| boost::function< void(std::vector < uint8_t > buffer)> | write_fn_ |
Definition at line 88 of file topic_handlers.h.
| Subscriber::Subscriber | ( | ros::NodeHandle & | nh, |
| rosserial_msgs::TopicInfo & | topic_info, | ||
| boost::function< void(std::vector< uint8_t > buffer)> | write_fn | ||
| ) | [inline] |
Definition at line 90 of file topic_handlers.h.
| std::string Subscriber::get_topic | ( | ) | [inline] |
Definition at line 101 of file topic_handlers.h.
| void Subscriber::handle | ( | const boost::shared_ptr< topic_tools::ShapeShifter const > & | msg | ) | [inline, private] |
Definition at line 106 of file topic_handlers.h.
ros::Subscriber Subscriber::subscriber_ [private] |
Definition at line 116 of file topic_handlers.h.
boost::function<void(std::vector<uint8_t> buffer)> Subscriber::write_fn_ [private] |
Definition at line 117 of file topic_handlers.h.