A visualSLAM example for the structure-from-motion problem on a simulated dataset This version uses iSAM2 to solve the problem incrementally. More...
#include "SFMdata.h"
#include <gtsam/geometry/Point2.h>
#include <gtsam/inference/Symbol.h>
#include <gtsam/nonlinear/ISAM2.h>
#include <gtsam/nonlinear/NonlinearFactorGraph.h>
#include <gtsam/nonlinear/Values.h>
#include <gtsam/slam/ProjectionFactor.h>
#include <vector>
Go to the source code of this file.
Functions | |
int | main (int argc, char *argv[]) |
A visualSLAM example for the structure-from-motion problem on a simulated dataset This version uses iSAM2 to solve the problem incrementally.
Definition in file VisualISAM2Example.cpp.
Definition at line 58 of file VisualISAM2Example.cpp.