Public Member Functions | Private Types | List of all members
gtsam::RangeFactor< A1, A2, T > Class Template Reference

#include <RangeFactor.h>

Inheritance diagram for gtsam::RangeFactor< A1, A2, T >:
Inheritance graph
[legend]

Public Member Functions

gtsam::NonlinearFactor::shared_ptr clone () const override
 
Vector evaluateError (const A1 &a1, const A2 &a2, OptionalMatrixType H1=OptionalNone, OptionalMatrixType H2=OptionalNone) const
 
Expression< Texpression (const typename Base::ArrayNKeys &keys) const override
 
void print (const std::string &s="", const KeyFormatter &kf=DefaultKeyFormatter) const override
 print More...
 
 RangeFactor ()
 default constructor More...
 
 RangeFactor (Key key1, Key key2, T measured, const SharedNoiseModel &model)
 
- Public Member Functions inherited from gtsam::ExpressionFactorN< double, A1, A1 >
virtual Expression< double > expression (const ArrayNKeys &keys) const
 
- Public Member Functions inherited from gtsam::ExpressionFactor< double >
gtsam::NonlinearFactor::shared_ptr clone () const override
 
bool equals (const NonlinearFactor &f, double tol) const override
 equals relies on Testable traits being defined for T More...
 
 ExpressionFactor (const SharedNoiseModel &noiseModel, const double &measurement, const Expression< double > &expression)
 
std::shared_ptr< GaussianFactorlinearize (const Values &x) const override
 
const double & measured () const
 
void print (const std::string &s="", const KeyFormatter &keyFormatter=DefaultKeyFormatter) const override
 print relies on Testable traits being defined for T More...
 
virtual Vector unwhitenedError (const Values &x, OptionalMatrixVecType H=nullptr) const =0
 
Vector unwhitenedError (const Values &x, OptionalMatrixVecType H=nullptr) const override
 
Vector unwhitenedError (const Values &x, std::vector< Matrix > &H) const
 
 ~ExpressionFactor () override
 Destructor. More...
 

Private Types

typedef ExpressionFactorN< T, A1, A2Base
 
typedef RangeFactor< A1, A2This
 

Additional Inherited Members

- Public Types inherited from gtsam::ExpressionFactorN< double, A1, A1 >
using ArrayNKeys = std::array< Key, NARY_EXPRESSION_SIZE >
 
- Public Types inherited from gtsam::ExpressionFactor< double >
typedef std::shared_ptr< ExpressionFactor< double > > shared_ptr
 
- Static Public Attributes inherited from gtsam::ExpressionFactorN< double, A1, A1 >
static const std::size_t NARY_EXPRESSION_SIZE
 
- Protected Types inherited from gtsam::ExpressionFactor< double >
typedef ExpressionFactor< double > This
 
- Protected Member Functions inherited from gtsam::ExpressionFactorN< double, A1, A1 >
 ExpressionFactorN ()=default
 Default constructor, for serialization. More...
 
 ExpressionFactorN (const ArrayNKeys &keys, const SharedNoiseModel &noiseModel, const double &measurement)
 Constructor takes care of keys, but still need to call initialize. More...
 
- Protected Member Functions inherited from gtsam::ExpressionFactor< double >
 ExpressionFactor ()
 
 ExpressionFactor (const SharedNoiseModel &noiseModel, const double &measurement)
 Default constructor, for serialization. More...
 
void initialize (const Expression< double > &expression)
 Initialize with constructor arguments. More...
 
- Protected Attributes inherited from gtsam::ExpressionFactor< double >
FastVector< intdims_
 dimensions of the Jacobian matrices More...
 
Expression< double > expression_
 the expression that is AD enabled More...
 
double measured_
 the measurement to be compared with the expression More...
 
- Static Protected Attributes inherited from gtsam::ExpressionFactor< double >
static const int Dim
 

Detailed Description

template<typename A1, typename A2 = A1, typename T = double>
class gtsam::RangeFactor< A1, A2, T >

Binary factor for a range measurement Works for any two types A1,A2 for which the functor Range<A1,A2>() is defined

Definition at line 35 of file sam/RangeFactor.h.

Member Typedef Documentation

◆ Base

template<typename A1 , typename A2 = A1, typename T = double>
typedef ExpressionFactorN<T, A1, A2> gtsam::RangeFactor< A1, A2, T >::Base
private

Definition at line 38 of file sam/RangeFactor.h.

◆ This

template<typename A1 , typename A2 = A1, typename T = double>
typedef RangeFactor<A1, A2> gtsam::RangeFactor< A1, A2, T >::This
private

Definition at line 37 of file sam/RangeFactor.h.

Constructor & Destructor Documentation

◆ RangeFactor() [1/2]

template<typename A1 , typename A2 = A1, typename T = double>
gtsam::RangeFactor< A1, A2, T >::RangeFactor ( )
inline

default constructor

Definition at line 42 of file sam/RangeFactor.h.

◆ RangeFactor() [2/2]

template<typename A1 , typename A2 = A1, typename T = double>
gtsam::RangeFactor< A1, A2, T >::RangeFactor ( Key  key1,
Key  key2,
T  measured,
const SharedNoiseModel model 
)
inline

Definition at line 44 of file sam/RangeFactor.h.

Member Function Documentation

◆ clone()

template<typename A1 , typename A2 = A1, typename T = double>
gtsam::NonlinearFactor::shared_ptr gtsam::RangeFactor< A1, A2, T >::clone ( ) const
inlineoverride
Returns
a deep copy of this factor

Definition at line 50 of file sam/RangeFactor.h.

◆ evaluateError()

template<typename A1 , typename A2 = A1, typename T = double>
Vector gtsam::RangeFactor< A1, A2, T >::evaluateError ( const A1 a1,
const A2 a2,
OptionalMatrixType  H1 = OptionalNone,
OptionalMatrixType  H2 = OptionalNone 
) const
inline

Definition at line 62 of file sam/RangeFactor.h.

◆ expression()

template<typename A1 , typename A2 = A1, typename T = double>
Expression<T> gtsam::RangeFactor< A1, A2, T >::expression ( const typename Base::ArrayNKeys keys) const
inlineoverride

Definition at line 56 of file sam/RangeFactor.h.

◆ print()

template<typename A1 , typename A2 = A1, typename T = double>
void gtsam::RangeFactor< A1, A2, T >::print ( const std::string &  s = "",
const KeyFormatter kf = DefaultKeyFormatter 
) const
inlineoverride

print

Definition at line 76 of file sam/RangeFactor.h.


The documentation for this class was generated from the following file:


gtsam
Author(s):
autogenerated on Thu Jun 13 2024 03:18:03