34 typedef std::shared_ptr<BatchFixedLagSmoother>
shared_ptr;
158 void removeFactors(
const std::set<size_t>& deleteFactors);
170 void marginalize(
const KeyVector& marginalizableKeys);
174 static void PrintKeySet(
const std::set<Key>& keys,
const std::string& label);
179 static void PrintSymbolicGraph(
const GaussianFactorGraph& graph,
const std::string& label);
void print(const Matrix &A, const string &s, ostream &stream)
const gtsam::Symbol key('X', 0)
void PrintKeySet(const KeySet &keys, const string &s, const KeyFormatter &keyFormatter)
Utility function to print sets of keys with optional prefix.
std::map< Key, double > KeyTimestampMap
Typedef for a Key-Timestamp map/database.
const VectorValues & getDelta() const
std::queue< size_t > availableSlots_
VALUE calculateEstimate(Key key) const
BatchFixedLagSmoother(double smootherLag=0.0, const LevenbergMarquardtParams ¶meters=LevenbergMarquardtParams(), bool enforceConsistency=true)
const Ordering & getOrdering() const
std::pair< std::shared_ptr< GaussianConditional >, std::shared_ptr< GaussianFactor > > EliminatePreferCholesky(const GaussianFactorGraph &factors, const Ordering &keys)
const NonlinearFactorGraph & getFactors() const
NonlinearFactorGraph graph
static const KeyFormatter DefaultKeyFormatter
Values retract(const VectorValues &delta) const
const LevenbergMarquardtParams & params() const
FastVector< FactorIndex > FactorIndices
Define collection types:
const Values & getLinearizationPoint() const
~BatchFixedLagSmoother() override
std::function< EliminationResult(const FactorGraphType &, const Ordering &)> Eliminate
The function type that does a single dense elimination step on a subgraph.
LevenbergMarquardtParams & params()
Point3 optimize(const NonlinearFactorGraph &graph, const Values &values, Key landmarkKey)
A nonlinear optimizer that uses the Levenberg-Marquardt trust-region scheme.
Array< double, 1, 3 > e(1./3., 0.5, 2.)
std::shared_ptr< BatchFixedLagSmoother > shared_ptr
Typedef for a shared pointer to an Incremental Fixed-Lag Smoother.
std::function< std::string(Key)> KeyFormatter
Typedef for a function to format a key, i.e. to convert it to a string.
static ConjugateGradientParameters parameters
std::shared_ptr< This > shared_ptr
shared_ptr to this class
std::vector< float > Values
Values calculateEstimate() const override
std::shared_ptr< This > shared_ptr
NonlinearFactorGraph factors_
FastVector< Key > KeyVector
Define collection type once and for all - also used in wrappers.
std::map< Key, std::set< Key > > FactorIndex
std::uint64_t Key
Integer nonlinear key type.
LevenbergMarquardtParams parameters_