|
geometry_msgs::Accel | accelFromEigen (const Eigen::Vector6d &acc) |
|
Eigen::Matrix3d | CrossProductOperator (ignition::math::Vector3d _x) |
|
Eigen::Matrix3d | CrossProductOperator (Eigen::Vector3d _x) |
|
Eigen::Vector6d | EigenStack (const ignition::math::Vector3d &_x, const ignition::math::Vector3d &_y) |
|
| GZ_REGISTER_MODEL_PLUGIN (UmbilicalPlugin) |
|
ignition::math::Matrix3d | Mat3dToGazebo (const Eigen::Matrix3d &_x) |
|
Eigen::Matrix3d | Matrix3ToEigen (const ignition::math::Matrix3d &m) |
|
| REGISTER_CONVERSIONFUNCTION_CREATOR (ConversionFunctionBasic,&ConversionFunctionBasic::create) ConversionFunction *ConversionFunctionBasic |
|
| REGISTER_CONVERSIONFUNCTION_CREATOR (ConversionFunctionLinearInterp,&ConversionFunctionLinearInterp::create) ConversionFunction *ConversionFunctionLinearInterp |
|
| REGISTER_CONVERSIONFUNCTION_CREATOR (ConversionFunctionBessa,&ConversionFunctionBessa::create) ConversionFunction *ConversionFunctionBessa |
|
| REGISTER_DYNAMICS_CREATOR (DynamicsZeroOrder,&DynamicsZeroOrder::create) Dynamics *DynamicsZeroOrder |
|
| REGISTER_DYNAMICS_CREATOR (DynamicsFirstOrder,&DynamicsFirstOrder::create) Dynamics *DynamicsFirstOrder |
|
| REGISTER_DYNAMICS_CREATOR (ThrusterDynamicsYoerger,&ThrusterDynamicsYoerger::create) Dynamics *ThrusterDynamicsYoerger |
|
| REGISTER_DYNAMICS_CREATOR (ThrusterDynamicsBessa,&ThrusterDynamicsBessa::create) Dynamics *ThrusterDynamicsBessa |
|
| REGISTER_HYDRODYNAMICMODEL_CREATOR (HMSpheroid,&HMSpheroid::create) |
|
| REGISTER_HYDRODYNAMICMODEL_CREATOR (HMBox,&HMBox::create) |
|
| REGISTER_HYDRODYNAMICMODEL_CREATOR (HMCylinder,&HMCylinder::create) |
|
| REGISTER_HYDRODYNAMICMODEL_CREATOR (HMFossen,&HMFossen::create) |
|
| REGISTER_HYDRODYNAMICMODEL_CREATOR (HMSphere,&HMSphere::create) |
|
| REGISTER_LIFTDRAG_CREATOR (LiftDragTwoLines,&LiftDragTwoLines::create) LiftDrag *LiftDragTwoLines |
|
| REGISTER_LIFTDRAG_CREATOR (LiftDragQuadratic,&LiftDragQuadratic::create) LiftDrag *LiftDragQuadratic |
|
std::vector< double > | Str2Vector (std::string _input) |
|
Eigen::Vector3d | ToEigen (const ignition::math::Vector3d &_x) |
|
Eigen::Matrix3d | ToEigen (const ignition::math::Matrix3d &_x) |
|
ignition::math::Vector3d | Vec3dToGazebo (const Eigen::Vector3d &_x) |
|