gazebo_flocking.h
Go to the documentation of this file.
1 
23 #ifndef GAZEBO_FLOCKING_H_
24 #define GAZEBO_FLOCKING_H_
25 
26 #include <string>
27 #include <list>
28 #include <vector>
29 #include <iostream>
30 #include <utility>
31 #include <cmath>
32 #include <ctime>
33 
34 #include "std_msgs/String.h"
35 #include "nav_msgs/Odometry.h"
36 #include "geometry_msgs/Twist.h"
37 
39 
40 namespace gazebo_flocking{
41 
43  {
44  public:
48 
49  int hz;
50  double interval;
51 
54  virtual void init();
55  virtual void start();
56  virtual void stop();
57 
58  //app functions
59  void publish_cmd(const ros::TimerEvent&);
60  void baseCallback(const nav_msgs::Odometry& lmsg);
61  };
62 };
63 
64 #endif
void publish_cmd(const ros::TimerEvent &)
void baseCallback(const nav_msgs::Odometry &lmsg)


gazebo_flocking
Author(s):
autogenerated on Mon Jun 10 2019 14:02:17