#include <CppUnitLite/TestHarness.h>
#include <gtsam/base/Testable.h>
#include <gtsam/base/numericalDerivative.h>
#include <gtsam/base/lieProxies.h>
#include <gtsam/geometry/Point3.h>
#include <gtsam/geometry/Rot3.h>
#include <gtsam/nonlinear/NonlinearFactorGraph.h>
#include <gtsam/nonlinear/GaussNewtonOptimizer.h>
#include <gtsam/inference/Symbol.h>
#include <gtsam/slam/BetweenFactor.h>
Go to the source code of this file.
Typedefs | |
typedef BetweenFactor< Rot3 > | Between |
typedef NonlinearFactorGraph | Graph |
Functions | |
int | main () |
TEST (Rot3, optimize) | |
typedef BetweenFactor<Rot3> Between |
Definition at line 31 of file testRot3Optimization.cpp.
typedef NonlinearFactorGraph Graph |
Definition at line 32 of file testRot3Optimization.cpp.
int main | ( | ) |
Definition at line 56 of file testRot3Optimization.cpp.
Definition at line 37 of file testRot3Optimization.cpp.