#include <labust/control/EnablePolicy.hpp>
#include <labust/control/ManControl.hpp>
#include <labust/math/NumberManipulation.hpp>
#include <labust/tools/MatrixLoader.hpp>
#include <auv_msgs/NavSts.h>
#include <auv_msgs/BodyVelocityReq.h>
#include <std_msgs/Bool.h>
#include <boost/thread/mutex.hpp>
Go to the source code of this file.
Classes | |
struct | labust::control::RefManual |
The manual reference controller. More... | |
Namespaces | |
namespace | labust |
namespace | labust::control |
Functions | |
int | main (int argc, char *argv[]) |
int main | ( | int | argc, |
char * | argv[] | ||
) |
Definition at line 358 of file RefManual.cpp.