Test GTSAM on large open-loop chains. More...
#include <gtsam/geometry/Cal3_S2Stereo.h>
#include <gtsam/geometry/Pose3.h>
#include <gtsam/nonlinear/GaussNewtonOptimizer.h>
#include <gtsam/nonlinear/LevenbergMarquardtOptimizer.h>
#include <gtsam/nonlinear/NonlinearEquality.h>
#include <gtsam/nonlinear/NonlinearFactorGraph.h>
#include <gtsam/nonlinear/Values.h>
#include <gtsam/slam/BetweenFactor.h>
#include <gtsam/slam/StereoFactor.h>
#include <random>
Go to the source code of this file.
Functions | |
int | main (int args, char *argv[]) |
void | testGtsam (int numberNodes) |
Definition at line 78 of file Pose2SLAMStressTest.cpp.
void testGtsam | ( | int | numberNodes | ) |
Definition at line 29 of file Pose2SLAMStressTest.cpp.