#include <Factor.h>
Public Types | |
typedef KeyVector::const_iterator | const_iterator |
Const iterator over keys. More... | |
typedef KeyVector::iterator | iterator |
Iterator over keys. More... | |
Public Member Functions | |
virtual | ~Factor ()=default |
Default destructor. More... | |
Standard Interface | |
bool | empty () const |
Whether the factor is empty (involves zero variables). More... | |
Key | front () const |
First key. More... | |
Key | back () const |
Last key. More... | |
const_iterator | find (Key key) const |
find More... | |
const KeyVector & | keys () const |
Access the factor's involved variable keys. More... | |
const_iterator | begin () const |
const_iterator | end () const |
virtual double | error (const HybridValues &c) const |
size_t | size () const |
Testable | |
virtual void | print (const std::string &s="Factor", const KeyFormatter &formatter=DefaultKeyFormatter) const |
print More... | |
virtual void | printKeys (const std::string &s="Factor", const KeyFormatter &formatter=DefaultKeyFormatter) const |
print only keys More... | |
bool | equals (const This &other, double tol=1e-9) const |
check equality More... | |
Advanced Interface | |
KeyVector & | keys () |
iterator | begin () |
iterator | end () |
Protected Attributes | |
KeyVector | keys_ |
The keys involved in this factor. More... | |
Private Types | |
typedef std::shared_ptr< Factor > | shared_ptr |
A shared_ptr to this class. More... | |
typedef Factor | This |
This class. More... | |
Standard Constructors | |
Factor () | |
template<typename CONTAINER > | |
Factor (const CONTAINER &keys) | |
template<typename ITERATOR > | |
Factor (ITERATOR first, ITERATOR last) | |
template<typename CONTAINER > | |
static Factor | FromKeys (const CONTAINER &keys) |
template<typename ITERATOR > | |
static Factor | FromIterators (ITERATOR first, ITERATOR last) |
typedef KeyVector::const_iterator gtsam::Factor::const_iterator |
typedef KeyVector::iterator gtsam::Factor::iterator |
|
private |
|
private |
|
inlineprotected |
|
inlineexplicitprotected |
|
inlineprotected |
|
virtualdefault |
Default destructor.
|
inline |
|
inline |
|
inline |
|
inline |
|
inline |
bool gtsam::Factor::equals | ( | const This & | other, |
double | tol = 1e-9 |
||
) | const |
check equality
Definition at line 42 of file Factor.cpp.
|
virtual |
All factor types need to implement an error function. In factor graphs, this is the negative log-likelihood.
Reimplemented in gtsam::TableFactor, gtsam::DecisionTreeFactor, gtsam::GaussianMixture, gtsam::HybridConditional, gtsam::MixtureFactor, gtsam::GaussianMixtureFactor, gtsam::SymbolicFactor, gtsam::NonlinearFactor, gtsam::DiscreteFactor, and gtsam::GaussianFactor.
Definition at line 47 of file Factor.cpp.
|
inline |
|
inlinestaticprotected |
|
inlinestaticprotected |
|
inline |
|
inline |
|
virtual |
Reimplemented in TestNaryFactor, gtsam::EssentialMatrixFactor4< CALIBRATION >, gtsam::ImuFactor2, NonlinearMeasurementModel, gtsam::EssentialMatrixFactor3, gtsam::NonlinearEquality1< VALUE >, gtsam::CombinedImuFactor, gtsam::GeneralSFMFactor2< CALIBRATION >, gtsam::NoiseModelFactor, gtsam::ImuFactor, gtsam::LinearizedHessianFactor, gtsam::SmartProjectionPoseFactorRollingShutter< CAMERA >, gtsam::FunctorizedFactor2< R, T1, T2 >, gtsam::Pose3AttitudeFactor, gtsam::InvDepthFactorVariant3b, gtsam::JacobianFactor, gtsam::HessianFactor, gtsam::MixtureFactor, gtsam::SmartProjectionRigFactor< CAMERA >, gtsam::SmartFactorBase< CAMERA >, gtsam::SmartFactorBase< PinholePose< CALIBRATION > >, gtsam::SmartFactorBase< StereoCamera >, gtsam::SmartFactorBase< PinholeCamera< Cal3Bundler > >, gtsam::AHRSFactor, gtsam::EssentialMatrixFactor2, gtsam::BayesTreeOrphanWrapper< HybridBayesTreeClique >, NonlinearMotionModel, gtsam::RangeFactorWithTransform< A1, A2, T >, gtsam::GPSFactor2, gtsam::TableFactor, gtsam::ProjectionFactorRollingShutter, gtsam::GaussianMixture, gtsam::FrobeniusBetweenFactor< Rot >, gtsam::DiscreteConditional, gtsam::HybridConditional, gtsam::EquivInertialNavFactor_GlobalVel< POSE, VELOCITY, IMUBIAS >, gtsam::EquivInertialNavFactor_GlobalVel_NoBias< POSE, VELOCITY >, gtsam::SmartStereoProjectionFactorPP, gtsam::LinearizedJacobianFactor, gtsam::GaussianConditional, gtsam::Rot3AttitudeFactor, gtsam::GenericProjectionFactor< POSE, LANDMARK, CALIBRATION >, gtsam::InertialNavFactor_GlobalVelocity< POSE, VELOCITY, IMUBIAS >, gtsam::SmartStereoProjectionPoseFactor, gtsam::WhiteNoiseFactor, gtsam::MultiProjectionFactor< POSE, LANDMARK, CALIBRATION >, gtsam::GeneralSFMFactor< CAMERA, LANDMARK >, gtsam::GaussianMixtureFactor, gtsam::NonlinearEquality< VALUE >, gtsam::ReferenceFrameFactor< POINT, TRANSFORM >, gtsam::ProjectionFactorPPP< POSE, LANDMARK, CALIBRATION >, gtsam::HybridFactor, gtsam::LinearInequality, gtsam::SmartStereoProjectionFactor, gtsam::GenericStereoFactor< POSE, LANDMARK >, gtsam::TriangulationFactor< CAMERA >, gtsam::SymbolicConditional, gtsam::TransformBtwRobotsUnaryFactorEM< VALUE >, gtsam::RegularImplicitSchurFactor< CAMERA >, gtsam::SmartProjectionPoseFactor< CALIBRATION >, gtsam::FunctorizedFactor< R, T >, gtsam::SmartProjectionFactor< CAMERA >, gtsam::FunctorizedFactor< T, Matrix >, gtsam::FunctorizedFactor< Vector, Matrix >, gtsam::FunctorizedFactor< double, BASIS::Parameters >, gtsam::FunctorizedFactor< double, Vector >, gtsam::FunctorizedFactor< double, Matrix >, gtsam::SmartProjectionFactor< PinholePose< CALIBRATION > >, gtsam::RotateDirectionsFactor, gtsam::NonlinearFactor, gtsam::VelocityConstraint, gtsam::LinearEquality, gtsam::ProjectionFactorPPPC< POSE, LANDMARK, CALIBRATION >, gtsam::MagPoseFactor< POSE >, gtsam::LinearCost, gtsam::PartialPriorFactor< VALUE >, gtsam::PartialPriorFactor< PoseRTV >, gtsam::DecisionTreeFactor, gtsam::SymbolicFactor, gtsam::BetweenFactor< VALUE >, gtsam::TransformBtwRobotsUnaryFactor< VALUE >, gtsam::BetweenFactorEM< VALUE >, gtsam::BearingRangeFactor< A1, A2, B, R >, gtsam::EssentialMatrixFactor, gtsam::PoseTranslationPrior< POSE >, gtsam::ExpressionFactor< T >, gtsam::ExpressionFactor< BearingRange< A1, A2 > >, gtsam::ExpressionFactor< double >, gtsam::ExpressionFactor< gtsam::Point3 >, gtsam::SmartRangeFactor, gtsam::CustomFactor, gtsam::PriorFactor< VALUE >, gtsam::DiscreteDistribution, gtsam::GPSFactor, gtsam::GaussMarkov1stOrderFactor< VALUE >, gtsam::RangeFactor< A1, A2, T >, gtsam::OrientedPlane3DirectionPrior, gtsam::EssentialMatrixConstraint, gtsam::PoseRotationPrior< POSE >, gtsam::InvDepthFactor3< POSE, LANDMARK, INVDEPTH >, gtsam::BarometricFactor, gtsam::InvDepthFactorVariant2, gtsam::InvDepthFactorVariant3a, gtsam::LocalOrientedPlane3Factor, gtsam::PoseBetweenFactor< POSE >, gtsam::InvDepthFactorVariant1, gtsam::DiscreteFactor, gtsam::FullIMUFactor< POSE >, gtsam::PosePriorFactor< POSE >, gtsam::BinaryMeasurement< T >, gtsam::LinearContainerFactor, gtsam::ShonanFactor< d >, gtsam::RelativeElevationFactor, gtsam::IMUFactor< POSE >, gtsam::AntiFactor, gtsam::GaussianFactor, gtsam::BiasedGPSFactor, gtsam::GaussianDensity, gtsam::Domain, gtsam::DiscreteLookupTable, gtsam::BearingFactor< A1, A2, T >, gtsam::PoseToPointFactor< POSE, POINT >, gtsam::RotateFactor, gtsam::OrientedPlane3Factor, gtsam::SingleValue, gtsam::DummyFactor< CAMERA >, gtsam::AllDiff, and gtsam::BinaryAllDiff.
Definition at line 29 of file Factor.cpp.
|
virtual |
|
inline |
|
protected |