Unit tests for the Incremental Fixed-Lag Smoother. More...
#include <gtsam_unstable/nonlinear/IncrementalFixedLagSmoother.h>
#include <gtsam/slam/BetweenFactor.h>
#include <gtsam/geometry/Point2.h>
#include <gtsam/nonlinear/NonlinearFactorGraph.h>
#include <gtsam/nonlinear/Values.h>
#include <gtsam/linear/GaussianBayesNet.h>
#include <gtsam/linear/GaussianFactorGraph.h>
#include <gtsam/inference/Key.h>
#include <gtsam/inference/Ordering.h>
#include <gtsam/inference/Symbol.h>
#include <gtsam/base/debug.h>
#include <CppUnitLite/TestHarness.h>
Go to the source code of this file.
Functions | |
bool | check_smoother (const NonlinearFactorGraph &fullgraph, const Values &fullinit, const IncrementalFixedLagSmoother &smoother, const Key &key) |
int | main () |
Key | MakeKey (size_t index) |
void | PrintSymbolicTree (const ISAM2 &isam, const std::string &label) |
void | PrintSymbolicTreeHelper (const ISAM2Clique::shared_ptr &clique, const std::string indent="") |
TEST (IncrementalFixedLagSmoother, Example) | |
Unit tests for the Incremental Fixed-Lag Smoother.
Definition in file testIncrementalFixedLagSmoother.cpp.
bool check_smoother | ( | const NonlinearFactorGraph & | fullgraph, |
const Values & | fullinit, | ||
const IncrementalFixedLagSmoother & | smoother, | ||
const Key & | key | ||
) |
Definition at line 40 of file testIncrementalFixedLagSmoother.cpp.
int main | ( | ) |
Definition at line 341 of file testIncrementalFixedLagSmoother.cpp.
Definition at line 37 of file testIncrementalFixedLagSmoother.cpp.
void PrintSymbolicTree | ( | const ISAM2 & | isam, |
const std::string & | label | ||
) |
Definition at line 75 of file testIncrementalFixedLagSmoother.cpp.
void PrintSymbolicTreeHelper | ( | const ISAM2Clique::shared_ptr & | clique, |
const std::string | indent = "" |
||
) |
Definition at line 53 of file testIncrementalFixedLagSmoother.cpp.
TEST | ( | IncrementalFixedLagSmoother | , |
Example | |||
) |
Definition at line 88 of file testIncrementalFixedLagSmoother.cpp.