A 3D Pose SLAM example that reads input from g2o, and initializes the Pose3 using InitializePose3 Syntax for the script is ./Pose3SLAMExample_g2o input.g2o output.g2o. More...
#include <gtsam/slam/dataset.h>
#include <gtsam/slam/BetweenFactor.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 3D Pose SLAM example that reads input from g2o, and initializes the Pose3 using InitializePose3 Syntax for the script is ./Pose3SLAMExample_g2o input.g2o output.g2o.
Definition in file Pose3SLAMExample_g2o.cpp.
Definition at line 28 of file Pose3SLAMExample_g2o.cpp.