Unit tests for Conditional gaussian. More...
#include <CppUnitLite/TestHarness.h>#include <gtsam/base/TestableAssertions.h>#include <gtsam/base/Matrix.h>#include <gtsam/base/VerticalBlockMatrix.h>#include <gtsam/inference/Symbol.h>#include <gtsam/linear/JacobianFactor.h>#include <gtsam/linear/GaussianConditional.h>#include <gtsam/linear/GaussianDensity.h>#include <gtsam/linear/GaussianBayesNet.h>#include <gtsam/hybrid/HybridValues.h>#include <iostream>#include <sstream>#include <vector>
Go to the source code of this file.
Namespaces | |
| density | |
Typedefs | |
| using | Dims = std::vector< Eigen::Index > |
Functions | |
| int | main () |
| TEST (GaussianConditional, constructor) | |
| TEST (GaussianConditional, equals) | |
| TEST (GaussianConditional, Error) | |
| TEST (GaussianConditional, Evaluate1) | |
| TEST (GaussianConditional, Evaluate2) | |
| TEST (GaussianConditional, FromMeanAndStddev) | |
| TEST (GaussianConditional, information) | |
| TEST (GaussianConditional, isGaussianFactor) | |
| TEST (GaussianConditional, likelihood) | |
| TEST (GaussianConditional, NegLogConstant) | |
| TEST (GaussianConditional, Print) | |
| TEST (GaussianConditional, Sample) | |
| TEST (GaussianConditional, solve) | |
| TEST (GaussianConditional, solve_multifrontal) | |
| TEST (GaussianConditional, solve_simple) | |
| TEST (GaussianConditional, solveTranspose) | |
Variables | |
| static const Key | density::key = 77 |
| static Matrix | R |
| static constexpr double | density::sigma = 3.0 |
| static const double | tol = 1e-5 |
| static const auto | density::unitPrior |
| static const auto | density::widerPrior |
Unit tests for Conditional gaussian.
Definition in file testGaussianConditional.cpp.
| using Dims = std::vector<Eigen::Index> |
Definition at line 46 of file testGaussianConditional.cpp.
| int main | ( | ) |
Definition at line 563 of file testGaussianConditional.cpp.
| TEST | ( | GaussianConditional | , |
| constructor | |||
| ) |
Definition at line 49 of file testGaussianConditional.cpp.
| TEST | ( | GaussianConditional | , |
| equals | |||
| ) |
Definition at line 100 of file testGaussianConditional.cpp.
| TEST | ( | GaussianConditional | , |
| Error | |||
| ) |
Definition at line 478 of file testGaussianConditional.cpp.
| TEST | ( | GaussianConditional | , |
| Evaluate1 | |||
| ) |
Definition at line 139 of file testGaussianConditional.cpp.
| TEST | ( | GaussianConditional | , |
| Evaluate2 | |||
| ) |
Definition at line 178 of file testGaussianConditional.cpp.
| TEST | ( | GaussianConditional | , |
| FromMeanAndStddev | |||
| ) |
Definition at line 387 of file testGaussianConditional.cpp.
| TEST | ( | GaussianConditional | , |
| information | |||
| ) |
Definition at line 342 of file testGaussianConditional.cpp.
| TEST | ( | GaussianConditional | , |
| isGaussianFactor | |||
| ) |
Definition at line 363 of file testGaussianConditional.cpp.
| TEST | ( | GaussianConditional | , |
| likelihood | |||
| ) |
Definition at line 417 of file testGaussianConditional.cpp.
| TEST | ( | GaussianConditional | , |
| NegLogConstant | |||
| ) |
Definition at line 495 of file testGaussianConditional.cpp.
| TEST | ( | GaussianConditional | , |
| ) |
Definition at line 509 of file testGaussianConditional.cpp.
| TEST | ( | GaussianConditional | , |
| Sample | |||
| ) |
Definition at line 444 of file testGaussianConditional.cpp.
| TEST | ( | GaussianConditional | , |
| solve | |||
| ) |
Definition at line 210 of file testGaussianConditional.cpp.
| TEST | ( | GaussianConditional | , |
| solve_multifrontal | |||
| ) |
Definition at line 275 of file testGaussianConditional.cpp.
| TEST | ( | GaussianConditional | , |
| solve_simple | |||
| ) |
Definition at line 243 of file testGaussianConditional.cpp.
| TEST | ( | GaussianConditional | , |
| solveTranspose | |||
| ) |
create small Chordal Bayes Net x <- y x y d 1 1 9 1 5
Definition at line 310 of file testGaussianConditional.cpp.
|
static |
Definition at line 42 of file testGaussianConditional.cpp.
|
static |
Definition at line 40 of file testGaussianConditional.cpp.