Cheetah Software
1.0
|
#include <FloatingBaseModel.h>
Public Member Functions | |
FloatingBaseModel () | |
~FloatingBaseModel () | |
void | addBase (const SpatialInertia< T > &inertia) |
void | addBase (T mass, const Vec3< T > &com, const Mat3< T > &I) |
int | addGroundContactPoint (int bodyID, const Vec3< T > &location, bool isFoot=false) |
void | addGroundContactBoxPoints (int bodyId, const Vec3< T > &dims) |
int | addBody (const SpatialInertia< T > &inertia, const SpatialInertia< T > &rotorInertia, T gearRatio, int parent, JointType jointType, CoordinateAxis jointAxis, const Mat6< T > &Xtree, const Mat6< T > &Xrot) |
int | addBody (const MassProperties< T > &inertia, const MassProperties< T > &rotorInertia, T gearRatio, int parent, JointType jointType, CoordinateAxis jointAxis, const Mat6< T > &Xtree, const Mat6< T > &Xrot) |
void | check () |
T | totalRotorMass () |
T | totalNonRotorMass () |
const std::vector< int > & | getParentVector () |
const std::vector< SpatialInertia< T >, Eigen::aligned_allocator< SpatialInertia< T > > > & | getBodyInertiaVector () |
const std::vector< SpatialInertia< T >, Eigen::aligned_allocator< SpatialInertia< T > > > & | getRotorInertiaVector () |
void | setGravity (Vec3< T > &g) |
void | setContactComputeFlag (size_t gc_index, bool flag) |
DMat< T > | invContactInertia (const int gc_index, const D6Mat< T > &force_directions) |
T | invContactInertia (const int gc_index, const Vec3< T > &force_ics_at_contact) |
T | applyTestForce (const int gc_index, const Vec3< T > &force_ics_at_contact, FBModelStateDerivative< T > &dstate_out) |
T | applyTestForce (const int gc_index, const Vec3< T > &force_ics_at_contact, DVec< T > &dstate_out) |
void | addDynamicsVars (int count) |
void | resizeSystemMatricies () |
void | setState (const FBModelState< T > &state) |
void | resetCalculationFlags () |
void | setDState (const FBModelStateDerivative< T > &dState) |
Vec3< T > | getPosition (const int link_idx, const Vec3< T > &local_pos) |
Vec3< T > | getPosition (const int link_idx) |
Mat3< T > | getOrientation (const int link_idx) |
Vec3< T > | getLinearVelocity (const int link_idx, const Vec3< T > &point) |
Vec3< T > | getLinearVelocity (const int link_idx) |
Vec3< T > | getLinearAcceleration (const int link_idx, const Vec3< T > &point) |
Vec3< T > | getLinearAcceleration (const int link_idx) |
Vec3< T > | getAngularVelocity (const int link_idx) |
Vec3< T > | getAngularAcceleration (const int link_idx) |
void | forwardKinematics () |
void | biasAccelerations () |
void | compositeInertias () |
void | forwardAccelerationKinematics () |
void | contactJacobians () |
DVec< T > | generalizedGravityForce () |
DVec< T > | generalizedCoriolisForce () |
DMat< T > | massMatrix () |
DVec< T > | inverseDynamics (const FBModelStateDerivative< T > &dState) |
void | runABA (const DVec< T > &tau, FBModelStateDerivative< T > &dstate) |
const DMat< T > & | getMassMatrix () const |
const DVec< T > & | getGravityForce () const |
const DVec< T > & | getCoriolisForce () const |
void | updateArticulatedBodies () |
void | updateForcePropagators () |
void | udpateQddEffects () |
void | resetExternalForces () |
Class to represent a floating base rigid body model with rotors and ground contacts. No concept of state.
Definition at line 69 of file FloatingBaseModel.h.
|
inline |
Initialize a floating base model with default gravity
Definition at line 74 of file FloatingBaseModel.h.
|
inline |
Definition at line 75 of file FloatingBaseModel.h.
void FloatingBaseModel< T >::addBase | ( | const SpatialInertia< T > & | inertia | ) |
Add floating base. Must be the first body added, and there can only be one
Create the floating body
inertia | Spatial inertia of the floating body |
Definition at line 267 of file FloatingBaseModel.cpp.
References ori::X.
void FloatingBaseModel< T >::addBase | ( | T | mass, |
const Vec3< T > & | com, | ||
const Mat3< T > & | I | ||
) |
Add floating base. Must be the first body added, and there can only be one
Create the floating body
mass | Mass of the floating body |
com | Center of mass of the floating body |
I | Rotational inertia of the floating body |
Definition at line 305 of file FloatingBaseModel.cpp.
int FloatingBaseModel< T >::addBody | ( | const SpatialInertia< T > & | inertia, |
const SpatialInertia< T > & | rotorInertia, | ||
T | gearRatio, | ||
int | parent, | ||
JointType | jointType, | ||
CoordinateAxis | jointAxis, | ||
const Mat6< T > & | Xtree, | ||
const Mat6< T > & | Xrot | ||
) |
Add a body to the tree
inertia | : Inertia of body (body coords) |
rotorInertia | : Inertia of rotor (rotor coords) |
gearRatio | : Gear ratio. >1 for a gear reduction |
parent | : Body ID of the link that the body is connected to |
jointType | : Type of joint |
jointAxis | : Axis of joint |
Xtree | : Location of joint |
Xrot | : Location of rotor |
Add a body
inertia | The inertia of the body |
rotorInertia | The inertia of the rotor the body is connected to |
gearRatio | The gear ratio between the body and the rotor |
parent | The parent body, which is also assumed to be the body the rotor is connected to |
jointType | The type of joint (prismatic or revolute) |
jointAxis | The joint axis (X,Y,Z), in the parent's frame |
Xtree | The coordinate transformation from parent to this body |
Xrot | The coordinate transformation from parent to this body's rotor |
Definition at line 392 of file FloatingBaseModel.cpp.
int FloatingBaseModel< T >::addBody | ( | const MassProperties< T > & | inertia, |
const MassProperties< T > & | rotorInertia, | ||
T | gearRatio, | ||
int | parent, | ||
JointType | jointType, | ||
CoordinateAxis | jointAxis, | ||
const Mat6< T > & | Xtree, | ||
const Mat6< T > & | Xrot | ||
) |
Add a body to the tree
inertia | : Inertia of body (body coords) |
rotorInertia | : Inertia of rotor (rotor coords) |
gearRatio | : Gear ratio. >1 for a gear reduction |
parent | : Body ID of the link that the body is connected to |
jointType | : Type of joint |
jointAxis | : Axis of joint |
Xtree | : Location of joint |
Xrot | : Location of rotor |
Add a body
inertia | The inertia of the body |
rotorInertia | The inertia of the rotor the body is connected to |
gearRatio | The gear ratio between the body and the rotor |
parent | The parent body, which is also assumed to be the body the rotor is connected to |
jointType | The type of joint (prismatic or revolute) |
jointAxis | The joint axis (X,Y,Z), in the parent's frame |
Xtree | The coordinate transformation from parent to this body |
Xrot | The coordinate transformation from parent to this body's rotor |
Definition at line 432 of file FloatingBaseModel.cpp.
void FloatingBaseModel< T >::addDynamicsVars | ( | int | count | ) |
Populate member variables when bodies are added
count | (6 for fb, 1 for joint) |
Definition at line 185 of file FloatingBaseModel.cpp.
void FloatingBaseModel< T >::addGroundContactBoxPoints | ( | int | bodyId, |
const Vec3< T > & | dims | ||
) |
Add bounding box collision points around a body.
bodyId | : Body to add |
dims | : Dimension of points |
Add the bounding points of a box to the contact model. Assumes the box is centered around the origin of the body coordinate system and is axis aligned.
Definition at line 360 of file FloatingBaseModel.cpp.
int FloatingBaseModel< T >::addGroundContactPoint | ( | int | bodyID, |
const Vec3< T > & | location, | ||
bool | isFoot = false |
||
) |
Add a point for collisions
bodyID | : body that the point belongs to (body 5 for floating base) |
location | : location of point in body coordinates |
isFoot | : if the point is a foot or not. Only feet have their Jacobian calculated on the robot |
Add a ground contact point to a model
bodyID | The ID of the body containing the contact point |
location | The location (in body coordinate) of the contact point |
isFoot | True if foot or not. |
Definition at line 319 of file FloatingBaseModel.cpp.
T FloatingBaseModel< T >::applyTestForce | ( | const int | gc_index, |
const Vec3< T > & | force_ics_at_contact, | ||
FBModelStateDerivative< T > & | dstate_out | ||
) |
Apply a unit test force at a contact. Returns the inv contact inertia in that direction and computes the resultant qdd
gc_index | index of the contact |
force_ics_at_contact | unit test forcoe dstate - Output paramter of resulting accelerations |
Definition at line 962 of file FloatingBaseModel.cpp.
References spatial::createSXform(), FBModelStateDerivative< T >::dBodyVelocity, and FBModelStateDerivative< T >::qdd.
T FloatingBaseModel< T >::applyTestForce | ( | const int | gc_index, |
const Vec3< T > & | force_ics_at_contact, | ||
DVec< T > & | dstate_out | ||
) |
Apply a unit test force at a contact. Returns the inv contact inertia in that direction and computes the resultant qdd
gc_index | index of the contact |
force_ics_at_contact | unit test force expressed in inertial coordinates dstate - Output paramter of resulting accelerations |
Definition at line 40 of file FloatingBaseModel.cpp.
References spatial::createSXform().
void FloatingBaseModel< T >::biasAccelerations | ( | ) |
(Support Function) Computes velocity product accelerations of each link and rotor _avp, and _avprot
Definition at line 590 of file FloatingBaseModel.cpp.
void FloatingBaseModel< T >::check | ( | ) |
Very simple to check to make sure the dimensions are correct
Definition at line 442 of file FloatingBaseModel.cpp.
void FloatingBaseModel< T >::compositeInertias | ( | ) |
(Support Function) Computes the composite rigid body inertia of each subtree _IC[i] contains body i, and the body/rotor inertias of all successors of body i. (key note: _IC[i] does not contain rotor i)
Definition at line 753 of file FloatingBaseModel.cpp.
void FloatingBaseModel< T >::contactJacobians | ( | ) |
Compute the contact Jacobians (3xn matrices) for the velocity of each contact point expressed in absolute coordinates
Definition at line 548 of file FloatingBaseModel.cpp.
References spatial::createSXform(), and spatial::spatialToLinearAcceleration().
void FloatingBaseModel< T >::forwardAccelerationKinematics | ( | ) |
Definition at line 813 of file FloatingBaseModel.cpp.
void FloatingBaseModel< T >::forwardKinematics | ( | ) |
Forward kinematics of all bodies. Computes _Xup (from up the tree) and _Xa (from absolute) Also computes _S (motion subspace), _v (spatial velocity in link coordinates), and _c (coriolis acceleration in link coordinates)
Definition at line 479 of file FloatingBaseModel.cpp.
References spatial::createSXform(), spatial::invertSXform(), spatial::jointXform(), spatial::motionCrossProduct(), ori::quaternionToRotationMatrix(), spatial::spatialToLinearVelocity(), and spatial::sXFormPoint().
DVec< T > FloatingBaseModel< T >::generalizedCoriolisForce | ( | ) |
Computes the generalized coriolis forces (Cqd) in the inverse dynamics
Definition at line 636 of file FloatingBaseModel.cpp.
References spatial::forceCrossProduct().
DVec< T > FloatingBaseModel< T >::generalizedGravityForce | ( | ) |
Computes the generalized gravitational force (G) in the inverse dynamics
Definition at line 610 of file FloatingBaseModel.cpp.
Vec3< T > FloatingBaseModel< T >::getAngularAcceleration | ( | const int | link_idx | ) |
Definition at line 740 of file FloatingBaseModel.cpp.
Vec3< T > FloatingBaseModel< T >::getAngularVelocity | ( | const int | link_idx | ) |
Definition at line 731 of file FloatingBaseModel.cpp.
|
inline |
Definition at line 158 of file FloatingBaseModel.h.
|
inline |
Definition at line 263 of file FloatingBaseModel.h.
|
inline |
Definition at line 262 of file FloatingBaseModel.h.
Vec3< T > FloatingBaseModel< T >::getLinearAcceleration | ( | const int | link_idx, |
const Vec3< T > & | point | ||
) |
Definition at line 698 of file FloatingBaseModel.cpp.
References spatial::spatialToLinearAcceleration().
Vec3< T > FloatingBaseModel< T >::getLinearAcceleration | ( | const int | link_idx | ) |
Definition at line 706 of file FloatingBaseModel.cpp.
References spatial::spatialToLinearAcceleration().
Vec3< T > FloatingBaseModel< T >::getLinearVelocity | ( | const int | link_idx, |
const Vec3< T > & | point | ||
) |
Definition at line 714 of file FloatingBaseModel.cpp.
References spatial::spatialToLinearVelocity().
Vec3< T > FloatingBaseModel< T >::getLinearVelocity | ( | const int | link_idx | ) |
Definition at line 722 of file FloatingBaseModel.cpp.
References spatial::spatialToLinearVelocity().
|
inline |
Mat3< T > FloatingBaseModel< T >::getOrientation | ( | const int | link_idx | ) |
Definition at line 671 of file FloatingBaseModel.cpp.
|
inline |
Vec3< T > FloatingBaseModel< T >::getPosition | ( | const int | link_idx, |
const Vec3< T > & | local_pos | ||
) |
Definition at line 689 of file FloatingBaseModel.cpp.
References spatial::invertSXform(), and spatial::sXFormPoint().
Vec3< T > FloatingBaseModel< T >::getPosition | ( | const int | link_idx | ) |
Definition at line 680 of file FloatingBaseModel.cpp.
References spatial::invertSXform(), and spatial::sXFormPoint().
|
inline |
Definition at line 164 of file FloatingBaseModel.h.
DMat< T > FloatingBaseModel< T >::invContactInertia | ( | const int | gc_index, |
const D6Mat< T > & | force_directions | ||
) |
Compute the inverse of the contact inertia matrix (mxm)
force_directions | (6xm) each column denotes a direction of interest col = [ moment in i.c.s., force in i.c.s.] e.g. if you want the cartesian inv. contact inertia force_directions = [ 0_{3x3} I_{3x3}]^T if you only want the cartesian inv. contact inertia in one direction then use the overloaded version. |
Definition at line 1065 of file FloatingBaseModel.cpp.
References spatial::createSXform().
T FloatingBaseModel< T >::invContactInertia | ( | const int | gc_index, |
const Vec3< T > & | force_ics_at_contact | ||
) |
Compute the inverse of the contact inertia matrix (mxm)
force_ics_at_contact | (3x1) e.g. if you want the cartesian inv. contact inertia in the z_ics force_ics_at_contact = [0 0 1]^T |
Definition at line 1017 of file FloatingBaseModel.cpp.
References spatial::createSXform().
DVec< T > FloatingBaseModel< T >::inverseDynamics | ( | const FBModelStateDerivative< T > & | dState | ) |
Computes the inverse dynamics of the system
Definition at line 845 of file FloatingBaseModel.cpp.
References spatial::forceCrossProduct().
DMat< T > FloatingBaseModel< T >::massMatrix | ( | ) |
Computes the Mass Matrix (H) in the inverse dynamics formulation
Definition at line 778 of file FloatingBaseModel.cpp.
References f().
|
inline |
Definition at line 199 of file FloatingBaseModel.h.
|
inline |
Definition at line 301 of file FloatingBaseModel.h.
void FloatingBaseModel< T >::resizeSystemMatricies | ( | ) |
Updates the size of H, C, Cqd, G, and Js when bodies are added
Definition at line 242 of file FloatingBaseModel.cpp.
void FloatingBaseModel< T >::runABA | ( | const DVec< T > & | tau, |
FBModelStateDerivative< T > & | dstate | ||
) |
Definition at line 880 of file FloatingBaseModel.cpp.
References spatial::createSXform(), FBModelStateDerivative< T >::dBodyPosition, FBModelStateDerivative< T >::dBodyVelocity, spatial::forceCrossProduct(), spatial::motionCrossProduct(), FBModelStateDerivative< T >::qdd, spatial::rotationFromSXform(), and spatial::translationFromSXform().
|
inline |
Definition at line 173 of file FloatingBaseModel.h.
|
inline |
Definition at line 207 of file FloatingBaseModel.h.
|
inline |
Set the gravity
Definition at line 171 of file FloatingBaseModel.h.
|
inline |
Definition at line 191 of file FloatingBaseModel.h.
T FloatingBaseModel< T >::totalNonRotorMass | ( | ) |
Total mass of all bodies which are not rotors
Compute the total mass of bodies which are not rotors.
Definition at line 452 of file FloatingBaseModel.cpp.
T FloatingBaseModel< T >::totalRotorMass | ( | ) |
Total mass of all rotors
Compute the total mass of bodies which are not rotors
Definition at line 465 of file FloatingBaseModel.cpp.
void FloatingBaseModel< T >::udpateQddEffects | ( | ) |
Support function for contact inertia algorithms Computes the qdd arising from "subqdd" components If you are familiar with Featherstone's sparse Op sp or jain's innovations factorization: H = L * D * L^T These subqdd components represnt the space in the middle i.e. if H^{-1} = L^{-T} * D^{-1} * L^{1} then what I am calling subqdd = L^{-1} * tau This is an awful explanation. It needs latex.
Definition at line 98 of file FloatingBaseModel.cpp.
void FloatingBaseModel< T >::updateArticulatedBodies | ( | ) |
Support function for the ABA
Definition at line 142 of file FloatingBaseModel.cpp.
References spatial::jointXform().
void FloatingBaseModel< T >::updateForcePropagators | ( | ) |
Support function for contact inertia algorithms Comptues force propagators across each joint
Definition at line 129 of file FloatingBaseModel.cpp.
vectorAligned<SVec<T> > FloatingBaseModel< T >::_a |
Definition at line 273 of file FloatingBaseModel.h.
bool FloatingBaseModel< T >::_accelerationsUpToDate = false |
Definition at line 293 of file FloatingBaseModel.h.
vectorAligned<SVec<T> > FloatingBaseModel< T >::_ag |
Definition at line 273 of file FloatingBaseModel.h.
vectorAligned<SVec<T> > FloatingBaseModel< T >::_agrot |
Definition at line 273 of file FloatingBaseModel.h.
vectorAligned<SVec<T> > FloatingBaseModel< T >::_arot |
Definition at line 273 of file FloatingBaseModel.h.
bool FloatingBaseModel< T >::_articulatedBodiesUpToDate = false |
Definition at line 307 of file FloatingBaseModel.h.
vectorAligned<SVec<T> > FloatingBaseModel< T >::_avp |
Definition at line 273 of file FloatingBaseModel.h.
vectorAligned<SVec<T> > FloatingBaseModel< T >::_avprot |
Definition at line 273 of file FloatingBaseModel.h.
bool FloatingBaseModel< T >::_biasAccelerationsUpToDate = false |
Definition at line 292 of file FloatingBaseModel.h.
vector<std::string> FloatingBaseModel< T >::_bodyNames |
Definition at line 249 of file FloatingBaseModel.h.
vectorAligned<SVec<T> > FloatingBaseModel< T >::_c |
Definition at line 273 of file FloatingBaseModel.h.
DMat<T> FloatingBaseModel< T >::_C |
Definition at line 282 of file FloatingBaseModel.h.
vectorAligned<Mat6<T> > FloatingBaseModel< T >::_ChiUp |
Definition at line 280 of file FloatingBaseModel.h.
bool FloatingBaseModel< T >::_compositeInertiasUpToDate = false |
Definition at line 295 of file FloatingBaseModel.h.
vector<bool> FloatingBaseModel< T >::_compute_contact_info |
Definition at line 259 of file FloatingBaseModel.h.
DVec<T> FloatingBaseModel< T >::_Cqd |
Definition at line 283 of file FloatingBaseModel.h.
vectorAligned<SVec<T> > FloatingBaseModel< T >::_crot |
Definition at line 273 of file FloatingBaseModel.h.
vector<T> FloatingBaseModel< T >::_d |
Definition at line 242 of file FloatingBaseModel.h.
FBModelStateDerivative<T> FloatingBaseModel< T >::_dState |
Definition at line 271 of file FloatingBaseModel.h.
vectorAligned<SVec<T> > FloatingBaseModel< T >::_externalForces |
Definition at line 277 of file FloatingBaseModel.h.
vectorAligned<SVec<T> > FloatingBaseModel< T >::_f |
Definition at line 273 of file FloatingBaseModel.h.
vector<uint64_t> FloatingBaseModel< T >::_footIndicesGC |
Definition at line 254 of file FloatingBaseModel.h.
bool FloatingBaseModel< T >::_forcePropagatorsUpToDate = false |
Definition at line 308 of file FloatingBaseModel.h.
vectorAligned<SVec<T> > FloatingBaseModel< T >::_frot |
Definition at line 273 of file FloatingBaseModel.h.
vectorAligned<SVec<T> > FloatingBaseModel< T >::_fvp |
Definition at line 273 of file FloatingBaseModel.h.
vectorAligned<SVec<T> > FloatingBaseModel< T >::_fvprot |
Definition at line 273 of file FloatingBaseModel.h.
DVec<T> FloatingBaseModel< T >::_G |
Definition at line 283 of file FloatingBaseModel.h.
vector<Vec3<T> > FloatingBaseModel< T >::_gcLocation |
Definition at line 253 of file FloatingBaseModel.h.
vector<size_t> FloatingBaseModel< T >::_gcParent |
Definition at line 252 of file FloatingBaseModel.h.
vector<T> FloatingBaseModel< T >::_gearRatios |
Definition at line 241 of file FloatingBaseModel.h.
Vec3<T> FloatingBaseModel< T >::_gravity |
Definition at line 239 of file FloatingBaseModel.h.
DMat<T> FloatingBaseModel< T >::_H |
Definition at line 282 of file FloatingBaseModel.h.
vectorAligned<Mat6<T> > FloatingBaseModel< T >::_IA |
Definition at line 280 of file FloatingBaseModel.h.
vector<SpatialInertia<T>, Eigen::aligned_allocator<SpatialInertia<T> > > FloatingBaseModel< T >::_Ibody |
Definition at line 247 of file FloatingBaseModel.h.
vectorAligned<SpatialInertia<T> > FloatingBaseModel< T >::_IC |
Definition at line 279 of file FloatingBaseModel.h.
Eigen::ColPivHouseholderQR<Mat6<T> > FloatingBaseModel< T >::_invIA5 |
Definition at line 313 of file FloatingBaseModel.h.
vector<SpatialInertia<T>, Eigen::aligned_allocator<SpatialInertia<T> > > FloatingBaseModel< T >::_Irot |
Definition at line 247 of file FloatingBaseModel.h.
vectorAligned<D6Mat<T> > FloatingBaseModel< T >::_J |
Definition at line 285 of file FloatingBaseModel.h.
vectorAligned<D3Mat<T> > FloatingBaseModel< T >::_Jc |
Definition at line 288 of file FloatingBaseModel.h.
vectorAligned<Vec3<T> > FloatingBaseModel< T >::_Jcdqd |
Definition at line 289 of file FloatingBaseModel.h.
vectorAligned<SVec<T> > FloatingBaseModel< T >::_Jdqd |
Definition at line 286 of file FloatingBaseModel.h.
vector<CoordinateAxis> FloatingBaseModel< T >::_jointAxes |
Definition at line 245 of file FloatingBaseModel.h.
vector<JointType> FloatingBaseModel< T >::_jointTypes |
Definition at line 244 of file FloatingBaseModel.h.
bool FloatingBaseModel< T >::_kinematicsUpToDate = false |
Definition at line 291 of file FloatingBaseModel.h.
size_t FloatingBaseModel< T >::_nDof = 0 |
Definition at line 238 of file FloatingBaseModel.h.
size_t FloatingBaseModel< T >::_nGroundContact = 0 |
Definition at line 251 of file FloatingBaseModel.h.
vectorAligned<SVec<T> > FloatingBaseModel< T >::_pA |
Definition at line 276 of file FloatingBaseModel.h.
vector<int> FloatingBaseModel< T >::_parents |
Definition at line 240 of file FloatingBaseModel.h.
vectorAligned<SVec<T> > FloatingBaseModel< T >::_pArot |
Definition at line 276 of file FloatingBaseModel.h.
vector<Vec3<T> > FloatingBaseModel< T >::_pGC |
Definition at line 256 of file FloatingBaseModel.h.
DMat<T> FloatingBaseModel< T >::_qdd_from_base_accel |
Definition at line 311 of file FloatingBaseModel.h.
DMat<T> FloatingBaseModel< T >::_qdd_from_subqdd |
Definition at line 312 of file FloatingBaseModel.h.
bool FloatingBaseModel< T >::_qddEffectsUpToDate = false |
Definition at line 309 of file FloatingBaseModel.h.
vectorAligned<SVec<T> > FloatingBaseModel< T >::_S |
Definition at line 273 of file FloatingBaseModel.h.
vectorAligned<SVec<T> > FloatingBaseModel< T >::_Srot |
Definition at line 273 of file FloatingBaseModel.h.
FBModelState<T> FloatingBaseModel< T >::_state |
BEGIN ALGORITHM SUPPORT VARIABLES.
Definition at line 270 of file FloatingBaseModel.h.
vector<T> FloatingBaseModel< T >::_u |
Definition at line 242 of file FloatingBaseModel.h.
vectorAligned<SVec<T> > FloatingBaseModel< T >::_U |
Definition at line 276 of file FloatingBaseModel.h.
vectorAligned<SVec<T> > FloatingBaseModel< T >::_Urot |
Definition at line 276 of file FloatingBaseModel.h.
vectorAligned<SVec<T> > FloatingBaseModel< T >::_Utot |
Definition at line 276 of file FloatingBaseModel.h.
vectorAligned<SVec<T> > FloatingBaseModel< T >::_v |
Definition at line 273 of file FloatingBaseModel.h.
vector<Vec3<T> > FloatingBaseModel< T >::_vGC |
Definition at line 257 of file FloatingBaseModel.h.
vectorAligned<SVec<T> > FloatingBaseModel< T >::_vrot |
Definition at line 273 of file FloatingBaseModel.h.
vectorAligned<Mat6<T> > FloatingBaseModel< T >::_Xa |
Definition at line 280 of file FloatingBaseModel.h.
vector<Mat6<T>, Eigen::aligned_allocator<Mat6<T> > > FloatingBaseModel< T >::_Xrot |
Definition at line 246 of file FloatingBaseModel.h.
vector<Mat6<T>, Eigen::aligned_allocator<Mat6<T> > > FloatingBaseModel< T >::_Xtree |
Definition at line 246 of file FloatingBaseModel.h.
vectorAligned<Mat6<T> > FloatingBaseModel< T >::_Xup |
Definition at line 280 of file FloatingBaseModel.h.
vectorAligned<Mat6<T> > FloatingBaseModel< T >::_Xuprot |
Definition at line 280 of file FloatingBaseModel.h.