IncrementalFixedLagSmoother.h
Go to the documentation of this file.
1 /* ----------------------------------------------------------------------------
2 
3  * GTSAM Copyright 2010, Georgia Tech Research Corporation,
4  * Atlanta, Georgia 30332-0415
5  * All Rights Reserved
6  * Authors: Frank Dellaert, et al. (see THANKS for the full author list)
7 
8  * See LICENSE for the license information
9 
10  * -------------------------------------------------------------------------- */
11 
20 // \callgraph
21 #pragma once
22 
24 #include <gtsam/nonlinear/ISAM2.h>
25 
26 namespace gtsam {
27 
33 class GTSAM_UNSTABLE_EXPORT IncrementalFixedLagSmoother: public FixedLagSmoother {
34 
35 public:
36 
38  typedef boost::shared_ptr<IncrementalFixedLagSmoother> shared_ptr;
39 
41  IncrementalFixedLagSmoother(double smootherLag = 0.0,
42  const ISAM2Params& parameters = DefaultISAM2Params()) :
43  FixedLagSmoother(smootherLag), isam_(parameters) {
44  }
45 
48  }
49 
51  void print(const std::string& s = "IncrementalFixedLagSmoother:\n",
52  const KeyFormatter& keyFormatter = DefaultKeyFormatter) const override;
53 
55  bool equals(const FixedLagSmoother& rhs, double tol = 1e-9) const override;
56 
65  const Values& newTheta = Values(), //
66  const KeyTimestampMap& timestamps = KeyTimestampMap(),
67  const FactorIndices& factorsToRemove = FactorIndices()) override;
68 
73  Values calculateEstimate() const override {
74  return isam_.calculateEstimate();
75  }
76 
83  template<class VALUE>
84  VALUE calculateEstimate(Key key) const {
85  return isam_.calculateEstimate<VALUE>(key);
86  }
87 
89  const ISAM2Params& params() const {
90  return isam_.params();
91  }
92 
95  return isam_.getFactorsUnsafe();
96  }
97 
99  const Values& getLinearizationPoint() const {
100  return isam_.getLinearizationPoint();
101  }
102 
104  const VectorValues& getDelta() const {
105  return isam_.getDelta();
106  }
107 
110  return isam_.marginalCovariance(key);
111  }
112 
114  const ISAM2Result& getISAM2Result() const{ return isamResult_; }
115 
116 protected:
117 
121  params.findUnusedFactorSlots = true;
122  return params;
123  }
124 
128 
131 
133  void eraseKeysBefore(double timestamp);
134 
136  void createOrderingConstraints(const KeyVector& marginalizableKeys,
137  boost::optional<FastMap<Key, int> >& constrainedKeys) const;
138 
139 private:
141  static void PrintKeySet(const std::set<Key>& keys, const std::string& label =
142  "Keys:");
143  static void PrintSymbolicFactor(const GaussianFactor::shared_ptr& factor);
144  static void PrintSymbolicGraph(const GaussianFactorGraph& graph,
145  const std::string& label = "Factor Graph:");
146  static void PrintSymbolicTree(const gtsam::ISAM2& isam,
147  const std::string& label = "Bayes Tree:");
148  static void PrintSymbolicTreeHelper(
149  const gtsam::ISAM2Clique::shared_ptr& clique, const std::string indent =
150  "");
151 
152 };
153 // IncrementalFixedLagSmoother
154 
155 }
void print(const Matrix &A, const string &s, ostream &stream)
Definition: Matrix.cpp:155
boost::shared_ptr< IncrementalFixedLagSmoother > shared_ptr
Typedef for a shared pointer to an Incremental Fixed-Lag Smoother.
void PrintKeySet(const KeySet &keys, const string &s, const KeyFormatter &keyFormatter)
Utility function to print sets of keys with optional prefix.
Definition: Key.cpp:82
std::map< Key, double > KeyTimestampMap
Typedef for a Key-Timestamp map/database.
def update(text)
Definition: relicense.py:46
boost::shared_ptr< This > shared_ptr
Definition: ISAM2Clique.h:41
Base class for a fixed-lag smoother. This mimics the basic interface to iSAM2.
FastVector< FactorIndex > FactorIndices
Define collection types:
Definition: Factor.h:32
Eigen::MatrixXd Matrix
Definition: base/Matrix.h:43
IncrementalFixedLagSmoother(double smootherLag=0.0, const ISAM2Params &parameters=DefaultISAM2Params())
NonlinearFactorGraph graph
static const KeyFormatter DefaultKeyFormatter
Definition: Key.h:43
FastVector< Key > KeyVector
Define collection type once and for all - also used in wrappers.
Definition: Key.h:86
Incremental update functionality (ISAM2) for BayesTree, with fluid relinearization.
std::function< std::string(Key)> KeyFormatter
Typedef for a function to format a key, i.e. to convert it to a string.
Definition: Key.h:35
const ISAM2Result & getISAM2Result() const
Get results of latest isam2 update.
Array< double, 1, 3 > e(1./3., 0.5, 2.)
RealScalar s
NonlinearISAM isam(relinearizeInterval)
static SmartStereoProjectionParams params
boost::shared_ptr< This > shared_ptr
shared_ptr to this class
static ConjugateGradientParameters parameters
traits
Definition: chartTesting.h:28
std::vector< float > Values
const NonlinearFactorGraph & getFactors() const
const G double tol
Definition: Group.h:83
const KeyVector keys
Matrix marginalCovariance(Key key) const
Calculate marginal covariance on given variable.
std::uint64_t Key
Integer nonlinear key type.
Definition: types.h:61


gtsam
Author(s):
autogenerated on Sat May 8 2021 02:42:14