General definitions. More...
#include <vector>
#include <string>
#include <map>
#include <gazebo/gazebo.hh>
#include <eigen3/Eigen/Core>
#include <eigen3/Eigen/Geometry>
Go to the source code of this file.
Namespaces | |
Eigen | |
gazebo | |
Macros | |
#define | PI 3.14159265359 |
#define | RESTORING_FORCE "restoring_force" |
Tags to debugging topics that publish the forces separetely. More... | |
#define | UUV_ADDED_CORIOLIS_FORCE "coriolis_force" |
#define | UUV_ADDED_CORIOLIS_TORQUE "coriolis_torque" |
#define | UUV_ADDED_MASS_FORCE "added_mass_force" |
#define | UUV_ADDED_MASS_TORQUE "added_mass_torque" |
#define | UUV_DAMPING_FORCE "damping_force" |
#define | UUV_DAMPING_TORQUE "damping_torque" |
Typedefs | |
typedef Eigen::Matrix< double, 6, 6 > | Eigen::Matrix6d |
Definition of a 6x6 Eigen matrix. More... | |
typedef Eigen::Matrix< double, 6, 1 > | Eigen::Vector6d |
Definition of a 6 element Eigen vector. More... | |
Functions | |
Eigen::Matrix3d | gazebo::CrossProductOperator (Eigen::Vector3d _x) |
Returns the cross product operator matrix for Eigen vectors. More... | |
Eigen::Matrix3d | gazebo::CrossProductOperator (ignition::math::Vector3d _x) |
Returns the cross product operator matrix for Gazebo vectors. More... | |
Eigen::Vector6d | gazebo::EigenStack (const ignition::math::Vector3d &_x, const ignition::math::Vector3d &_y) |
ignition::math::Matrix3d | gazebo::Mat3dToGazebo (const Eigen::Matrix3d &_x) |
std::vector< double > | gazebo::Str2Vector (std::string _input) |
Conversion of a string to a double vector. More... | |
Eigen::Vector3d | gazebo::ToEigen (const ignition::math::Vector3d &_x) |
Eigen::Matrix3d | gazebo::ToEigen (const ignition::math::Matrix3d &_x) |
ignition::math::Vector3d | gazebo::Vec3dToGazebo (const Eigen::Vector3d &_x) |
General definitions.
Definition in file Def.hh.
#define RESTORING_FORCE "restoring_force" |