#include <CppUnitLite/TestHarness.h>
#include <gtsam/slam/BetweenFactor.h>
#include <gtsam/nonlinear/LinearContainerFactor.h>
#include <gtsam/linear/VectorValues.h>
#include <gtsam/linear/HessianFactor.h>
#include <gtsam/geometry/Pose2.h>
#include <gtsam/geometry/Point3.h>
#include <gtsam/base/TestableAssertions.h>
#include <boost/assign/std/vector.hpp>
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, generic_jacobian_factor) | |
TEST (testLinearContainerFactor, jacobian_factor_withlinpoints) | |
TEST (testLinearContainerFactor, generic_hessian_factor) | |
TEST (testLinearContainerFactor, hessian_factor_withlinpoints) | |
TEST (testLinearContainerFactor, creation) | |
TEST (testLinearContainerFactor, jacobian_relinearize) | |
TEST (testLinearContainerFactor, hessian_relinearize) | |
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 | ( | void | ) |
Definition at line 323 of file testLinearContainerFactor.cpp.
TEST | ( | testLinearContainerFactor | , |
generic_jacobian_factor | |||
) |
Definition at line 31 of file testLinearContainerFactor.cpp.
TEST | ( | testLinearContainerFactor | , |
jacobian_factor_withlinpoints | |||
) |
Definition at line 64 of file testLinearContainerFactor.cpp.
TEST | ( | testLinearContainerFactor | , |
generic_hessian_factor | |||
) |
Definition at line 118 of file testLinearContainerFactor.cpp.
TEST | ( | testLinearContainerFactor | , |
hessian_factor_withlinpoints | |||
) |
Definition at line 156 of file testLinearContainerFactor.cpp.
TEST | ( | testLinearContainerFactor | , |
creation | |||
) |
Definition at line 229 of file testLinearContainerFactor.cpp.
TEST | ( | testLinearContainerFactor | , |
jacobian_relinearize | |||
) |
Definition at line 255 of file testLinearContainerFactor.cpp.
TEST | ( | testLinearContainerFactor | , |
hessian_relinearize | |||
) |
Definition at line 289 of file testLinearContainerFactor.cpp.
const gtsam::noiseModel::Diagonal::shared_ptr diag_model2 = noiseModel::Diagonal::Sigmas(Vector2(1.0, 1.0)) |
Definition at line 22 of file testLinearContainerFactor.cpp.
gtsam::Key l1 = 101 |
Definition at line 25 of file testLinearContainerFactor.cpp.
gtsam::Key l2 = 102 |
Definition at line 25 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 23 of file testLinearContainerFactor.cpp.
gtsam::Key x1 = 1 |
Definition at line 25 of file testLinearContainerFactor.cpp.
gtsam::Key x2 = 2 |
Definition at line 25 of file testLinearContainerFactor.cpp.