40 using namespace gtsam;
43 static double fov = 60;
44 static int w=640,
h=480;
68 n_measPixel << 10, 10, 10, 10, 10, 10;
69 const SharedDiagonal noiseProjection = noiseModel::Isotropic::Sigma(2, 1);
77 n_measPixel, noiseProjection, views,
l1,
K);
IsDerived< DERIVEDFACTOR > emplace_shared(Args &&... args)
Emplace a shared pointer to factor of given type.
static int runAllTests(TestResult &result)
A non-templated config holding any types of Manifold-group elements.
Wrap Jacobian and Hessian linear factors to allow simple injection into a nonlinear graph...
Factor Graph consisting of non-linear factors.
Calibration of a camera with radial distortion, calculations in base class Cal3DS2_Base.
Pose3 x2(Rot3::Ypr(0.0, 0.0, 0.0), l2)
NonlinearFactorGraph graph
static Cal3_S2::shared_ptr K(new Cal3_S2(fov, w, h))
std::shared_ptr< Cal3_S2 > shared_ptr
Incremental update functionality (ISAM2) for BayesTree, with fluid relinearization.
A nonlinear optimizer that uses the Levenberg-Marquardt trust-region scheme.
The most common 5DOF 3D->2D calibration.
Reprojection of a LANDMARK to a 2D point.
Pose3 x3(Rot3::Ypr(M_PI/4.0, 0.0, 0.0), l2)
noiseModel::Diagonal::shared_ptr SharedDiagonal
ADT create(const Signature &signature)
static SharedNoiseModel model(noiseModel::Unit::Create(2))
TEST(MultiProjectionFactor, create)
noiseModel::Base::shared_ptr SharedNoiseModel
The most common 5DOF 3D->2D calibration.