#include <gtsam_unstable/nonlinear/ConcurrentIncrementalSmoother.h>
#include <gtsam/nonlinear/PriorFactor.h>
#include <gtsam/slam/BetweenFactor.h>
#include <gtsam/nonlinear/ISAM2.h>
#include <gtsam/nonlinear/LevenbergMarquardtOptimizer.h>
#include <gtsam/nonlinear/NonlinearFactorGraph.h>
#include <gtsam/nonlinear/LinearContainerFactor.h>
#include <gtsam/nonlinear/Values.h>
#include <gtsam/inference/Symbol.h>
#include <gtsam/inference/Key.h>
#include <gtsam/inference/JunctionTree.h>
#include <gtsam/geometry/Pose3.h>
#include <gtsam/base/TestableAssertions.h>
#include <CppUnitLite/TestHarness.h>
Go to the source code of this file.
Functions | |
int | main () |
TEST (ConcurrentIncrementalSmoother, removeFactors_topology_1) | |
TEST (ConcurrentIncrementalSmootherGN, calculateEstimate) | |
TEST (ConcurrentIncrementalSmootherGN, equals) | |
TEST (ConcurrentIncrementalSmootherGN, getDelta) | |
TEST (ConcurrentIncrementalSmootherGN, getFactors) | |
TEST (ConcurrentIncrementalSmootherGN, getLinearizationPoint) | |
TEST (ConcurrentIncrementalSmootherGN, synchronize_1) | |
TEST (ConcurrentIncrementalSmootherGN, synchronize_2) | |
TEST (ConcurrentIncrementalSmootherGN, synchronize_3) | |
TEST (ConcurrentIncrementalSmootherGN, synchronize_empty) | |
TEST (ConcurrentIncrementalSmootherGN, update_empty) | |
TEST (ConcurrentIncrementalSmootherGN, update_multiple) | |
int main | ( | ) |
Definition at line 814 of file testConcurrentIncrementalSmootherGN.cpp.
TEST | ( | ConcurrentIncrementalSmoother | , |
removeFactors_topology_1 | |||
) |
Definition at line 600 of file testConcurrentIncrementalSmootherGN.cpp.
TEST | ( | ConcurrentIncrementalSmootherGN | , |
calculateEstimate | |||
) |
Definition at line 209 of file testConcurrentIncrementalSmootherGN.cpp.
TEST | ( | ConcurrentIncrementalSmootherGN | , |
equals | |||
) |
Definition at line 75 of file testConcurrentIncrementalSmootherGN.cpp.
TEST | ( | ConcurrentIncrementalSmootherGN | , |
getDelta | |||
) |
Definition at line 203 of file testConcurrentIncrementalSmootherGN.cpp.
TEST | ( | ConcurrentIncrementalSmootherGN | , |
getFactors | |||
) |
Definition at line 101 of file testConcurrentIncrementalSmootherGN.cpp.
TEST | ( | ConcurrentIncrementalSmootherGN | , |
getLinearizationPoint | |||
) |
Definition at line 152 of file testConcurrentIncrementalSmootherGN.cpp.
TEST | ( | ConcurrentIncrementalSmootherGN | , |
synchronize_1 | |||
) |
Definition at line 384 of file testConcurrentIncrementalSmootherGN.cpp.
TEST | ( | ConcurrentIncrementalSmootherGN | , |
synchronize_2 | |||
) |
Definition at line 446 of file testConcurrentIncrementalSmootherGN.cpp.
TEST | ( | ConcurrentIncrementalSmootherGN | , |
synchronize_3 | |||
) |
Definition at line 525 of file testConcurrentIncrementalSmootherGN.cpp.
TEST | ( | ConcurrentIncrementalSmootherGN | , |
synchronize_empty | |||
) |
Definition at line 354 of file testConcurrentIncrementalSmootherGN.cpp.
TEST | ( | ConcurrentIncrementalSmootherGN | , |
update_empty | |||
) |
Definition at line 283 of file testConcurrentIncrementalSmootherGN.cpp.
TEST | ( | ConcurrentIncrementalSmootherGN | , |
update_multiple | |||
) |
Definition at line 296 of file testConcurrentIncrementalSmootherGN.cpp.