8 #ifndef __RDL_SPATIAL_RIGID_BODY_INERTIA_HPP__ 9 #define __RDL_SPATIAL_RIGID_BODY_INERTIA_HPP__ 75 const double Izy,
const double Izz)
136 inertia_a += inertia_b;
139 typedef std::vector<SpatialInertia, Eigen::aligned_allocator<SpatialInertia>>
SpatialInertiaV;
143 #endif //__SPATIAL_RIGID_BODY_INERTIA_HPP__
RigidBodyInertia toRigidBodyInertia() const
Get a copy of a Math::SpatialInertia as type Math::RigidBodyInertia.
ReferenceFramePtr getReferenceFrame() const
Get a pointer to the reference frame this FrameObject is expressed in.
TransformableGeometricObject * getTransformableGeometricObject()
Pure virtual method that FrameObjects are required to implement so the FrameObject::changeFrame metho...
SpatialInertia(ReferenceFramePtr referenceFrame)
Constructor.
SpatialInertia(ReferenceFramePtr referenceFrame, double mass, const Vector3d &com_mass, const Matrix3d &inertia)
Constructor.
ReferenceFramePtr referenceFrame
void operator+=(const RigidBodyInertia &rbi)
Overloaded plus-equals operator. Adds two inertia matrices.
FramePoint operator+(FramePoint p, const FrameVector &v)
See V. Duindum p39-40 & Featherstone p32-33.
void checkReferenceFramesMatch(const FrameObject *frameObject) const
Check if two ReferenceFrameHolders hold the same ReferenceFrame.
std::shared_ptr< ReferenceFrame > ReferenceFramePtr
This class stores a bodies mass, center of mass, and inertia information. The inertia elements are st...
A Math::SpatialInertia is a RigidBodyInertia explicitly expressed in a RobotDynamics::ReferenceFrame...
SpatialInertia(ReferenceFramePtr referenceFrame, double m, const Vector3d &h, const double Ixx, const double Iyx, const double Iyy, const double Izx, const double Izy, const double Izz)
Constructor.
SpatialInertia()
Empty constructor. Initializes FrameObject::referenceFrame to nullptr.
std::vector< SpatialInertia, Eigen::aligned_allocator< SpatialInertia > > SpatialInertiaV
RigidBodyInertia()
Constructor.
SpatialAcceleration. For clarity, the ReferenceFrames are stated as follows. A spatial acceleration i...
RobotDynamics::Math::SpatialForce operator*(const RobotDynamics::Math::SpatialAcceleration &a)
A SpatialForce is a spatial vector with the angular part being three moments and the linear part bein...
SpatialInertia(const SpatialInertia &inertia)
Copy constructor.
SpatialInertia(ReferenceFramePtr referenceFrame, const RigidBodyInertia &inertia)
Constructor.
An interface that objects with a ReferenceFrame extend to inherit the FrameObject::changeFrame method...
Namespace for all structures of the RobotDynamics library.
void operator+=(const SpatialInertia &spatialInertia)
Overloaded += operator. Performs frame checks.
SpatialVector timesSpatialVector(const SpatialVector &v) const
Multiply a Math::RigidBodyInertia by a Math::SpatialVector and return the result as a new Math::Spati...