|
| file | AcceleratedPowerMethod.h [code] |
| | accelerated power method for fast eigenvalue and eigenvector computation
|
| |
| file | BinaryJacobianFactor.h [code] |
| | A binary JacobianFactor specialization that uses fixed matrix math for speed.
|
| |
| file | ConjugateGradientSolver.cpp [code] |
| |
| file | ConjugateGradientSolver.h [code] |
| | Implementation of Conjugate Gradient solver for a linear system.
|
| |
| file | Errors.cpp [code] |
| | Factor Graph Values.
|
| |
| file | Errors.h [code] |
| | vector of errors
|
| |
| file | GaussianBayesNet.cpp [code] |
| | Chordal Bayes Net, the result of eliminating a factor graph.
|
| |
| file | GaussianBayesNet.h [code] |
| | Chordal Bayes Net, the result of eliminating a factor graph.
|
| |
| file | GaussianBayesTree-inl.h [code] |
| | Gaussian Bayes Tree, the result of eliminating a GaussianJunctionTree.
|
| |
| file | GaussianBayesTree.cpp [code] |
| | Gaussian Bayes Tree, the result of eliminating a GaussianJunctionTree.
|
| |
| file | GaussianBayesTree.h [code] |
| | Gaussian Bayes Tree, the result of eliminating a GaussianJunctionTree.
|
| |
| file | GaussianConditional-inl.h [code] |
| | Conditional Gaussian Base class.
|
| |
| file | GaussianConditional.cpp [code] |
| | Conditional Gaussian Base class.
|
| |
| file | GaussianConditional.h [code] |
| | Conditional Gaussian Base class.
|
| |
| file | GaussianDensity.cpp [code] |
| | A Gaussian Density.
|
| |
| file | GaussianDensity.h [code] |
| | A Gaussian Density.
|
| |
| file | GaussianEliminationTree.cpp [code] |
| |
| file | GaussianEliminationTree.h [code] |
| |
| file | GaussianFactor.cpp [code] |
| | A factor with a quadratic error function - a Gaussian.
|
| |
| file | GaussianFactor.h [code] |
| | A factor with a quadratic error function - a Gaussian.
|
| |
| file | GaussianFactorGraph.cpp [code] |
| | Linear Factor Graph where all factors are Gaussians.
|
| |
| file | GaussianFactorGraph.h [code] |
| | Linear Factor Graph where all factors are Gaussians.
|
| |
| file | GaussianISAM.cpp [code] |
| |
| file | GaussianISAM.h [code] |
| |
| file | GaussianJunctionTree.cpp [code] |
| |
| file | GaussianJunctionTree.h [code] |
| |
| file | HessianFactor-inl.h [code] |
| | Contains the HessianFactor class, a general quadratic factor.
|
| |
| file | HessianFactor.cpp [code] |
| |
| file | HessianFactor.h [code] |
| | Contains the HessianFactor class, a general quadratic factor.
|
| |
| file | iterative-inl.h [code] |
| | Iterative methods, template implementation.
|
| |
| file | iterative.cpp [code] |
| | Iterative methods, implementation.
|
| |
| file | iterative.h [code] |
| | Iterative methods, implementation.
|
| |
| file | IterativeSolver.cpp [code] |
| | Some support classes for iterative solvers.
|
| |
| file | IterativeSolver.h [code] |
| | Some support classes for iterative solvers.
|
| |
| file | JacobianFactor-inl.h [code] |
| |
| file | JacobianFactor.cpp [code] |
| |
| file | JacobianFactor.h [code] |
| |
| file | KalmanFilter.cpp [code] |
| | Simple linear Kalman filter. Implemented using factor graphs, i.e., does Cholesky-based SRIF, really.
|
| |
| file | KalmanFilter.h [code] |
| | Simple linear Kalman filter implemented using factor graphs, i.e., performs Cholesky or QR-based SRIF (Square-Root Information Filter).
|
| |
| file | linearAlgorithms-inst.h [code] |
| | Templated algorithms that are used in multiple places in linear.
|
| |
| file | linearExceptions.cpp [code] |
| | Exceptions that may be thrown by linear solver components.
|
| |
| file | linearExceptions.h [code] |
| | Exceptions that may be thrown by linear solver components.
|
| |
| file | LossFunctions.cpp [code] |
| |
| file | LossFunctions.h [code] |
| |
| file | NoiseModel.cpp [code] |
| |
| file | NoiseModel.h [code] |
| |
| file | PCGSolver.cpp [code] |
| |
| file | PCGSolver.h [code] |
| |
| file | PowerMethod.h [code] |
| | Power method for fast eigenvalue and eigenvector computation.
|
| |
| file | Preconditioner.cpp [code] |
| |
| file | Preconditioner.h [code] |
| |
| file | RegularHessianFactor.h [code] |
| | Specialized HessianFactor class for regular problems (fixed-size blocks).
|
| |
| file | RegularJacobianFactor.h [code] |
| | JacobianFactor class with fixed sized blcoks.
|
| |
| file | Sampler.cpp [code] |
| | sampling from a diagonal NoiseModel
|
| |
| file | Sampler.h [code] |
| | sampling from a NoiseModel
|
| |
| file | Scatter.cpp [code] |
| |
| file | Scatter.h [code] |
| | Maps global variable indices to slot indices.
|
| |
| file | SparseEigen.h [code] |
| | Utilities for creating Eigen sparse matrices (gtsam::SparseEigen)
|
| |
| file | SubgraphBuilder.cpp [code] |
| |
| file | SubgraphBuilder.h [code] |
| |
| file | SubgraphPreconditioner.cpp [code] |
| |
| file | SubgraphPreconditioner.h [code] |
| |
| file | SubgraphSolver.cpp [code] |
| | Subgraph Solver from IROS 2010.
|
| |
| file | SubgraphSolver.h [code] |
| | Subgraph Solver from IROS 2010.
|
| |
| file | VectorValues.cpp [code] |
| | Implementations for VectorValues.
|
| |
| file | VectorValues.h [code] |
| | Factor Graph Values.
|
| |