Unit tests for GaussianBayesNet. More...
#include <gtsam/linear/GaussianBayesNet.h>
#include <gtsam/linear/GaussianDensity.h>
#include <gtsam/linear/JacobianFactor.h>
#include <gtsam/linear/GaussianFactorGraph.h>
#include <gtsam/base/Testable.h>
#include <gtsam/base/numericalDerivative.h>
#include <gtsam/inference/Symbol.h>
#include <CppUnitLite/TestHarness.h>
#include <iostream>
#include <sstream>
Go to the source code of this file.
Namespaces | |
sampling | |
Functions | |
int | main () |
TEST (GaussianBayesNet, backSubstituteTranspose) | |
TEST (GaussianBayesNet, backSubstituteTransposeNoisy) | |
TEST (GaussianBayesNet, ComputeSteepestDescentPoint) | |
TEST (GaussianBayesNet, DeterminantTest) | |
TEST (GaussianBayesNet, Dot) | |
TEST (GaussianBayesNet, Evaluate1) | |
TEST (GaussianBayesNet, Evaluate2) | |
TEST (GaussianBayesNet, Matrix) | |
TEST (GaussianBayesNet, MatrixStress) | |
TEST (GaussianBayesNet, MonteCarloIntegration) | |
TEST (GaussianBayesNet, NoisyMatrix) | |
TEST (GaussianBayesNet, NoisyOptimize) | |
TEST (GaussianBayesNet, Optimize) | |
TEST (GaussianBayesNet, optimize3) | |
TEST (GaussianBayesNet, optimizeIncomplete) | |
TEST (GaussianBayesNet, ordering) | |
TEST (GaussianBayesNet, sample) | |
Variables | |
static const Key | _x_ = 11 |
static const Key | _y_ = 22 |
static const Key | _z_ = 33 |
static Matrix | sampling::A1 = (Matrix(2, 2) << 1., 2., 3., 4.).finished() |
static const Vector2 | sampling::b (10, 10) |
static const GaussianBayesNet | sampling::gbn |
static const Vector2 | sampling::mean (20, 40) |
static GaussianBayesNet | noisyBayesNet |
static const double | sampling::sigma = 0.01 |
static GaussianBayesNet | smallBayesNet |
Unit tests for GaussianBayesNet.
Definition in file testGaussianBayesNet.cpp.
int main | ( | ) |
Definition at line 385 of file testGaussianBayesNet.cpp.
TEST | ( | GaussianBayesNet | , |
backSubstituteTranspose | |||
) |
Definition at line 240 of file testGaussianBayesNet.cpp.
TEST | ( | GaussianBayesNet | , |
backSubstituteTransposeNoisy | |||
) |
Definition at line 259 of file testGaussianBayesNet.cpp.
TEST | ( | GaussianBayesNet | , |
ComputeSteepestDescentPoint | |||
) |
Definition at line 308 of file testGaussianBayesNet.cpp.
TEST | ( | GaussianBayesNet | , |
DeterminantTest | |||
) |
Definition at line 278 of file testGaussianBayesNet.cpp.
TEST | ( | GaussianBayesNet | , |
Dot | |||
) |
Definition at line 362 of file testGaussianBayesNet.cpp.
TEST | ( | GaussianBayesNet | , |
Evaluate1 | |||
) |
Definition at line 66 of file testGaussianBayesNet.cpp.
TEST | ( | GaussianBayesNet | , |
Evaluate2 | |||
) |
Definition at line 89 of file testGaussianBayesNet.cpp.
TEST | ( | GaussianBayesNet | , |
Matrix | |||
) |
Definition at line 50 of file testGaussianBayesNet.cpp.
TEST | ( | GaussianBayesNet | , |
MatrixStress | |||
) |
Definition at line 220 of file testGaussianBayesNet.cpp.
TEST | ( | GaussianBayesNet | , |
MonteCarloIntegration | |||
) |
Definition at line 196 of file testGaussianBayesNet.cpp.
TEST | ( | GaussianBayesNet | , |
NoisyMatrix | |||
) |
Definition at line 100 of file testGaussianBayesNet.cpp.
TEST | ( | GaussianBayesNet | , |
NoisyOptimize | |||
) |
Definition at line 123 of file testGaussianBayesNet.cpp.
TEST | ( | GaussianBayesNet | , |
Optimize | |||
) |
Definition at line 115 of file testGaussianBayesNet.cpp.
TEST | ( | GaussianBayesNet | , |
optimize3 | |||
) |
Definition at line 150 of file testGaussianBayesNet.cpp.
TEST | ( | GaussianBayesNet | , |
optimizeIncomplete | |||
) |
Definition at line 133 of file testGaussianBayesNet.cpp.
TEST | ( | GaussianBayesNet | , |
ordering | |||
) |
Definition at line 212 of file testGaussianBayesNet.cpp.
TEST | ( | GaussianBayesNet | , |
sample | |||
) |
Definition at line 177 of file testGaussianBayesNet.cpp.
|
static |
Definition at line 37 of file testGaussianBayesNet.cpp.
|
static |
Definition at line 37 of file testGaussianBayesNet.cpp.
|
static |
Definition at line 37 of file testGaussianBayesNet.cpp.
|
static |
Definition at line 43 of file testGaussianBayesNet.cpp.
|
static |
Definition at line 39 of file testGaussianBayesNet.cpp.