Unit tests for NavState. More...
#include <gtsam/navigation/NavState.h>
#include <gtsam/base/lieProxies.h>
#include <gtsam/base/numericalDerivative.h>
#include <gtsam/base/TestableAssertions.h>
#include <gtsam/base/testLie.h>
#include <CppUnitLite/TestHarness.h>
Go to the source code of this file.
Namespaces | |
screwNavState | |
Functions | |
Point3 | screwNavState::expectedP (0.29552, 0.0446635, 1) |
Rot3 | screwNavState::expectedR (c, -s, 0, s, c, 0, 0, 0, 1) |
Point3 | screwNavState::expectedV (0.29552, 0.0446635, 1) |
static const Vector3 | kGravity (0, 0, 9.81) |
static const Vector3 | kOmegaCoriolis (0.02, 0.03, 0.04) |
static const Point3 | kPosition (1.0, 2.0, 3.0) |
static const Velocity3 | kVelocity (0.4, 0.5, 0.6) |
int | main () |
static const Point3 | P (0.2, 0.7, -2) |
static const Point3 | P2 (3.5, -8.2, 4.2) |
TEST (NavState, Adjoint_compose_full) | |
TEST (NavState, Adjoint_full) | |
TEST (NavState, adjointMap) | |
TEST (NavState, Attitude) | |
TEST (NavState, Between) | |
TEST (NavState, BodyVelocity) | |
TEST (NavState, ChartDerivatives) | |
TEST (NavState, Compose) | |
TEST (NavState, Compose2) | |
TEST (NavState, Compose_Inverse) | |
TEST (NavState, Constructor) | |
TEST (NavState, Constructor2) | |
TEST (NavState, Coriolis) | |
TEST (NavState, Coriolis2) | |
TEST (NavState, Coriolis3) | |
TEST (NavState, CorrectPIM) | |
TEST (NavState, Equals) | |
TEST (NavState, Expmap_A_Full) | |
TEST (NavState, Expmap_b) | |
TEST (NavState, expmap_logmap) | |
TEST (NavState, ExpmapDerivative1) | |
TEST (NavState, interpolate) | |
TEST (NavState, Invariants) | |
TEST (NavState, Inverse) | |
TEST (NavState, InverseDerivatives) | |
TEST (NavState, LieGroupDerivatives) | |
TEST (NavState, LogmapDerivative) | |
TEST (NavState, Manifold) | |
TEST (NavState, manifold_expmap) | |
TEST (NavState, Position) | |
TEST (NavState, Print) | |
TEST (NavState, Retract_first_order) | |
TEST (NavState, Retract_LocalCoordinates) | |
TEST (NavState, retract_localCoordinates) | |
TEST (NavState, retract_localCoordinates2) | |
TEST (NavState, RetractExpmap) | |
TEST (NavState, Stream) | |
TEST (NavState, subgroups) | |
TEST (NavState, Velocity) | |
static const Point3 | V (3, 0.4, -2.2) |
static const Point3 | V2 (-6.5, 3.5, 6.2) |
Variables | |
double | screwNavState::a = 0.3 |
double | screwNavState::c = cos(a) |
std::function< Vector9(const NavState &, const bool &)> | coriolis |
static const double | dt = 2.0 |
NavState | screwNavState::expected (expectedR, expectedV, expectedP) |
static const Rot3 | kAttitude = Rot3::RzRyRx(0.1, 0.2, 0.3) |
static const NavState | kIdentity |
static const Pose3 | kPose (kAttitude, kPosition) |
static const NavState | kState1 (kAttitude, kPosition, kVelocity) |
static const Vector9 | kZeroXi = Vector9::Zero() |
static const Rot3 | R = Rot3::Rodrigues(0.3, 0, 0) |
double | screwNavState::s = sin(a) |
static const NavState | T (R, P2, V2) |
static const NavState | T2 (Rot3::Rodrigues(0.3, 0.2, 0.1), P2, V2) |
static const NavState | T3 (Rot3::Rodrigues(-90, 0, 0), Point3(5, 6, 7), Point3(1, 2, 3)) |
double | screwNavState::w = 0.3 |
Vector | screwNavState::xi = (Vector(9) << 0.0, 0.0, w, w, 0.0, 1.0, w, 0.0, 1.0).finished() |
|
static |
|
static |
|
static |
|
static |
int main | ( | ) |
Definition at line 685 of file testNavState.cpp.
|
static |
|
static |
TEST | ( | NavState | , |
Adjoint_compose_full | |||
) |
Definition at line 524 of file testNavState.cpp.
TEST | ( | NavState | , |
Adjoint_full | |||
) |
Definition at line 509 of file testNavState.cpp.
TEST | ( | NavState | , |
adjointMap | |||
) |
Definition at line 602 of file testNavState.cpp.
TEST | ( | NavState | , |
Attitude | |||
) |
Definition at line 89 of file testNavState.cpp.
Definition at line 295 of file testNavState.cpp.
TEST | ( | NavState | , |
BodyVelocity | |||
) |
Definition at line 121 of file testNavState.cpp.
TEST | ( | NavState | , |
ChartDerivatives | |||
) |
Definition at line 674 of file testNavState.cpp.
TEST | ( | NavState | , |
Compose | |||
) |
Definition at line 198 of file testNavState.cpp.
TEST | ( | NavState | , |
Compose2 | |||
) |
Definition at line 229 of file testNavState.cpp.
TEST | ( | NavState | , |
Compose_Inverse | |||
) |
Definition at line 288 of file testNavState.cpp.
TEST | ( | NavState | , |
Constructor | |||
) |
Definition at line 56 of file testNavState.cpp.
TEST | ( | NavState | , |
Constructor2 | |||
) |
Definition at line 76 of file testNavState.cpp.
TEST | ( | NavState | , |
Coriolis | |||
) |
Definition at line 331 of file testNavState.cpp.
TEST | ( | NavState | , |
Coriolis2 | |||
) |
Definition at line 342 of file testNavState.cpp.
TEST | ( | NavState | , |
Coriolis3 | |||
) |
Consider a massless planet with an attached nav frame at n_omega = [0 0 1]', and a body at position n_t = [1 0 0]', travelling with velocity n_v = [0 1 0]'. Orient the body so that it is not instantaneously aligned with the nav frame (i.e., nRb != I_3x3). Test that first and second order Coriolis corrections are as expected.
Definition at line 355 of file testNavState.cpp.
TEST | ( | NavState | , |
CorrectPIM | |||
) |
Definition at line 399 of file testNavState.cpp.
TEST | ( | NavState | , |
Equals | |||
) |
Definition at line 189 of file testNavState.cpp.
TEST | ( | NavState | , |
Expmap_A_Full | |||
) |
Definition at line 469 of file testNavState.cpp.
TEST | ( | NavState | , |
Expmap_b | |||
) |
Definition at line 487 of file testNavState.cpp.
TEST | ( | NavState | , |
expmap_logmap | |||
) |
Definition at line 554 of file testNavState.cpp.
TEST | ( | NavState | , |
ExpmapDerivative1 | |||
) |
Definition at line 616 of file testNavState.cpp.
TEST | ( | NavState | , |
interpolate | |||
) |
Definition at line 320 of file testNavState.cpp.
TEST | ( | NavState | , |
Invariants | |||
) |
Definition at line 649 of file testNavState.cpp.
Definition at line 249 of file testNavState.cpp.
TEST | ( | NavState | , |
InverseDerivatives | |||
) |
Definition at line 274 of file testNavState.cpp.
TEST | ( | NavState | , |
LieGroupDerivatives | |||
) |
Definition at line 664 of file testNavState.cpp.
TEST | ( | NavState | , |
LogmapDerivative | |||
) |
Definition at line 632 of file testNavState.cpp.
TEST | ( | NavState | , |
Manifold | |||
) |
Definition at line 132 of file testNavState.cpp.
TEST | ( | NavState | , |
manifold_expmap | |||
) |
Definition at line 572 of file testNavState.cpp.
TEST | ( | NavState | , |
Position | |||
) |
Definition at line 99 of file testNavState.cpp.
TEST | ( | NavState | , |
) |
Definition at line 428 of file testNavState.cpp.
TEST | ( | NavState | , |
Retract_first_order | |||
) |
Definition at line 442 of file testNavState.cpp.
TEST | ( | NavState | , |
Retract_LocalCoordinates | |||
) |
Definition at line 537 of file testNavState.cpp.
TEST | ( | NavState | , |
retract_localCoordinates | |||
) |
Definition at line 546 of file testNavState.cpp.
TEST | ( | NavState | , |
retract_localCoordinates2 | |||
) |
Definition at line 561 of file testNavState.cpp.
TEST | ( | NavState | , |
RetractExpmap | |||
) |
Definition at line 459 of file testNavState.cpp.
TEST | ( | NavState | , |
Stream | |||
) |
Definition at line 414 of file testNavState.cpp.
TEST | ( | NavState | , |
subgroups | |||
) |
Definition at line 586 of file testNavState.cpp.
TEST | ( | NavState | , |
Velocity | |||
) |
Definition at line 110 of file testNavState.cpp.
|
static |
|
static |
std::function<Vector9(const NavState&, const bool&)> coriolis |
Definition at line 327 of file testNavState.cpp.
|
static |
Definition at line 326 of file testNavState.cpp.
|
static |
Definition at line 35 of file testNavState.cpp.
|
static |
Definition at line 39 of file testNavState.cpp.
|
static |
Definition at line 43 of file testNavState.cpp.
|
static |
Definition at line 47 of file testNavState.cpp.