listener.hpp
Go to the documentation of this file.
00001 
00008 /*****************************************************************************
00009 ** Ifdefs
00010 *****************************************************************************/
00011 
00012 #ifndef LISTENER_NODE_HPP_
00013 #define LISTENER_NODE_HPP_
00014 
00015 /*****************************************************************************
00016 ** Includes
00017 *****************************************************************************/
00018 
00019 #include <ros/ros.h>
00020 #include <string>
00021 #include <std_msgs/String.h>
00022 #include "../common/qnode.hpp"
00023 
00024 /*****************************************************************************
00025 ** Class
00026 *****************************************************************************/
00027 
00028 class Listener : public QNode {
00029 
00030 public:
00031         Listener(int argc, char** argv);
00032         virtual ~Listener() {}
00033         void run();
00034         void ros_comms_init();
00035 private:
00036         void chatterCallback(const std_msgs::String::ConstPtr &msg);
00037         ros::Subscriber chatter_subscriber;
00038 };
00039 
00040 #endif /* LISTENER_NODE_HPP_ */


qt_tutorials
Author(s): Daniel Stonier
autogenerated on Tue Jan 7 2014 11:33:48