testscdspso.h
Go to the documentation of this file.
1 
23 #ifndef TESTSCDSPSO_H_
24 #define TESTSCDSPSO_H_
25 
26 #include "std_msgs/String.h"
27 #include "nav_msgs/Odometry.h"
28 #include "geometry_msgs/Twist.h"
29 
30 #include "micros_swarm/scds_pso.h"
32 
33 namespace testscdspso{
34 
36  {
37  public:
41 
44  void loop(const ros::TimerEvent&);
45  void baseCallback(const nav_msgs::Odometry& lmsg);
46 
47  float fitness(const std::vector<float>& vec);
48 
49  TestSCDSPSO();
50  ~TestSCDSPSO();
51  virtual void init();
52  virtual void start();
53  virtual void stop();
54  };
55 };
56 
57 #endif
void baseCallback(const nav_msgs::Odometry &lmsg)
Definition: testscdspso.cpp:53
ros::Subscriber sub
Definition: testscdspso.h:40
micros_swarm::SCDSPSOTuple tuple
Definition: testscdspso.h:43
ros::Publisher pub
Definition: testscdspso.h:39
micros_swarm::Agent agent
Definition: testscdspso.h:42
float fitness(const std::vector< float > &vec)
Definition: testscdspso.cpp:65
void loop(const ros::TimerEvent &)
Definition: testscdspso.cpp:40


testscdspso
Author(s):
autogenerated on Mon Jun 10 2019 14:02:35