#include <testscdspso.h>

Public Member Functions | |
| void | baseCallback (const nav_msgs::Odometry &lmsg) |
| float | fitness (const std::vector< float > &vec) |
| virtual void | init () |
| void | loop (const ros::TimerEvent &) |
| virtual void | start () |
| virtual void | stop () |
| TestSCDSPSO () | |
| ~TestSCDSPSO () | |
Public Member Functions inherited from micros_swarm::Application | |
| Application () | |
| const Base & | get_base () |
| float | get_dis () |
| const int | get_id () |
| void | set_base (const Base &robot_base) |
| void | set_dis (float neighbor_distance) |
| virtual | ~Application () |
Public Attributes | |
| micros_swarm::Agent | agent |
| ros::Publisher | pub |
| ros::Subscriber | sub |
| ros::Timer | timer |
| micros_swarm::SCDSPSOTuple | tuple |
Definition at line 35 of file testscdspso.h.
| testscdspso::TestSCDSPSO::TestSCDSPSO | ( | ) |
Definition at line 32 of file testscdspso.cpp.
| testscdspso::TestSCDSPSO::~TestSCDSPSO | ( | ) |
Definition at line 34 of file testscdspso.cpp.
| void testscdspso::TestSCDSPSO::baseCallback | ( | const nav_msgs::Odometry & | lmsg | ) |
Definition at line 53 of file testscdspso.cpp.
| float testscdspso::TestSCDSPSO::fitness | ( | const std::vector< float > & | vec | ) |
Definition at line 65 of file testscdspso.cpp.
|
virtual |
Implements micros_swarm::Application.
Definition at line 36 of file testscdspso.cpp.
| void testscdspso::TestSCDSPSO::loop | ( | const ros::TimerEvent & | ) |
Definition at line 40 of file testscdspso.cpp.
|
virtual |
Implements micros_swarm::Application.
Definition at line 73 of file testscdspso.cpp.
|
virtual |
Implements micros_swarm::Application.
Definition at line 38 of file testscdspso.cpp.
| micros_swarm::Agent testscdspso::TestSCDSPSO::agent |
Definition at line 42 of file testscdspso.h.
| ros::Publisher testscdspso::TestSCDSPSO::pub |
Definition at line 39 of file testscdspso.h.
| ros::Subscriber testscdspso::TestSCDSPSO::sub |
Definition at line 40 of file testscdspso.h.
| ros::Timer testscdspso::TestSCDSPSO::timer |
Definition at line 38 of file testscdspso.h.
| micros_swarm::SCDSPSOTuple testscdspso::TestSCDSPSO::tuple |
Definition at line 43 of file testscdspso.h.