subscriber.hpp
Go to the documentation of this file.
00001 #ifndef ros1_ros_cpp_template_SUBSCRIBER_HPP_
00002 #define ros1_ros_cpp_template_SUBSCRIBER_HPP_
00003 
00004 #include <std_msgs/Int32.h>
00005 #include <ros/subscriber.h>
00006 #include <ros/node_handle.h>
00007 
00008 #include <string>
00009 #include <memory>
00010 
00011 namespace ros1_ros_cpptemplate
00012 {
00013 
00017 class Subscriber
00018 {
00019 public:
00026   Subscriber(ros::NodeHandle& node_handle, const std::string& topic_name);
00027 
00031   virtual ~Subscriber();
00032 
00033 protected:
00039   virtual void callback(const std_msgs::Int32Ptr& number);
00040 
00044   Subscriber()
00045   {
00046   }
00047 
00049   ros::Subscriber subscriber_;
00050 };
00051 typedef std::shared_ptr<Subscriber> SubscriberPtr;
00052 
00053 }  // namespace
00054 
00055 #endif


ros1_ros_cpptemplate
Author(s): Alexander Reimann
autogenerated on Fri Sep 1 2017 02:23:42