ProjectionFactorPPP.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 
19 #pragma once
20 
23 #include <gtsam/geometry/Cal3_S2.h>
24 #include <boost/optional.hpp>
25 
26 namespace gtsam {
27 
33  template<class POSE, class LANDMARK, class CALIBRATION = Cal3_S2>
34  class ProjectionFactorPPP: public NoiseModelFactor3<POSE, POSE, LANDMARK> {
35  protected:
36 
37  // Keep a copy of measurement and calibration for I/O
39  boost::shared_ptr<CALIBRATION> K_;
40 
41  // verbosity handling for Cheirality Exceptions
44 
45  public:
46 
49 
52 
54  typedef boost::shared_ptr<This> shared_ptr;
55 
58  measured_(0.0, 0.0), throwCheirality_(false), verboseCheirality_(false) {
59  }
60 
72  Key poseKey, Key transformKey, Key pointKey,
73  const boost::shared_ptr<CALIBRATION>& K) :
74  Base(model, poseKey, transformKey, pointKey), measured_(measured), K_(K),
75  throwCheirality_(false), verboseCheirality_(false) {}
76 
89  Key poseKey, Key transformKey, Key pointKey,
90  const boost::shared_ptr<CALIBRATION>& K,
92  Base(model, poseKey, transformKey, pointKey), measured_(measured), K_(K),
93  throwCheirality_(throwCheirality), verboseCheirality_(verboseCheirality) {}
94 
96  ~ProjectionFactorPPP() override {}
97 
100  return boost::static_pointer_cast<NonlinearFactor>(
101  NonlinearFactor::shared_ptr(new This(*this))); }
102 
108  void print(const std::string& s = "", const KeyFormatter& keyFormatter = DefaultKeyFormatter) const override {
109  std::cout << s << "ProjectionFactorPPP, z = ";
110  traits<Point2>::Print(measured_);
111  Base::print("", keyFormatter);
112  }
113 
115  bool equals(const NonlinearFactor& p, double tol = 1e-9) const override {
116  const This *e = dynamic_cast<const This*>(&p);
117  return e
118  && Base::equals(p, tol)
119  && traits<Point2>::Equals(this->measured_, e->measured_, tol)
120  && this->K_->equals(*e->K_, tol);
121  }
122 
125  boost::optional<Matrix&> H1 = boost::none,
126  boost::optional<Matrix&> H2 = boost::none,
127  boost::optional<Matrix&> H3 = boost::none) const override {
128  try {
129  if(H1 || H2 || H3) {
130  Matrix H0, H02;
131  PinholeCamera<CALIBRATION> camera(pose.compose(transform, H0, H02), *K_);
132  Point2 reprojectionError(camera.project(point, H1, H3, boost::none) - measured_);
133  *H2 = *H1 * H02;
134  *H1 = *H1 * H0;
135  return reprojectionError;
136  } else {
137  PinholeCamera<CALIBRATION> camera(pose.compose(transform), *K_);
138  return camera.project(point, H1, H3, boost::none) - measured_;
139  }
140  } catch( CheiralityException& e) {
141  if (H1) *H1 = Matrix::Zero(2,6);
142  if (H2) *H2 = Matrix::Zero(2,6);
143  if (H3) *H3 = Matrix::Zero(2,3);
144  if (verboseCheirality_)
145  std::cout << e.what() << ": Landmark "<< DefaultKeyFormatter(this->key2()) <<
146  " moved behind camera " << DefaultKeyFormatter(this->key1()) << std::endl;
147  if (throwCheirality_)
148  throw e;
149  }
150  return Vector::Ones(2) * 2.0 * K_->fx();
151  }
152 
154  const Point2& measured() const {
155  return measured_;
156  }
157 
159  inline const boost::shared_ptr<CALIBRATION> calibration() const {
160  return K_;
161  }
162 
164  inline bool verboseCheirality() const { return verboseCheirality_; }
165 
167  inline bool throwCheirality() const { return throwCheirality_; }
168 
169  private:
170 
173  template<class ARCHIVE>
174  void serialize(ARCHIVE & ar, const unsigned int /*version*/) {
175  ar & BOOST_SERIALIZATION_BASE_OBJECT_NVP(Base);
176  ar & BOOST_SERIALIZATION_NVP(measured_);
177  ar & BOOST_SERIALIZATION_NVP(K_);
178  ar & BOOST_SERIALIZATION_NVP(throwCheirality_);
179  ar & BOOST_SERIALIZATION_NVP(verboseCheirality_);
180  }
181  };
182 
184  template<class POSE, class LANDMARK, class CALIBRATION>
185  struct traits<ProjectionFactorPPP<POSE, LANDMARK, CALIBRATION> > :
186  public Testable<ProjectionFactorPPP<POSE, LANDMARK, CALIBRATION> > {
187  };
188 
189 } // \ namespace gtsam
const gtsam::Key poseKey
NoiseModelFactor3< POSE, POSE, LANDMARK > Base
shorthand for base class type
bool equals(const NonlinearFactor &f, double tol=1e-9) const override
bool verboseCheirality_
If true, prints text for Cheirality exceptions (default: false)
noiseModel::Diagonal::shared_ptr model
ProjectionFactorPPP< POSE, LANDMARK, CALIBRATION > This
shorthand for this class
Vector2 Point2
Definition: Point2.h:27
Eigen::MatrixXd Matrix
Definition: base/Matrix.h:43
void serialize(ARCHIVE &ar, const unsigned int)
static Cal3_S2 K(500, 500, 0.1, 640/2, 480/2)
const Point2 & measured() const
static const KeyFormatter DefaultKeyFormatter
Definition: Key.h:43
ProjectionFactorPPP(const Point2 &measured, const SharedNoiseModel &model, Key poseKey, Key transformKey, Key pointKey, const boost::shared_ptr< CALIBRATION > &K)
const gtsam::Key pointKey
boost::shared_ptr< This > shared_ptr
shorthand for a smart pointer to a factor
Point3 point(10, 0,-5)
const boost::shared_ptr< CALIBRATION > calibration() const
Base class for all pinhole cameras.
Class compose(const Class &g) const
Definition: Lie.h:47
Eigen::VectorXd Vector
Definition: Vector.h:38
friend class boost::serialization::access
Serialization function.
bool throwCheirality_
If true, rethrows Cheirality exceptions (default: false)
static const Pose3 pose(Rot3(Vector3(1,-1,-1).asDiagonal()), Point3(0, 0, 0.5))
boost::shared_ptr< This > shared_ptr
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
Array< double, 1, 3 > e(1./3., 0.5, 2.)
RealScalar s
EIGEN_DONT_INLINE void transform(const Transformation &t, Data &data)
Definition: geometry.cpp:25
ProjectionFactorPPP(const Point2 &measured, const SharedNoiseModel &model, Key poseKey, Key transformKey, Key pointKey, const boost::shared_ptr< CALIBRATION > &K, bool throwCheirality, bool verboseCheirality)
Vector evaluateError(const Pose3 &pose, const Pose3 &transform, const Point3 &point, boost::optional< Matrix & > H1=boost::none, boost::optional< Matrix & > H2=boost::none, boost::optional< Matrix & > H3=boost::none) const override
Evaluate error h(x)-z and optionally derivatives.
traits
Definition: chartTesting.h:28
void print(const std::string &s="", const KeyFormatter &keyFormatter=DefaultKeyFormatter) const override
Non-linear factor base classes.
NonlinearFactor::shared_ptr clone() const override
float * p
bool equals(const NonlinearFactor &p, double tol=1e-9) const override
equals
Point2 measured_
2D measurement
void print(const std::string &s="", const KeyFormatter &keyFormatter=DefaultKeyFormatter) const override
const G double tol
Definition: Group.h:83
Vector3 Point3
Definition: Point3.h:35
ProjectionFactorPPP()
Default constructor.
boost::shared_ptr< CALIBRATION > K_
shared pointer to calibration object
static const CalibratedCamera camera(kDefaultPose)
std::uint64_t Key
Integer nonlinear key type.
Definition: types.h:61
void Print(const CONTAINER &keys, const string &s, const KeyFormatter &keyFormatter)
Definition: Key.cpp:59
noiseModel::Base::shared_ptr SharedNoiseModel
Definition: NoiseModel.h:734
The most common 5DOF 3D->2D calibration.
const char * what() const noexceptoverride


gtsam
Author(s):
autogenerated on Sat May 8 2021 02:43:44