Protected Member Functions | Protected Attributes | List of all members
test_nodelet_topic_tools::NodeletLazyString Class Reference
Inheritance diagram for test_nodelet_topic_tools::NodeletLazyString:
Inheritance graph
[legend]

Protected Member Functions

virtual void callback (const std_msgs::String::ConstPtr &msg)
 
virtual void onInit ()
 
virtual void subscribe ()
 
virtual void unsubscribe ()
 
- Protected Member Functions inherited from nodelet_topic_tools::NodeletLazy
ros::Publisher advertise (ros::NodeHandle &nh, std::string topic, int queue_size, bool latch=false)
 
virtual void connectionCallback (const ros::SingleSubscriberPublisher &pub)
 
virtual void onInitPostProcess ()
 
virtual void warnNeverSubscribedCallback (const ros::WallTimerEvent &event)
 
- Protected Member Functions inherited from nodelet::Nodelet
ros::CallbackQueueInterfacegetMTCallbackQueue () const
 
ros::NodeHandlegetMTNodeHandle () const
 
ros::NodeHandlegetMTPrivateNodeHandle () const
 
const V_stringgetMyArgv () const
 
const std::string & getName () const
 
ros::NodeHandlegetNodeHandle () const
 
ros::NodeHandlegetPrivateNodeHandle () const
 
const M_stringgetRemappingArgs () const
 
ros::CallbackQueueInterfacegetSTCallbackQueue () const
 
std::string getSuffixedName (const std::string &suffix) const
 

Protected Attributes

ros::Publisher pub_
 
ros::Subscriber sub_
 
- Protected Attributes inherited from nodelet_topic_tools::NodeletLazy
boost::mutex connection_mutex_
 
ConnectionStatus connection_status_
 
bool ever_subscribed_
 
bool lazy_
 
boost::shared_ptr< ros::NodeHandlenh_
 
boost::shared_ptr< ros::NodeHandlepnh_
 
std::vector< ros::Publisherpublishers_
 
ros::WallTimer timer_ever_subscribed_
 
bool verbose_connection_
 

Additional Inherited Members

- Public Member Functions inherited from nodelet_topic_tools::NodeletLazy
 NodeletLazy ()
 
- Public Member Functions inherited from nodelet::Nodelet
void init (const std::string &name, const M_string &remapping_args, const V_string &my_argv, ros::CallbackQueueInterface *st_queue=NULL, ros::CallbackQueueInterface *mt_queue=NULL)
 
 Nodelet ()
 
virtual ~Nodelet ()
 

Detailed Description

Definition at line 44 of file string_nodelet_lazy.cpp.

Member Function Documentation

virtual void test_nodelet_topic_tools::NodeletLazyString::callback ( const std_msgs::String::ConstPtr &  msg)
inlineprotectedvirtual

Definition at line 65 of file string_nodelet_lazy.cpp.

virtual void test_nodelet_topic_tools::NodeletLazyString::onInit ( )
inlineprotectedvirtual

Reimplemented from nodelet_topic_tools::NodeletLazy.

Definition at line 48 of file string_nodelet_lazy.cpp.

virtual void test_nodelet_topic_tools::NodeletLazyString::subscribe ( )
inlineprotectedvirtual

Implements nodelet_topic_tools::NodeletLazy.

Definition at line 55 of file string_nodelet_lazy.cpp.

virtual void test_nodelet_topic_tools::NodeletLazyString::unsubscribe ( )
inlineprotectedvirtual

Implements nodelet_topic_tools::NodeletLazy.

Definition at line 60 of file string_nodelet_lazy.cpp.

Member Data Documentation

ros::Publisher test_nodelet_topic_tools::NodeletLazyString::pub_
protected

Definition at line 70 of file string_nodelet_lazy.cpp.

ros::Subscriber test_nodelet_topic_tools::NodeletLazyString::sub_
protected

Definition at line 71 of file string_nodelet_lazy.cpp.


The documentation for this class was generated from the following file:


test_nodelet_topic_tools
Author(s): Radu Bogdan Rusu, Tully Foote
autogenerated on Mon Feb 18 2019 03:26:52