Classes | Functions | Variables
listener_threaded_spin.cpp File Reference
#include "ros/ros.h"
#include "std_msgs/String.h"
#include <boost/thread.hpp>
Include dependency graph for listener_threaded_spin.cpp:

Go to the source code of this file.

Classes

class  Listener
 

Functions

void chatter4 (const std_msgs::String::ConstPtr &msg)
 
int main (int argc, char **argv)
 

Variables

ros::Duration d (0.01)
 

Function Documentation

void chatter4 ( const std_msgs::String::ConstPtr &  msg)

Definition at line 60 of file listener_threaded_spin.cpp.

int main ( int  argc,
char **  argv 
)

The MultiThreadedSpinner object allows you to specify a number of threads to use to call callbacks. If no explicit # is specified, it will use the # of hardware threads available on your system. Here we explicitly specify 4 threads.

Definition at line 66 of file listener_threaded_spin.cpp.

Variable Documentation

ros::Duration d(0.01)

This tutorial demonstrates simple receipt of messages over the ROS system, using a threaded Spinner object to receive callbacks in multiple threads at the same time.



roscpp_tutorials
Author(s): Morgan Quigley, Dirk Thomas
autogenerated on Sun Oct 18 2020 13:09:42