#include <gtest/gtest.h>#include <iostream>#include "UnitTestUtils.hpp"#include "Fixtures.h"#include "rdl_dynamics/Kinematics.h"#include "rdl_dynamics/Dynamics.h"#include "rdl_dynamics/rdl_utils.h"
Go to the source code of this file.
Classes | |
| struct | RdlCustomEulerZYXJoint |
| struct | RdlCustomJointFixture |
Functions | |
| int | main (int argc, char **argv) |
| TEST_F (RdlCustomJointFixture, updateKinematics) | |
| TEST_F (RdlCustomJointFixture, updateKinematicsCustom) | |
| TEST_F (RdlCustomJointFixture, inverseDynamics) | |
| TEST_F (RdlCustomJointFixture, compositeRigidBodyAlgorithm) | |
| TEST_F (RdlCustomJointFixture, forwardDynamics) | |
| TEST_F (RdlCustomJointFixture, calcMInvTimesTau) | |
| TEST_F (RdlCustomJointFixture, nonlinearEffects) | |
| TEST_F (RdlCustomJointFixture, calcPointJacobian) | |
| TEST_F (RdlCustomJointFixture, calcPointJacobian6D) | |
| TEST_F (RdlCustomJointFixture, calcBodySpatialJacobian) | |
| TEST_F (RdlCustomJointFixture, calcBodySpatialJacobianDot) | |
| TEST_F (RdlCustomJointFixture, calcPointJacobianDot) | |
| TEST_F (RdlCustomJointFixture, calcCentroidalMomentumMatrix) | |
| TEST_F (RdlCustomJointFixture, calcCentroidalMomentumMatrixDot) | |
| TEST_F (RdlCustomJointFixture, calcPointJacobianDot6D) | |
| TEST_F (RdlCustomJointFixture, calcPointVelocity) | |
| TEST_F (RdlCustomJointFixture, calcPointVelocity6D) | |
| TEST_F (RdlCustomJointFixture, forwardDynamicsContacts) | |
Variables | |
| const double | TEST_PREC = 1.0e-12 |
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 550 of file RdlCustomJointTests.cpp.
| TEST_F | ( | RdlCustomJointFixture | , |
| updateKinematics | |||
| ) |
Definition at line 146 of file RdlCustomJointTests.cpp.
| TEST_F | ( | RdlCustomJointFixture | , |
| updateKinematicsCustom | |||
| ) |
Definition at line 166 of file RdlCustomJointTests.cpp.
| TEST_F | ( | RdlCustomJointFixture | , |
| inverseDynamics | |||
| ) |
Definition at line 204 of file RdlCustomJointTests.cpp.
| TEST_F | ( | RdlCustomJointFixture | , |
| compositeRigidBodyAlgorithm | |||
| ) |
Definition at line 222 of file RdlCustomJointTests.cpp.
| TEST_F | ( | RdlCustomJointFixture | , |
| forwardDynamics | |||
| ) |
Definition at line 240 of file RdlCustomJointTests.cpp.
| TEST_F | ( | RdlCustomJointFixture | , |
| calcMInvTimesTau | |||
| ) |
Definition at line 258 of file RdlCustomJointTests.cpp.
| TEST_F | ( | RdlCustomJointFixture | , |
| nonlinearEffects | |||
| ) |
Definition at line 277 of file RdlCustomJointTests.cpp.
| TEST_F | ( | RdlCustomJointFixture | , |
| calcPointJacobian | |||
| ) |
Definition at line 296 of file RdlCustomJointTests.cpp.
| TEST_F | ( | RdlCustomJointFixture | , |
| calcPointJacobian6D | |||
| ) |
Definition at line 317 of file RdlCustomJointTests.cpp.
| TEST_F | ( | RdlCustomJointFixture | , |
| calcBodySpatialJacobian | |||
| ) |
Definition at line 338 of file RdlCustomJointTests.cpp.
| TEST_F | ( | RdlCustomJointFixture | , |
| calcBodySpatialJacobianDot | |||
| ) |
Definition at line 359 of file RdlCustomJointTests.cpp.
| TEST_F | ( | RdlCustomJointFixture | , |
| calcPointJacobianDot | |||
| ) |
Definition at line 379 of file RdlCustomJointTests.cpp.
| TEST_F | ( | RdlCustomJointFixture | , |
| calcCentroidalMomentumMatrix | |||
| ) |
Definition at line 400 of file RdlCustomJointTests.cpp.
| TEST_F | ( | RdlCustomJointFixture | , |
| calcCentroidalMomentumMatrixDot | |||
| ) |
Definition at line 425 of file RdlCustomJointTests.cpp.
| TEST_F | ( | RdlCustomJointFixture | , |
| calcPointJacobianDot6D | |||
| ) |
Definition at line 445 of file RdlCustomJointTests.cpp.
| TEST_F | ( | RdlCustomJointFixture | , |
| calcPointVelocity | |||
| ) |
Definition at line 466 of file RdlCustomJointTests.cpp.
| TEST_F | ( | RdlCustomJointFixture | , |
| calcPointVelocity6D | |||
| ) |
Definition at line 487 of file RdlCustomJointTests.cpp.
| TEST_F | ( | RdlCustomJointFixture | , |
| forwardDynamicsContacts | |||
| ) |
Definition at line 509 of file RdlCustomJointTests.cpp.
| const double TEST_PREC = 1.0e-12 |
Definition at line 15 of file RdlCustomJointTests.cpp.