#include <testbb.h>

Public Member Functions | |
| void | baseCallback (const nav_msgs::Odometry &lmsg) |
| virtual void | init () |
| void | loop_get (const ros::TimerEvent &) |
| void | loop_put (const ros::TimerEvent &) |
| virtual void | start () |
| virtual void | stop () |
| TestBb () | |
| ~TestBb () | |
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::BlackBoard< std_msgs::Int32 > | bb |
| ros::Publisher | pub |
| ros::Subscriber | sub |
| ros::Timer | timer |
| testbb::TestBb::TestBb | ( | ) |
Definition at line 30 of file testbb.cpp.
| testbb::TestBb::~TestBb | ( | ) |
Definition at line 32 of file testbb.cpp.
| void testbb::TestBb::baseCallback | ( | const nav_msgs::Odometry & | lmsg | ) |
Definition at line 38 of file testbb.cpp.
|
virtual |
Implements micros_swarm::Application.
Definition at line 34 of file testbb.cpp.
| void testbb::TestBb::loop_get | ( | const ros::TimerEvent & | ) |
Definition at line 68 of file testbb.cpp.
| void testbb::TestBb::loop_put | ( | const ros::TimerEvent & | ) |
Definition at line 58 of file testbb.cpp.
|
virtual |
Implements micros_swarm::Application.
Definition at line 75 of file testbb.cpp.
|
virtual |
Implements micros_swarm::Application.
Definition at line 36 of file testbb.cpp.
| micros_swarm::BlackBoard<std_msgs::Int32> testbb::TestBb::bb |
| ros::Publisher testbb::TestBb::pub |
| ros::Subscriber testbb::TestBb::sub |
| ros::Timer testbb::TestBb::timer |