35 using namespace gtsam;
37 int main(
int argc,
char** argv) {
44 const auto model = noiseModel::Isotropic::Sigma(3, 1);
64 initial_estimate.insert(1, first_pose);
66 initial_estimate.insert(3,
Point3(1, 1, 5));
67 initial_estimate.insert(4,
Point3(-1, 1, 5));
68 initial_estimate.insert(5,
Point3(0, -0.5, 5));
74 result.
print(
"Final result:\n");
virtual const Values & optimize()
IsDerived< DERIVEDFACTOR > emplace_shared(Args &&... args)
Emplace a shared pointer to factor of given type.
A non-templated config holding any types of Manifold-group elements.
Factor Graph consisting of non-linear factors.
noiseModel::Diagonal::shared_ptr model
static Cal3_S2 K(500, 500, 0.1, 640/2, 480/2)
NonlinearFactorGraph graph
Rot3 is a 3D rotation represented as a rotation matrix if the preprocessor symbol GTSAM_USE_QUATERNIO...
void print(const std::string &str="", const KeyFormatter &keyFormatter=DefaultKeyFormatter) const
The most common 5DOF 3D->2D calibration, stereo version.
A nonlinear optimizer that uses the Levenberg-Marquardt trust-region scheme.
std::shared_ptr< Cal3_S2Stereo > shared_ptr
A non-linear factor for stereo measurements.
The most common 5DOF 3D->2D calibration + Stereo baseline.
int main(int argc, char **argv)