testbb.h
Go to the documentation of this file.
1 
23 #ifndef TESTBB_H_
24 #define TESTBB_H_
25 
26 #include "std_msgs/String.h"
27 #include "std_msgs/Int32.h"
28 #include "nav_msgs/Odometry.h"
29 #include "geometry_msgs/Twist.h"
30 
32 
33 namespace testbb{
34 
36  {
37  public:
41 
43 
44  void baseCallback(const nav_msgs::Odometry& lmsg);
45  void loop_put(const ros::TimerEvent&);
46  void loop_get(const ros::TimerEvent&);
47 
48  TestBb();
49  ~TestBb();
50  virtual void init();
51  virtual void start();
52  virtual void stop();
53  };
54 };
55 
56 #endif
virtual void stop()
Definition: testbb.cpp:36
virtual void init()
Definition: testbb.cpp:34
micros_swarm::BlackBoard< std_msgs::Int32 > bb
Definition: testbb.h:42
void baseCallback(const nav_msgs::Odometry &lmsg)
Definition: testbb.cpp:38
Definition: testbb.h:33
virtual void start()
Definition: testbb.cpp:75
ros::Timer timer
Definition: testbb.h:38
ros::Publisher pub
Definition: testbb.h:39
void loop_get(const ros::TimerEvent &)
Definition: testbb.cpp:68
void loop_put(const ros::TimerEvent &)
Definition: testbb.cpp:58
ros::Subscriber sub
Definition: testbb.h:40


testbb
Author(s):
autogenerated on Mon Jun 10 2019 14:02:31