Public Member Functions | Protected Member Functions | Protected Attributes | List of all members
ros1_ros_cpptemplate::Subscriber Class Reference

#include <subscriber.hpp>

Public Member Functions

 Subscriber (ros::NodeHandle &node_handle, const std::string &topic_name)
 
virtual ~Subscriber ()
 

Protected Member Functions

virtual void callback (const std_msgs::Int32Ptr &number)
 
 Subscriber ()
 

Protected Attributes

ros::Subscriber subscriber_
 Actual subscriber. More...
 

Detailed Description

Class which publishes fibonacci numbers

Definition at line 17 of file subscriber.hpp.

Constructor & Destructor Documentation

ros1_ros_cpptemplate::Subscriber::Subscriber ( ros::NodeHandle node_handle,
const std::string &  topic_name 
)

Constructor

Parameters
node_handleNodeHandle the subscriber will be registered under
topic_nameSubscriber topic name

Definition at line 9 of file subscriber.cpp.

ros1_ros_cpptemplate::Subscriber::~Subscriber ( )
virtual

Deconstructor

Definition at line 16 of file subscriber.cpp.

ros1_ros_cpptemplate::Subscriber::Subscriber ( )
inlineprotected

Protected default construtor for easy mocking

Definition at line 44 of file subscriber.hpp.

Member Function Documentation

void ros1_ros_cpptemplate::Subscriber::callback ( const std_msgs::Int32Ptr &  number)
protectedvirtual

Callback for next Fibonacci number

Parameters
numberMsg with next number

Definition at line 20 of file subscriber.cpp.

Member Data Documentation

ros::Subscriber ros1_ros_cpptemplate::Subscriber::subscriber_
protected

Actual subscriber.

Definition at line 49 of file subscriber.hpp.


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


ros1_ros_cpptemplate
Author(s): Alexander Reimann
autogenerated on Sat Sep 2 2017 02:38:06