#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/Ordering.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 (ConcurrentIncrementalSmootherDL, calculateEstimate) | |
TEST (ConcurrentIncrementalSmootherDL, equals) | |
TEST (ConcurrentIncrementalSmootherDL, getDelta) | |
TEST (ConcurrentIncrementalSmootherDL, getFactors) | |
TEST (ConcurrentIncrementalSmootherDL, getLinearizationPoint) | |
TEST (ConcurrentIncrementalSmootherDL, synchronize_1) | |
TEST (ConcurrentIncrementalSmootherDL, synchronize_2) | |
TEST (ConcurrentIncrementalSmootherDL, synchronize_3) | |
TEST (ConcurrentIncrementalSmootherDL, synchronize_empty) | |
TEST (ConcurrentIncrementalSmootherDL, update_empty) | |
TEST (ConcurrentIncrementalSmootherDL, update_multiple) | |
int main | ( | ) |
Definition at line 599 of file testConcurrentIncrementalSmootherDL.cpp.
TEST | ( | ConcurrentIncrementalSmootherDL | , |
calculateEstimate | |||
) |
Definition at line 210 of file testConcurrentIncrementalSmootherDL.cpp.
TEST | ( | ConcurrentIncrementalSmootherDL | , |
equals | |||
) |
Definition at line 76 of file testConcurrentIncrementalSmootherDL.cpp.
TEST | ( | ConcurrentIncrementalSmootherDL | , |
getDelta | |||
) |
Definition at line 204 of file testConcurrentIncrementalSmootherDL.cpp.
TEST | ( | ConcurrentIncrementalSmootherDL | , |
getFactors | |||
) |
Definition at line 102 of file testConcurrentIncrementalSmootherDL.cpp.
TEST | ( | ConcurrentIncrementalSmootherDL | , |
getLinearizationPoint | |||
) |
Definition at line 153 of file testConcurrentIncrementalSmootherDL.cpp.
TEST | ( | ConcurrentIncrementalSmootherDL | , |
synchronize_1 | |||
) |
Definition at line 385 of file testConcurrentIncrementalSmootherDL.cpp.
TEST | ( | ConcurrentIncrementalSmootherDL | , |
synchronize_2 | |||
) |
Definition at line 445 of file testConcurrentIncrementalSmootherDL.cpp.
TEST | ( | ConcurrentIncrementalSmootherDL | , |
synchronize_3 | |||
) |
Definition at line 524 of file testConcurrentIncrementalSmootherDL.cpp.
TEST | ( | ConcurrentIncrementalSmootherDL | , |
synchronize_empty | |||
) |
Definition at line 355 of file testConcurrentIncrementalSmootherDL.cpp.
TEST | ( | ConcurrentIncrementalSmootherDL | , |
update_empty | |||
) |
Definition at line 284 of file testConcurrentIncrementalSmootherDL.cpp.
TEST | ( | ConcurrentIncrementalSmootherDL | , |
update_multiple | |||
) |
Definition at line 297 of file testConcurrentIncrementalSmootherDL.cpp.