A 2D Pose SLAM example that reads input from g2o, converts it to a factor graph and does the optimization. Output is written on a file, in g2o format Syntax for the script is ./Pose2SLAMExample_g2o input.g2o output.g2o. More...
#include <gtsam/slam/dataset.h>
#include <gtsam/geometry/Pose2.h>
#include <gtsam/nonlinear/GaussNewtonOptimizer.h>
#include <fstream>
Go to the source code of this file.
Functions | |
int | main (const int argc, const char *argv[]) |
A 2D Pose SLAM example that reads input from g2o, converts it to a factor graph and does the optimization. Output is written on a file, in g2o format Syntax for the script is ./Pose2SLAMExample_g2o input.g2o output.g2o.
Definition in file Pose2SLAMExample_g2o.cpp.
Definition at line 30 of file Pose2SLAMExample_g2o.cpp.