Anchor.cpp [code] | Implementation of the anchor node |
Anchor.h [code] | Implementation of the anchor node |
bundleAdjust.cpp [code] | |
cameraParameters.h [code] | |
Cholesky.cpp [code] | Cholesky batch factorization using CHOLMOD by Tim Davis |
Cholesky.h [code] | Cholesky batch factorization using SuiteSparse by Tim Davis |
ChowLiuTree.cpp [code] | ChowLiuTree for information form Gaussian distributions |
ChowLiuTree.h [code] | ChowLiuTree for information form Gaussian distributions |
covariance.cpp [code] | Recovery of marginal covariance matrix, for details see Kaess09ras |
covariance.h [code] | Recovery of marginal covariance matrix |
Covariances.cpp [code] | Providing access to entries of the covariance |
Covariances.h [code] | Providing access to entries of the covariance |
Element.h [code] | Basic functionality for nodes and factors of a graph |
Factor.h [code] | Graph factor for iSAM |
featureTracking.cpp [code] | |
featureTracking_ocl.cpp [code] | |
glc.cpp [code] | Generic Linear Constraint functions |
glc.h [code] | Generic Linear Constraint functions |
GLCReparam.cpp [code] | Generic Linear Constraint Reparametrization |
GLCReparam.h [code] | Generic Linear Constraint Reparametrization |
Graph.h [code] | Basic graph for iSAM |
isam.h [code] | Main isam header file |
Jacobian.h [code] | Jacobian and terms |
Node.cpp [code] | A single variable node |
Node.h [code] | Graph node for iSAM |
Noise.h [code] | Various noise models |
numericalDiff.cpp [code] | Numerical differentiation |
numericalDiff.h [code] | Numerical differentiation |
OptimizationInterface.h [code] | Abstract base class for nonlinear optimizer |
Optimizer.cpp [code] | Class implementing batch and incremental nonlinear equation solvers |
Optimizer.h [code] | Class implementing batch and incremental nonlinear equation solvers |
OrderedSparseMatrix.cpp [code] | Adds column ordering to sparse matrix functionality for iSAM |
OrderedSparseMatrix.h [code] | Adds column ordering to sparse matrix functionality for iSAM |
Point2d.h [code] | Simple 2D point class |
Point3d.h [code] | Simple 3D point class |
Point3dh.h [code] | 3D homogeneous point class |
pointDefinition.h [code] | |
Pose2d.h [code] | Simple 2D pose class |
Pose3d.h [code] | 3D pose class |
processDepthmap.cpp [code] | |
Properties.h [code] | Properties class for easy access to internal parameters |
registerPointCloud.cpp [code] | |
robust.h [code] | Robust estimator functionality |
Rot3d.h [code] | 3D rotation class |
Slam.cpp [code] | SLAM implementation using iSAM |
Slam.h [code] | SLAM implementation using iSAM |
slam2d.h [code] | Provides specialized nodes and factors for 2D SLAM |
slam3d.h [code] | Provides specialized nodes and factors for 3D SLAM |
slam_depthmono.h [code] | Provides specialized nodes and factors for depthmono vision applications |
slam_monocular.h [code] | Provides nodes and factors for monocular vision applications |
slam_stereo.h [code] | Provides specialized nodes and factors for stereo vision applications |
SparseMatrix.cpp [code] | Sparse matrix functionality for iSAM |
SparseMatrix.h [code] | Sparse matrix functionality for iSAM |
SparseSystem.cpp [code] | Adds rhs functionality to sparse matrix for iSAM |
SparseSystem.h [code] | Adds rhs functionality to sparse matrix for iSAM |
SparseVector.cpp [code] | Part of sparse matrix functionality for iSAM |
SparseVector.h [code] | |
stackDepthPoint.cpp [code] | |
transformMaintenance.cpp [code] | |
util.cpp [code] | Basic utility functions that are independent of iSAM |
util.h [code] | Basic utility functions that are independent of iSAM |
visualOdometry.cpp [code] |