qadd_server/qadd.hpp
Go to the documentation of this file.
1 
8 /*****************************************************************************
9 ** Ifdefs
10 *****************************************************************************/
11 
12 #ifndef QADD_NODE_HPP_
13 #define QADD_NODE_HPP_
14 
15 /*****************************************************************************
16 ** Includes
17 *****************************************************************************/
18 
19 #ifndef Q_MOC_RUN
20 #include <ros/ros.h>
21 #include "../common/qnode.hpp"
22 #include "qt_tutorials/TwoInts.h"
23 #endif
24 
25 #include <string>
26 #include <std_msgs/String.h>
27 
28 /*****************************************************************************
29 ** Class
30 *****************************************************************************/
31 
32 class QAdd : public QNode {
33 
34 public:
35  QAdd(int argc, char** argv);
36  virtual ~QAdd() {}
37  void run();
38  void ros_comms_init();
39 private:
40  bool add(qt_tutorials::TwoInts::Request &req, qt_tutorials::TwoInts::Response &res);
42 };
43 
44 #endif /* QADD_NODE_HPP_ */
bool add(qt_tutorials::TwoInts::Request &req, qt_tutorials::TwoInts::Response &res)
void ros_comms_init()
virtual ~QAdd()
ros::ServiceServer add_server
Definition: qnode.hpp:31
QAdd(int argc, char **argv)
void run()


qt_tutorials
Author(s): Daniel Stonier
autogenerated on Wed Mar 11 2020 03:12:20