8 #ifndef __RDL_SPATIAL_FORCE_HPP__ 9 #define __RDL_SPATIAL_FORCE_HPP__ 182 this->
mx() += f.
mx();
183 this->
my() += f.
my();
184 this->
mz() += f.
mz();
186 this->
fx() += f.
fx();
187 this->
fy() += f.
fy();
188 this->
fz() += f.
fz();
202 this->
mx() -= f.
mx();
203 this->
my() -= f.
my();
204 this->
mz() -= f.
mz();
206 this->
fx() -= f.
fx();
207 this->
fy() -= f.
fy();
208 this->
fz() -= f.
fz();
248 typedef std::vector<SpatialForce, Eigen::aligned_allocator<SpatialForce>>
SpatialForceV;
252 #endif // ifndef __RDL_SPATIAL_FORCE_HPP__ Math::TransformableGeometricObject * getTransformableGeometricObject()
Pure virtual method that FrameObjects are required to implement so the FrameObject::changeFrame metho...
SpatialForce()
Constructor. RobotDynamics::FrameObject::referenceFrame is initialized to nullptr.
SpatialForce(ReferenceFramePtr referenceFrame, const double mx, const double my, const double mz, const double fx, const double fy, const double fz)
Constructor.
EIGEN_STRONG_INLINE void set(const double &v0, const double &v1, const double &v2, const double &v3, const double &v4, const double &v5)
std::vector< SpatialForce, Eigen::aligned_allocator< SpatialForce > > SpatialForceV
SpatialForce(const SpatialForce &spatialForce)
Copy constructor.
void setIncludingFrame(ReferenceFramePtr referenceFrame, const SpatialVector &v)
ForceVector operator*(const SpatialTransform &X, ForceVector f)
Operator for transforming a ForceVector. Calls the ForceVector::transform method. ...
SpatialForce(ReferenceFramePtr referenceFrame, const SpatialVector &spatialVector)
Constructor.
FrameVector getFramedLinearPart() const
Get linear part of spatial force as a frame vector.
void setIncludingFrame(ReferenceFramePtr referenceFrame, const Vector3d &m, const Vector3d &f)
ReferenceFramePtr referenceFrame
A ForceVector is a SpatialVector containing 3 moments and 3 linear forces.
SpatialForce(ReferenceFramePtr referenceFrame)
Constructor. Force vector elements will be zero.
EIGEN_STRONG_INLINE ForceVector()
Empty constructor.
EIGEN_STRONG_INLINE double & fy()
Get reference to y-linear component.
FramePoint operator+(FramePoint p, const FrameVector &v)
void checkReferenceFramesMatch(const FrameObject *frameObject) const
Check if two ReferenceFrameHolders hold the same ReferenceFrame.
EIGEN_STRONG_INLINE double & fx()
Get reference to x-linear component.
EIGEN_STRONG_INLINE double & fz()
Get reference to z-linear component.
SpatialForce(ReferenceFramePtr referenceFrame, const Vector3d &m, const Vector3d f)
Constructor.
SpatialForce operator-=(const SpatialForce &f)
Overloaded -= operator. Frame checks are performed.
FrameVector getFramedAngularPart() const
Get angular part of spatial force as a frame vector.
std::shared_ptr< ReferenceFrame > ReferenceFramePtr
EIGEN_STRONG_INLINE double & my()
Get reference to y-angular component.
virtual void changeFrame(ReferenceFramePtr desiredFrame)
Change the ReferenceFrame this FrameObject is expressed in.
A FrameVector is a 3D vector with a ReferenceFrame, and all operations between FrameVectors and other...
EIGEN_STRONG_INLINE double & mz()
Get reference to z-angular component.
void setIncludingFrame(ReferenceFramePtr referenceFrame, double wx, double wy, double wz, double vx, double vy, double vz)
EIGEN_STRONG_INLINE Vector3d getAngularPart() const
FramePoint operator-(FramePoint p, const FrameVector &v)
A SpatialForce is a spatial vector with the angular part being three moments and the linear part bein...
SpatialForce operator*=(double scale)
Operator for scaling a spatial force vector.
EIGEN_STRONG_INLINE double & mx()
Get reference to x-angular component.
EIGEN_STRONG_INLINE Vector3d getLinearPart() const
SpatialForce operator+=(const SpatialForce &f)
Overloaded += operator. Frame checks are performed.
SpatialForce changeFrameAndCopy(ReferenceFramePtr referenceFrame) const
Copy and change frame.
ForceVector toForceVector() const
Get copy of this SpatialForce as type ForceVector.
An interface that objects with a ReferenceFrame extend to inherit the FrameObject::changeFrame method...
Namespace for all structures of the RobotDynamics library.