#include <gtest/gtest.h>#include "UnitTestUtils.hpp"#include <iostream>#include "Fixtures.h"#include "rdl_dynamics/Kinematics.h"#include "rdl_dynamics/Dynamics.h"#include "rdl_dynamics/Contacts.h"#include "rdl_dynamics/rdl_utils.h"#include <vector>
Go to the source code of this file.
Classes | |
| struct | CustomEulerZYXJoint |
| struct | CustomJointSingleBodyFixture |
| struct | CustomJointTypeRevoluteX |
Functions | |
| int | main (int argc, char **argv) |
| TEST_F (CustomJointSingleBodyFixture, UpdateKinematics) | |
| TEST_F (CustomJointSingleBodyFixture, UpdateKinematicsCustom) | |
| TEST_F (CustomJointSingleBodyFixture, Jacobians) | |
| TEST_F (CustomJointSingleBodyFixture, CentroidalMomentum) | |
| TEST_F (CustomJointSingleBodyFixture, InverseDynamics) | |
| TEST_F (CustomJointSingleBodyFixture, CompositeRigidBodyAlgorithm) | |
| TEST_F (CustomJointSingleBodyFixture, ForwardDynamics) | |
| TEST_F (CustomJointSingleBodyFixture, CalcMInvTimestau) | |
| TEST_F (CustomJointSingleBodyFixture, ForwardDynamicsContactsKokkevis) | |
Variables | |
| const int | NUMBER_OF_MODELS = 2 |
| const double | TEST_PREC = 2.0e-12 |
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 708 of file RdlCustomJointSingleBodyTests.cpp.
| TEST_F | ( | CustomJointSingleBodyFixture | , |
| UpdateKinematics | |||
| ) |
Definition at line 335 of file RdlCustomJointSingleBodyTests.cpp.
| TEST_F | ( | CustomJointSingleBodyFixture | , |
| UpdateKinematicsCustom | |||
| ) |
Definition at line 364 of file RdlCustomJointSingleBodyTests.cpp.
| TEST_F | ( | CustomJointSingleBodyFixture | , |
| Jacobians | |||
| ) |
Definition at line 399 of file RdlCustomJointSingleBodyTests.cpp.
| TEST_F | ( | CustomJointSingleBodyFixture | , |
| CentroidalMomentum | |||
| ) |
Definition at line 514 of file RdlCustomJointSingleBodyTests.cpp.
| TEST_F | ( | CustomJointSingleBodyFixture | , |
| InverseDynamics | |||
| ) |
Definition at line 538 of file RdlCustomJointSingleBodyTests.cpp.
| TEST_F | ( | CustomJointSingleBodyFixture | , |
| CompositeRigidBodyAlgorithm | |||
| ) |
Definition at line 563 of file RdlCustomJointSingleBodyTests.cpp.
| TEST_F | ( | CustomJointSingleBodyFixture | , |
| ForwardDynamics | |||
| ) |
Definition at line 605 of file RdlCustomJointSingleBodyTests.cpp.
| TEST_F | ( | CustomJointSingleBodyFixture | , |
| CalcMInvTimestau | |||
| ) |
Definition at line 629 of file RdlCustomJointSingleBodyTests.cpp.
| TEST_F | ( | CustomJointSingleBodyFixture | , |
| ForwardDynamicsContactsKokkevis | |||
| ) |
Definition at line 653 of file RdlCustomJointSingleBodyTests.cpp.
| const int NUMBER_OF_MODELS = 2 |
Definition at line 21 of file RdlCustomJointSingleBodyTests.cpp.
| const double TEST_PREC = 2.0e-12 |
Definition at line 20 of file RdlCustomJointSingleBodyTests.cpp.