qadd.hpp
Go to the documentation of this file.
00001 
00008 /*****************************************************************************
00009 ** Ifdefs
00010 *****************************************************************************/
00011 
00012 #ifndef QADD_NODE_HPP_
00013 #define QADD_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 #include "qt_tutorials/TwoInts.h"
00024 
00025 /*****************************************************************************
00026 ** Class
00027 *****************************************************************************/
00028 
00029 class QAdd : public QNode {
00030 
00031 public:
00032         QAdd(int argc, char** argv);
00033         virtual ~QAdd() {}
00034         void run();
00035         void ros_comms_init();
00036 private:
00037         bool add(qt_tutorials::TwoInts::Request  &req, qt_tutorials::TwoInts::Response &res);
00038         ros::ServiceServer add_server;
00039 };
00040 
00041 #endif /* QADD_NODE_HPP_ */


qt_tutorials
Author(s): Daniel Stonier
autogenerated on Mon Oct 6 2014 03:58:04