Go to the documentation of this file.
   32 using namespace gtsam;
 
   41   HybridNonlinearFactor::const_iterator const_it = 
factor.
begin();
 
   43   HybridNonlinearFactor::iterator it = 
factor.
begin();
 
   65   std::vector<NonlinearFactorValuePair> pairs{{
f0, 0.0}, {
f1, 0.0}};
 
   84  0 Leaf BetweenFactor(x1,x2) 
   86   noise model: diagonal sigmas [1]; 
   88  1 Leaf BetweenFactor(x1,x2) 
   90   noise model: diagonal sigmas [1]; 
  119   continuousValues.
insert<
double>(
X(1), 0);
 
  120   continuousValues.
insert<
double>(
X(2), 1);
 
  123       hybridFactor.errorTree(continuousValues);
 
  126   std::vector<DiscreteKey> discrete_keys = {
m1};
 
  127   std::vector<double> errors = {0.5, 0};
 
  147   auto betweenFactor = dynamic_pointer_cast<BetweenFactor<double>>(restricted);
 
  148   CHECK(betweenFactor);
 
  
static int runAllTests(TestResult &result)
#define EXPECT_LONGS_EQUAL(expected, actual)
#define EXPECT(condition)
Nonlinear hybrid factor graph that uses type erasure.
bool assert_print_equal(const std::string &expected, const V &actual, const std::string &s="")
A Bayes net of Gaussian Conditionals indexed by discrete keys.
const_iterator begin() const
Provides additional testing facilities for common data structures.
DecisionTreeFactor factor(D &C &B &A, "0.0 0.0 0.0 0.60658897 0.61241912 0.61241969 0.61247685 0.61247742 0.0 " "0.0 0.0 0.99995287 1.0 1.0 1.0 1.0")
Eigen::Matrix< double, 1, 1 > Vector1
const_iterator end() const
TEST(HybridNonlinearFactor, Constructor)
A set of nonlinear factors indexed by a set of discrete keys.
Linearized Hybrid factor graph that uses type erasure.
std::pair< Key, size_t > DiscreteKey
Implementation of a discrete-conditioned hybrid factor. Implements a joint discrete-continuous factor...
void insert(Key j, const Value &val)
bool assert_equal(const Matrix &expected, const Matrix &actual, double tol)
abc_eqf_lib::State< N > M
DiscreteFactor::shared_ptr restrict(const DiscreteValues &assignment) const override
Restrict the factor to the given assignment.
Implementation of a discrete-conditioned hybrid factor.
static HybridNonlinearFactor getHybridNonlinearFactor()
gtsam
Author(s): 
autogenerated on Wed May 28 2025 03:06:35