|
static bool | checkFrameVectorPairEpsilonClose (const RobotDynamics::Math::FrameVectorPair &v1, const RobotDynamics::Math::FrameVectorPair &v2, const double epsilon) |
|
static bool | checkMatrix3dEpsilonClose (const RobotDynamics::Math::Matrix3d &t1, const RobotDynamics::Math::Matrix3d &t2, const double epsilon) |
|
static bool | checkMatrix3dEq (const RobotDynamics::Math::Matrix3d &t1, const RobotDynamics::Math::Matrix3d &t2) |
|
static bool | checkMatrixNdEpsilonClose (const RobotDynamics::Math::MatrixNd &t1, const RobotDynamics::Math::MatrixNd &t2, const double epsilon) |
|
static bool | checkMatrixNdEq (const RobotDynamics::Math::MatrixNd &t1, const RobotDynamics::Math::MatrixNd &t2) |
|
bool | checkModelZeroVectorsAndMatrices (RobotDynamics::Model &model) |
|
static bool | checkSpatialMatrixEpsilonClose (const RobotDynamics::Math::SpatialMatrix &t1, const RobotDynamics::Math::SpatialMatrix &t2, const double epsilon) |
|
static bool | checkSpatialVectorsEpsilonClose (const RobotDynamics::Math::SpatialVector &v1, const RobotDynamics::Math::SpatialVector &v2, const double epsilon) |
|
static bool | checkSpatialVectorsEq (const RobotDynamics::Math::SpatialVector &v1, const RobotDynamics::Math::SpatialVector &v2) |
|
static bool | checkVector3dEpsilonClose (const RobotDynamics::Math::Vector3d &v1, const RobotDynamics::Math::Vector3d &v2, const double epsilon) |
|
static bool | checkVector3dEq (const RobotDynamics::Math::Vector3d &v1, const RobotDynamics::Math::Vector3d &v2) |
|
static bool | checkVector4dEpsilonClose (const RobotDynamics::Math::Vector4d &v1, const RobotDynamics::Math::Vector4d &v2, const double epsilon) |
|
static bool | checkVector4dEq (const RobotDynamics::Math::Vector4d &v1, const RobotDynamics::Math::Vector4d &v2) |
|
static bool | checkVectorNdEpsilonClose (const RobotDynamics::Math::VectorNd &v1, const RobotDynamics::Math::VectorNd &v2, const double epsilon) |
|
static bool | checkVectorNdEq (const RobotDynamics::Math::VectorNd &v1, const RobotDynamics::Math::VectorNd &v2) |
|
static RobotDynamics::Math::SpatialTransform | createRandomSpatialTransform () |
|
static ReferenceFramePtr | createRandomUnchangingFrame (const std::string &frameName, ReferenceFramePtr parentFrame, const unsigned int movableBodyId) |
|
static ReferenceFramePtr | getARandomFrame (std::vector< ReferenceFramePtr > frames) |
|
template<typename T > |
static T | getRandomAngle () |
|
template<typename T > |
static T | getRandomNumber () |
|
template<typename T > |
static T | getRandomNumber (T min, T max) |
|
static Point3d | getRandomPoint3 () |
|
static RobotDynamics::Math::SpatialTransform | getTransformToRootByClimbingTree (ReferenceFramePtr frame) |
|
void | integrateEuler (Model &model, const Math::VectorNd &Q, const Math::VectorNd &QDot, Math::VectorNd &x, const Math::VectorNd &tau, double h, Math::SpatialForceV *f_ext=nullptr) |
| Using simple Euler integration, integrate the system dynamics one step. More...
|
|
void | integrateRk4 (Model &model, const Math::VectorNd &Q, const Math::VectorNd &QDot, Math::VectorNd &x, const Math::VectorNd &tau, double h, Math::SpatialForceV *f_ext=nullptr) |
| Using a Runge-Kutta 4th order algorithm, integrate the system dynamics one step. More...
|
|
static void | updateAllFrames (std::vector< ReferenceFramePtr > frames) |
|