#include <CppUnitLite/TestHarness.h>
#include <gtsam/base/TestableAssertions.h>
#include <gtsam/geometry/Point3.h>
#include <gtsam/geometry/Pose2.h>
#include <gtsam/inference/Symbol.h>
#include <gtsam/linear/HessianFactor.h>
#include <gtsam/linear/VectorValues.h>
#include <gtsam/nonlinear/LinearContainerFactor.h>
#include <gtsam/slam/BetweenFactor.h>
Go to the source code of this file.
Functions | |
Point2 | landmark1 (5.0, 1.5) |
Point2 | landmark2 (7.0, 1.5) |
int | main () |
TEST (TestLinearContainerFactor, Creation) | |
TEST (TestLinearContainerFactor, generic_hessian_factor) | |
TEST (TestLinearContainerFactor, generic_jacobian_factor) | |
TEST (TestLinearContainerFactor, hessian_factor_withlinpoints) | |
TEST (TestLinearContainerFactor, hessian_relinearize) | |
TEST (TestLinearContainerFactor, jacobian_factor_withlinpoints) | |
TEST (TestLinearContainerFactor, jacobian_relinearize) | |
TEST (TestLinearContainerFactor, Rekey) | |
TEST (TestLinearContainerFactor, Rekey2) | |
Variables | |
const gtsam::noiseModel::Diagonal::shared_ptr | diag_model2 = noiseModel::Diagonal::Sigmas(Vector2(1.0, 1.0)) |
gtsam::Key | l1 = 101 |
gtsam::Key | l2 = 102 |
Pose2 | poseA1 (0.0, 0.0, 0.0) |
Pose2 | poseA2 (2.0, 0.0, 0.0) |
const double | tol = 1e-5 |
gtsam::Key | x1 = 1 |
gtsam::Key | x2 = 2 |
Definition in file testLinearContainerFactor.cpp.
Point2 landmark1 | ( | 5. | 0, |
1. | 5 | ||
) |
Point2 landmark2 | ( | 7. | 0, |
1. | 5 | ||
) |
int main | ( | ) |
Definition at line 392 of file testLinearContainerFactor.cpp.
TEST | ( | TestLinearContainerFactor | , |
Creation | |||
) |
Definition at line 228 of file testLinearContainerFactor.cpp.
TEST | ( | TestLinearContainerFactor | , |
generic_hessian_factor | |||
) |
Definition at line 117 of file testLinearContainerFactor.cpp.
TEST | ( | TestLinearContainerFactor | , |
generic_jacobian_factor | |||
) |
Definition at line 30 of file testLinearContainerFactor.cpp.
TEST | ( | TestLinearContainerFactor | , |
hessian_factor_withlinpoints | |||
) |
Definition at line 155 of file testLinearContainerFactor.cpp.
TEST | ( | TestLinearContainerFactor | , |
hessian_relinearize | |||
) |
Definition at line 288 of file testLinearContainerFactor.cpp.
TEST | ( | TestLinearContainerFactor | , |
jacobian_factor_withlinpoints | |||
) |
Definition at line 63 of file testLinearContainerFactor.cpp.
TEST | ( | TestLinearContainerFactor | , |
jacobian_relinearize | |||
) |
Definition at line 254 of file testLinearContainerFactor.cpp.
TEST | ( | TestLinearContainerFactor | , |
Rekey | |||
) |
Definition at line 322 of file testLinearContainerFactor.cpp.
TEST | ( | TestLinearContainerFactor | , |
Rekey2 | |||
) |
Definition at line 364 of file testLinearContainerFactor.cpp.
const gtsam::noiseModel::Diagonal::shared_ptr diag_model2 = noiseModel::Diagonal::Sigmas(Vector2(1.0, 1.0)) |
Definition at line 21 of file testLinearContainerFactor.cpp.
gtsam::Key l1 = 101 |
Definition at line 24 of file testLinearContainerFactor.cpp.
gtsam::Key l2 = 102 |
Definition at line 24 of file testLinearContainerFactor.cpp.
Pose2 poseA1(0.0, 0.0, 0.0) |
Pose2 poseA2(2.0, 0.0, 0.0) |
const double tol = 1e-5 |
Definition at line 22 of file testLinearContainerFactor.cpp.
gtsam::Key x1 = 1 |
Definition at line 24 of file testLinearContainerFactor.cpp.
gtsam::Key x2 = 2 |
Definition at line 24 of file testLinearContainerFactor.cpp.