#include <string_relay.h>
Public Types | |
typedef boost::shared_ptr < StringRelay > | Ptr |
Public Member Functions | |
StringRelay () | |
Protected Member Functions | |
virtual void | callback (const std_msgs::String::ConstPtr &msg) |
virtual void | onInit () |
Initialize method. Subclass should call this method in its onInit method. | |
virtual void | subscribe () |
This method is called when publisher is subscribed by other nodes. Set up subscribers in this method. | |
virtual void | unsubscribe () |
This method is called when publisher is unsubscribed by other nodes. Shut down subscribers in this method. | |
Protected Attributes | |
ros::Publisher | pub_ |
ros::Subscriber | sub_ |
Definition at line 45 of file string_relay.h.
typedef boost::shared_ptr<StringRelay> jsk_topic_tools::StringRelay::Ptr |
Reimplemented from jsk_topic_tools::DiagnosticNodelet.
Definition at line 48 of file string_relay.h.
jsk_topic_tools::StringRelay::StringRelay | ( | ) | [inline] |
Definition at line 49 of file string_relay.h.
void jsk_topic_tools::StringRelay::callback | ( | const std_msgs::String::ConstPtr & | msg | ) | [protected, virtual] |
Definition at line 56 of file string_relay_nodelet.cpp.
void jsk_topic_tools::StringRelay::onInit | ( | ) | [protected, virtual] |
Initialize method. Subclass should call this method in its onInit method.
Reimplemented from jsk_topic_tools::DiagnosticNodelet.
Definition at line 40 of file string_relay_nodelet.cpp.
void jsk_topic_tools::StringRelay::subscribe | ( | ) | [protected, virtual] |
This method is called when publisher is subscribed by other nodes. Set up subscribers in this method.
Implements jsk_topic_tools::ConnectionBasedNodelet.
Definition at line 46 of file string_relay_nodelet.cpp.
void jsk_topic_tools::StringRelay::unsubscribe | ( | ) | [protected, virtual] |
This method is called when publisher is unsubscribed by other nodes. Shut down subscribers in this method.
Implements jsk_topic_tools::ConnectionBasedNodelet.
Definition at line 51 of file string_relay_nodelet.cpp.
ros::Publisher jsk_topic_tools::StringRelay::pub_ [protected] |
Definition at line 56 of file string_relay.h.
ros::Subscriber jsk_topic_tools::StringRelay::sub_ [protected] |
Definition at line 57 of file string_relay.h.