Public Member Functions | Public Attributes
Listener Class Reference

List of all members.

Public Member Functions

void callback (const std_msgs::String::ConstPtr &msg)
void chatter1 (const std_msgs::String::ConstPtr &msg)
void chatter1 (const std_msgs::String::ConstPtr &msg)
void chatter1 (const std_msgs::String::ConstPtr &msg)
void chatter2 (const std_msgs::String::ConstPtr &msg)
void chatter2 (const std_msgs::String::ConstPtr &msg)
void chatter2 (const std_msgs::String::ConstPtr &msg)
void chatter3 (const std_msgs::String::ConstPtr &msg)
void chatter3 (const std_msgs::String::ConstPtr &msg)
void chatter3 (const std_msgs::String::ConstPtr &msg)
void chatterCallback (const std_msgs::String::ConstPtr &msg, std::string user_string)
void init ()
 Listener (const ros::NodeHandle &node_handle)

Public Attributes

ros::NodeHandle node_handle_
ros::V_Subscriber subs_

Detailed Description

This tutorial demonstrates subscribing to a topic using a class method as the callback.

This tutorial demonstrates simple receipt of messages over the ROS system, with multiple callbacks for the same topic. See the "listener" tutorial for more information.

This tutorial demonstrates a simple use of Boost.Bind to pass arbitrary data into a subscription callback. For more information on Boost.Bind see the documentation on the boost homepage, http://www.boost.org/

Definition at line 40 of file listener_async_spin.cpp.


Constructor & Destructor Documentation

Listener::Listener ( const ros::NodeHandle node_handle) [inline]

Definition at line 44 of file listener_with_userdata.cpp.


Member Function Documentation

void Listener::callback ( const std_msgs::String::ConstPtr &  msg)

Definition at line 43 of file listener_class.cpp.

void Listener::chatter1 ( const std_msgs::String::ConstPtr &  msg) [inline]

Definition at line 40 of file listener_multiple.cpp.

void Listener::chatter1 ( const std_msgs::String::ConstPtr &  msg) [inline]

Definition at line 43 of file listener_threaded_spin.cpp.

void Listener::chatter1 ( const std_msgs::String::ConstPtr &  msg) [inline]

Definition at line 43 of file listener_async_spin.cpp.

void Listener::chatter2 ( const std_msgs::String::ConstPtr &  msg) [inline]

Definition at line 41 of file listener_multiple.cpp.

void Listener::chatter2 ( const std_msgs::String::ConstPtr &  msg) [inline]

Definition at line 48 of file listener_async_spin.cpp.

void Listener::chatter2 ( const std_msgs::String::ConstPtr &  msg) [inline]

Definition at line 48 of file listener_threaded_spin.cpp.

void Listener::chatter3 ( const std_msgs::String::ConstPtr &  msg) [inline]

Definition at line 42 of file listener_multiple.cpp.

void Listener::chatter3 ( const std_msgs::String::ConstPtr &  msg) [inline]

Definition at line 53 of file listener_threaded_spin.cpp.

void Listener::chatter3 ( const std_msgs::String::ConstPtr &  msg) [inline]

Definition at line 53 of file listener_async_spin.cpp.

void Listener::chatterCallback ( const std_msgs::String::ConstPtr &  msg,
std::string  user_string 
) [inline]

Definition at line 56 of file listener_with_userdata.cpp.

void Listener::init ( ) [inline]

Definition at line 49 of file listener_with_userdata.cpp.


Member Data Documentation

Definition at line 41 of file listener_with_userdata.cpp.

Definition at line 42 of file listener_with_userdata.cpp.


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


roscpp_tutorials
Author(s): Morgan Quigley
autogenerated on Sun Mar 20 2016 04:51:17