Namespaces | Functions
gtsam::example Namespace Reference

Namespaces

 impl
 
 smallOptimize
 

Functions

VectorValues createCorrectDelta ()
 
GaussianFactorGraph createGaussianFactorGraph ()
 
GaussianFactorGraph createMultiConstraintGraph ()
 
VectorValues createMultiConstraintValues ()
 
Values createNoisyValues ()
 
NonlinearFactorGraph createNonlinearFactorGraph (const SharedNoiseModel &noiseModel1=impl::kSigma0_1, const SharedNoiseModel &noiseModel2=impl::kSigma0_2)
 
std::pair< NonlinearFactorGraph, ValuescreateNonlinearSmoother (int T)
 
NonlinearFactorGraph createReallyNonlinearFactorGraph ()
 
GaussianFactorGraph createSimpleConstraintGraph ()
 
VectorValues createSimpleConstraintValues ()
 
GaussianFactorGraph createSingleConstraintGraph ()
 
VectorValues createSingleConstraintValues ()
 
GaussianBayesNet createSmallGaussianBayesNet ()
 
GaussianFactorGraph createSmoother (int T)
 
Values createValues ()
 
VectorValues createVectorValues ()
 
VectorValues createZeroDelta ()
 
NonlinearFactorGraph nonlinearFactorGraphWithGivenSigma (const double sigma)
 
std::pair< GaussianFactorGraph, VectorValuesplanarGraph (size_t N)
 
Ordering planarOrdering (size_t N)
 
std::shared_ptr< const ValuessharedNoisyValues ()
 
std::shared_ptr< const NonlinearFactorGraphsharedNonlinearFactorGraph (const SharedNoiseModel &noiseModel1=impl::kSigma0_1, const SharedNoiseModel &noiseModel2=impl::kSigma0_2)
 
NonlinearFactorGraph sharedNonRobustFactorGraphWithOutliers ()
 
std::shared_ptr< const NonlinearFactorGraphsharedReallyNonlinearFactorGraph ()
 
NonlinearFactorGraph sharedRobustFactorGraphWithOutliers ()
 
std::pair< GaussianFactorGraph, GaussianFactorGraphsplitOffPlanarTree (size_t N, const GaussianFactorGraph &original)
 

Function Documentation

◆ createCorrectDelta()

VectorValues gtsam::example::createCorrectDelta ( )
inline

Definition at line 248 of file smallExample.h.

◆ createGaussianFactorGraph()

GaussianFactorGraph gtsam::example::createGaussianFactorGraph ( )
inline

Definition at line 270 of file smallExample.h.

◆ createMultiConstraintGraph()

GaussianFactorGraph gtsam::example::createMultiConstraintGraph ( )
inline

Definition at line 553 of file smallExample.h.

◆ createMultiConstraintValues()

VectorValues gtsam::example::createMultiConstraintValues ( )
inline

Definition at line 608 of file smallExample.h.

◆ createNoisyValues()

Values gtsam::example::createNoisyValues ( )
inline

Definition at line 243 of file smallExample.h.

◆ createNonlinearFactorGraph()

NonlinearFactorGraph gtsam::example::createNonlinearFactorGraph ( const SharedNoiseModel noiseModel1 = impl::kSigma0_1,
const SharedNoiseModel noiseModel2 = impl::kSigma0_2 
)
inline

Definition at line 206 of file smallExample.h.

◆ createNonlinearSmoother()

std::pair<NonlinearFactorGraph, Values> gtsam::example::createNonlinearSmoother ( int  T)
inline

Definition at line 431 of file smallExample.h.

◆ createReallyNonlinearFactorGraph()

NonlinearFactorGraph gtsam::example::createReallyNonlinearFactorGraph ( )
inline

Definition at line 378 of file smallExample.h.

◆ createSimpleConstraintGraph()

GaussianFactorGraph gtsam::example::createSimpleConstraintGraph ( )
inline

Definition at line 471 of file smallExample.h.

◆ createSimpleConstraintValues()

VectorValues gtsam::example::createSimpleConstraintValues ( )
inline

Definition at line 500 of file smallExample.h.

◆ createSingleConstraintGraph()

GaussianFactorGraph gtsam::example::createSingleConstraintGraph ( )
inline

Definition at line 512 of file smallExample.h.

◆ createSingleConstraintValues()

VectorValues gtsam::example::createSingleConstraintValues ( )
inline

Definition at line 546 of file smallExample.h.

◆ createSmallGaussianBayesNet()

GaussianBayesNet gtsam::example::createSmallGaussianBayesNet ( )
inline

create small Chordal Bayes Net x <- y x y d 1 1 9 1 5

Definition at line 297 of file smallExample.h.

◆ createSmoother()

GaussianFactorGraph gtsam::example::createSmoother ( int  T)
inline

Definition at line 465 of file smallExample.h.

◆ createValues()

Values gtsam::example::createValues ( )
inline

Definition at line 212 of file smallExample.h.

◆ createVectorValues()

VectorValues gtsam::example::createVectorValues ( )
inline

Definition at line 223 of file smallExample.h.

◆ createZeroDelta()

VectorValues gtsam::example::createZeroDelta ( )
inline

Definition at line 259 of file smallExample.h.

◆ nonlinearFactorGraphWithGivenSigma()

NonlinearFactorGraph gtsam::example::nonlinearFactorGraphWithGivenSigma ( const double  sigma)
inline

Definition at line 354 of file smallExample.h.

◆ planarGraph()

std::pair<GaussianFactorGraph, VectorValues> gtsam::example::planarGraph ( size_t  N)
inline

Definition at line 626 of file smallExample.h.

◆ planarOrdering()

Ordering gtsam::example::planarOrdering ( size_t  N)
inline

Definition at line 668 of file smallExample.h.

◆ sharedNoisyValues()

std::shared_ptr<const Values> gtsam::example::sharedNoisyValues ( )
inline

Definition at line 232 of file smallExample.h.

◆ sharedNonlinearFactorGraph()

std::shared_ptr<const NonlinearFactorGraph> gtsam::example::sharedNonlinearFactorGraph ( const SharedNoiseModel noiseModel1 = impl::kSigma0_1,
const SharedNoiseModel noiseModel2 = impl::kSigma0_2 
)
inline

Definition at line 173 of file smallExample.h.

◆ sharedNonRobustFactorGraphWithOutliers()

NonlinearFactorGraph gtsam::example::sharedNonRobustFactorGraphWithOutliers ( )
inline

Definition at line 383 of file smallExample.h.

◆ sharedReallyNonlinearFactorGraph()

std::shared_ptr<const NonlinearFactorGraph> gtsam::example::sharedReallyNonlinearFactorGraph ( )
inline

Definition at line 366 of file smallExample.h.

◆ sharedRobustFactorGraphWithOutliers()

NonlinearFactorGraph gtsam::example::sharedRobustFactorGraphWithOutliers ( )
inline

Definition at line 406 of file smallExample.h.

◆ splitOffPlanarTree()

std::pair<GaussianFactorGraph, GaussianFactorGraph> gtsam::example::splitOffPlanarTree ( size_t  N,
const GaussianFactorGraph original 
)
inline

Definition at line 677 of file smallExample.h.



gtsam
Author(s):
autogenerated on Tue Jul 4 2023 02:47:15