A 2D Pose SLAM example using the SimpleSPCGSolver. More...
#include <gtsam/slam/BetweenFactor.h>
#include <gtsam/geometry/Pose2.h>
#include <gtsam/nonlinear/LevenbergMarquardtOptimizer.h>
#include <gtsam/linear/SubgraphSolver.h>
Go to the source code of this file.
Functions | |
int | main (int argc, char **argv) |
A 2D Pose SLAM example using the SimpleSPCGSolver.
Definition in file Pose2SLAMwSPCG.cpp.
Definition at line 30 of file Pose2SLAMwSPCG.cpp.