KarcherMeanFactor.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 
12 /*
13  * @file KarcherMeanFactor.h
14  * @author Frank Dellaert
15  * @date March 2019
16  */
17 
18 #pragma once
19 
20 #include <gtsam/base/Matrix.h>
22 
23 #include <map>
24 #include <vector>
25 
26 namespace gtsam {
32 template <class T>
33 T FindKarcherMean(const std::vector<T, Eigen::aligned_allocator<T>> &rotations);
34 
35 template <class T> T FindKarcherMean(std::initializer_list<T> &&rotations);
36 
45 template <class T> class KarcherMeanFactor : public NonlinearFactor {
46  // Compile time dimension: can be -1
47  enum { D = traits<T>::dimension };
48 
49  // Runtime dimension: always >=0
50  size_t d_;
51 
53  boost::shared_ptr<JacobianFactor> whitenedJacobian_;
54 
55 public:
61  template <typename CONTAINER>
62  KarcherMeanFactor(const CONTAINER &keys, int d = D,
63  boost::optional<double> beta = boost::none);
64 
66  ~KarcherMeanFactor() override {}
67 
69  double error(const Values &c) const override { return 0; }
70 
72  size_t dim() const override { return d_; }
73 
75  boost::shared_ptr<GaussianFactor> linearize(const Values &c) const override {
76  return whitenedJacobian_;
77  }
78 };
79 // \KarcherMeanFactor
80 } // namespace gtsam
boost::shared_ptr< JacobianFactor > whitenedJacobian_
Constant Jacobian made of d*d identity matrices.
Scalar Scalar * c
Definition: benchVecAdd.cpp:17
T FindKarcherMean(const std::vector< T > &rotations)
STL compatible allocator to use with types requiring a non standrad alignment.
Definition: Memory.h:721
size_t dim() const override
get the dimension of the factor (number of rows on linearization)
~KarcherMeanFactor() override
Destructor.
traits
Definition: chartTesting.h:28
const KeyVector & keys() const
Access the factor&#39;s involved variable keys.
Definition: Factor.h:124
boost::shared_ptr< GaussianFactor > linearize(const Values &c) const override
linearize to a GaussianFactor
KarcherMeanFactor(const CONTAINER &keys, int d=D, boost::optional< double > beta=boost::none)
double error(const Values &c) const override
Calculate the error of the factor: always zero.


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