Go to the documentation of this file.00001
00008
00009
00010
00011
00012 #ifndef QADD_NODE_HPP_
00013 #define QADD_NODE_HPP_
00014
00015
00016
00017
00018
00019 #ifndef Q_MOC_RUN
00020 #include <ros/ros.h>
00021 #include "../common/qnode.hpp"
00022 #include "qt_tutorials/TwoInts.h"
00023 #endif
00024
00025 #include <string>
00026 #include <std_msgs/String.h>
00027
00028
00029
00030
00031
00032 class QAdd : public QNode {
00033
00034 public:
00035 QAdd(int argc, char** argv);
00036 virtual ~QAdd() {}
00037 void run();
00038 void ros_comms_init();
00039 private:
00040 bool add(qt_tutorials::TwoInts::Request &req, qt_tutorials::TwoInts::Response &res);
00041 ros::ServiceServer add_server;
00042 };
00043
00044 #endif