33 using namespace gtsam;
39 TEST(Manifold, SomeManifoldsGTSAM) {
48 TEST(Manifold, SomeLieGroupsGTSAM) {
56 TEST(Manifold, SomeVectorSpacesGTSAM) {
65 TEST(Manifold, _dimension) {
82 TEST(Manifold, DefaultChart) {
95 typedef Matrix2 ManifoldPoint;
138 Rot3 I = Rot3::Identity();
PinholeCamera< Cal3Bundler > Camera
static const Eigen::MatrixBase< Vector3 >::ConstantReturnType Z_3x1
#define GTSAM_CONCEPT_ASSERT(concept)
Concept check for values that can be used in unit tests.
static int runAllTests(TestResult &result)
bool assert_equal(const Matrix &expected, const Matrix &actual, double tol)
Rot2 R(Rot2::fromAngle(0.1))
Rot3 is a 3D rotation represented as a rotation matrix if the preprocessor symbol GTSAM_USE_QUATERNIO...
#define EXPECT_DOUBLES_EQUAL(expected, actual, threshold)
Base class for all pinhole cameras.
Base class and basic functions for Manifold types.
#define EXPECT(condition)
Array< int, Dynamic, 1 > v
Array< double, 1, 3 > e(1./3., 0.5, 2.)
TEST(Manifold, SomeManifoldsGTSAM)
#define EXPECT_LONGS_EQUAL(expected, actual)
Class retract(const TangentVector &v) const
retract as required by manifold concept: applies v at *this
Eigen::Matrix< double, Eigen::Dynamic, Eigen::Dynamic, Eigen::RowMajor > Matrix
The matrix class, also used for vectors and row-vectors.
Eigen::Matrix< double, Eigen::Dynamic, 1 > Vector
static const Eigen::MatrixBase< Vector2 >::ConstantReturnType Z_2x1
Calibration used by Bundler.
The most common 5DOF 3D->2D calibration.