#include <topic_handlers.h>
Public Member Functions | |
std::string | get_name () |
ROS_DEPRECATED 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 98 of file topic_handlers.h.
rosserial_server::Subscriber::Subscriber | ( | ros::NodeHandle & | nh, |
rosserial_msgs::TopicInfo & | topic_info, | ||
boost::function< void(std::vector< uint8_t > buffer)> | write_fn | ||
) | [inline] |
Definition at line 100 of file topic_handlers.h.
std::string rosserial_server::Subscriber::get_name | ( | ) | [inline] |
Definition at line 114 of file topic_handlers.h.
ROS_DEPRECATED std::string rosserial_server::Subscriber::get_topic | ( | ) | [inline] |
Definition at line 111 of file topic_handlers.h.
void rosserial_server::Subscriber::handle | ( | const boost::shared_ptr< topic_tools::ShapeShifter const > & | msg | ) | [inline, private] |
Definition at line 119 of file topic_handlers.h.
Definition at line 129 of file topic_handlers.h.
boost::function<void(std::vector<uint8_t> buffer)> rosserial_server::Subscriber::write_fn_ [private] |
Definition at line 130 of file topic_handlers.h.