Public Member Functions | List of all members
gtsam.utils.test_case.GtsamTestCase Class Reference

Inherits TestCase.

Inherited by gtsam.examples.PlanarManipulatorExample.TestPose2SLAMExample, gtsam_unstable.tests.test_ProjectionFactorRollingShutter.TestProjectionFactorRollingShutter, test_backwards_compatibility.TestBackwardsCompatibility, test_basis.TestBasis, test_Cal3Fisheye.TestCal3Fisheye, test_Cal3Unified.TestCal3Unified, test_custom_factor.TestCustomFactor, test_dataset.TestDataset, test_DecisionTreeFactor.TestDecisionTreeFactor, test_DiscreteBayesNet.TestDiscreteBayesNet, test_DiscreteBayesTree.TestDiscreteBayesNet, test_DiscreteConditional.TestDiscreteConditional, test_DiscreteDistribution.TestDiscreteDistribution, test_DiscreteFactorGraph.TestDiscreteFactorGraph, test_DSFMap.TestDSFMap, test_DsfTrackGenerator.TestDsfTrackGenerator, test_DsfTrackGenerator.TestSfmTrack2d, test_Factors.TestJacobianFactor, test_Factors.TestNonlinearEquality2Factor, test_FixedLagSmootherExample.TestFixedLagSmootherExample, test_GaussianBayesNet.TestGaussianBayesNet, test_GaussianFactorGraph.TestGaussianFactorGraph, test_GraphvizFormatting.TestGraphvizFormatting, test_HybridBayesNet.TestHybridBayesNet, test_HybridFactorGraph.TestHybridGaussianFactorGraph, test_HybridNonlinearFactorGraph.TestHybridGaussianFactorGraph, test_HybridValues.TestHybridValues, test_initialize_pose3.TestValues, test_JacobianFactor.TestJacobianFactor, test_KalmanFilter.TestKalmanFilter, test_KarcherMeanFactor.TestKarcherMean, test_LocalizationExample.TestLocalizationExample, test_logging_optimizer.TestOptimizeComet, test_NonlinearOptimizer.TestScenario, test_OdometryExample.TestOdometryExample, test_pickle.TestPickle, test_PinholeCamera.TestPinholeCamera, test_PlanarSLAMExample.TestPlanarSLAM, test_Point2.TestPoint2, test_Point3.TestPoint3, test_Pose2.TestPose2, test_Pose2SLAMExample.TestPose2SLAMExample, test_Pose3.TestPose3, test_Pose3SLAMExample.TestPose3SLAMExample, test_PriorFactor.TestPriorFactor, test_Robust.TestRobust, test_Rot3.TestRot3, test_sam.TestSam, test_Scenario.TestScenario, test_SfmData.TestSfmData, test_SFMExample.TestSFMExample, test_ShonanAveraging.TestShonanAveraging, test_Sim2.TestSim2, test_Sim3.TestSim3, test_SimpleCamera.TestSimpleCamera, test_StereoVOExample.TestStereoVOExample, test_Triangulation.TestTriangulationExample, test_Utilities.TestUtilites, test_Values.TestValues, test_VisualISAMExample.TestVisualISAMExample, testEssentialMatrixConstraint.TestVisualISAMExample, and testScenarioRunner.TestScenarioRunner.

Public Member Functions

None assertEqualityOnPickleRoundtrip (self, object obj, tol=1e-9)
 
def gtsamAssertEquals (self, actual, expected, tol=1e-9)
 

Detailed Description

TestCase class with GTSAM assert utils.

Definition at line 15 of file test_case.py.

Member Function Documentation

◆ assertEqualityOnPickleRoundtrip()

None gtsam.utils.test_case.GtsamTestCase.assertEqualityOnPickleRoundtrip (   self,
object  obj,
  tol = 1e-9 
)
Performs a round-trip using pickle and asserts equality.

    Usage:
self.assertEqualityOnPickleRoundtrip(obj)
    Keyword Arguments:
tol {float} -- tolerance passed to 'equals', default 1e-9

Definition at line 34 of file test_case.py.

◆ gtsamAssertEquals()

def gtsam.utils.test_case.GtsamTestCase.gtsamAssertEquals (   self,
  actual,
  expected,
  tol = 1e-9 
)
AssertEqual function that prints out actual and expected if not equal.
    Usage:
self.gtsamAssertEqual(actual,expected)
    Keyword Arguments:
tol {float} -- tolerance passed to 'equals', default 1e-9

Definition at line 18 of file test_case.py.


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


gtsam
Author(s):
autogenerated on Tue Jun 25 2024 03:14:32