#include <FormationControl.hpp>
Public Member Functions | |
| FormationControl () | |
| void | joystickCB (const sensor_msgs::Joy::ConstPtr &msg) |
| void | setupFormationControl () |
| virtual | ~FormationControl () |
Protected Attributes | |
| std::vector < FormationControlElement * > | formationElements |
| ros::Subscriber | joySub |
| ros::NodeHandle | mainNodeHandle |
| FormationControlOptions | options |
Definition at line 30 of file FormationControl.hpp.
Definition at line 28 of file FormationControl.cpp.
| FormationControl::~FormationControl | ( | ) | [virtual] |
Definition at line 34 of file FormationControl.cpp.
| void FormationControl::joystickCB | ( | const sensor_msgs::Joy::ConstPtr & | msg | ) |
Definition at line 143 of file FormationControl.cpp.
Definition at line 41 of file FormationControl.cpp.
std::vector< FormationControlElement* > FormationControl::formationElements [protected] |
Definition at line 34 of file FormationControl.hpp.
ros::Subscriber FormationControl::joySub [protected] |
Definition at line 38 of file FormationControl.hpp.
ros::NodeHandle FormationControl::mainNodeHandle [protected] |
Definition at line 37 of file FormationControl.hpp.
FormationControlOptions FormationControl::options [protected] |
Definition at line 32 of file FormationControl.hpp.