#include <testvstig.h>
Public Member Functions | |
void | baseCallback (const nav_msgs::Odometry &lmsg) |
virtual void | init () |
void | loop_get (const ros::TimerEvent &) |
void | loop_gets (const ros::TimerEvent &) |
void | loop_put (const ros::TimerEvent &) |
void | loop_puts (const ros::TimerEvent &) |
void | not_loop_get (const ros::TimerEvent &) |
void | not_loop_put (const ros::TimerEvent &) |
virtual void | start () |
virtual void | stop () |
TestVstig () | |
~TestVstig () | |
Public Attributes | |
ros::Publisher | pub |
ros::Subscriber | sub |
ros::Timer | timer |
micros_swarm::VirtualStigmergy < std_msgs::Int32 > | vs |
Definition at line 36 of file testvstig.h.
Definition at line 30 of file testvstig.cpp.
Definition at line 32 of file testvstig.cpp.
void testvstig::TestVstig::baseCallback | ( | const nav_msgs::Odometry & | lmsg | ) |
Definition at line 112 of file testvstig.cpp.
void testvstig::TestVstig::init | ( | ) | [virtual] |
Implements micros_swarm::Application.
Definition at line 34 of file testvstig.cpp.
void testvstig::TestVstig::loop_get | ( | const ros::TimerEvent & | ) |
Definition at line 78 of file testvstig.cpp.
void testvstig::TestVstig::loop_gets | ( | const ros::TimerEvent & | ) |
Definition at line 57 of file testvstig.cpp.
void testvstig::TestVstig::loop_put | ( | const ros::TimerEvent & | ) |
Definition at line 66 of file testvstig.cpp.
void testvstig::TestVstig::loop_puts | ( | const ros::TimerEvent & | ) |
Definition at line 38 of file testvstig.cpp.
void testvstig::TestVstig::not_loop_get | ( | const ros::TimerEvent & | ) |
Definition at line 102 of file testvstig.cpp.
void testvstig::TestVstig::not_loop_put | ( | const ros::TimerEvent & | ) |
Definition at line 87 of file testvstig.cpp.
void testvstig::TestVstig::start | ( | ) | [virtual] |
Implements micros_swarm::Application.
Definition at line 132 of file testvstig.cpp.
void testvstig::TestVstig::stop | ( | ) | [virtual] |
Implements micros_swarm::Application.
Definition at line 36 of file testvstig.cpp.
Definition at line 40 of file testvstig.h.
Definition at line 41 of file testvstig.h.
Definition at line 39 of file testvstig.h.
micros_swarm::VirtualStigmergy<std_msgs::Int32> testvstig::TestVstig::vs |
Definition at line 43 of file testvstig.h.