#include <labust/vehicles/VR3Details.hpp>
#include <labust/vehicles/Allocation.hpp>
#include <labust/math/NumberManipulation.hpp>
#include <labust/tools/conversions.hpp>
#include <labust/tools/MatrixLoader.hpp>
#include <boost/asio.hpp>
#include <ros/ros.h>
#include <auv_msgs/BodyForceReq.h>
#include <sensor_msgs/Imu.h>
#include <sensor_msgs/FluidPressure.h>
#include <tf/transform_broadcaster.h>
#include <string>
Go to the source code of this file.
Classes | |
struct | SharedData |
Functions | |
double | getRevs (double thrust, double Tnn=1, double _Tnn=1) |
int | main (int argc, char *argv[]) |
void | onTau (SharedData &shared, const auv_msgs::BodyForceReq::ConstPtr tau) |
double getRevs | ( | double | thrust, |
double | Tnn = 1 , |
||
double | _Tnn = 1 |
||
) | [inline] |
Definition at line 90 of file vr_node.cpp.
int main | ( | int | argc, |
char * | argv[] | ||
) |
Definition at line 168 of file vr_node.cpp.
void onTau | ( | SharedData & | shared, |
const auv_msgs::BodyForceReq::ConstPtr | tau | ||
) |
Definition at line 95 of file vr_node.cpp.