#include <labust/control/HLControl.hpp>#include <labust/control/EnablePolicy.hpp>#include <labust/control/WindupPolicy.hpp>#include <labust/control/PSatDController.h>#include <labust/control/IPFFController.h>#include <labust/control/PIFFController.h>#include <labust/math/NumberManipulation.hpp>#include <labust/tools/MatrixLoader.hpp>#include <labust/tools/conversions.hpp>#include <Eigen/Dense>#include <auv_msgs/BodyForceReq.h>#include <std_msgs/Float32.h>#include <std_msgs/Bool.h>#include <ros/ros.h>
Go to the source code of this file.
Classes | |
| struct | labust::control::ALTControl |
| The altitude/depth controller. More... | |
Namespaces | |
| namespace | labust |
| namespace | labust::control |
Functions | |
| int | main (int argc, char *argv[]) |
| int main | ( | int | argc, |
| char * | argv[] | ||
| ) |
Definition at line 168 of file ALTControl.cpp.