gtsam-develop 4.3a0.dev202506061330__cp310-cp310-macosx_11_0_arm64.whl → 4.3a0.dev202507301459__cp310-cp310-macosx_11_0_arm64.whl
This diff represents the content of publicly available package versions that have been released to one of the supported registries. The information contained in this diff is provided for informational purposes only and reflects changes between package versions as they appear in their respective public registries.
Potentially problematic release.
This version of gtsam-develop might be problematic. Click here for more details.
- gtsam/.dylibs/{libgtsam.4.3a0.dev202506061330.dylib → libgtsam.4.3a0.dev202507301459.dylib} +0 -0
- gtsam/.dylibs/libgtsam_unstable.4.3a0.dev202507301459.dylib +0 -0
- gtsam/__init__.pyi +27 -16
- gtsam/gtsam/__init__.pyi +315 -44
- gtsam/gtsam/imuBias.pyi +6 -0
- gtsam/gtsam.cpython-310-darwin.so +0 -0
- gtsam/tests/test_FrobeniusFactor.py +70 -3
- gtsam/tests/test_Sim2.py +93 -9
- gtsam/tests/test_Sim3.py +113 -15
- gtsam/utils/generate_trajectory.py +100 -0
- {gtsam_develop-4.3a0.dev202506061330.dist-info → gtsam_develop-4.3a0.dev202507301459.dist-info}/METADATA +1 -1
- {gtsam_develop-4.3a0.dev202506061330.dist-info → gtsam_develop-4.3a0.dev202507301459.dist-info}/RECORD +15 -14
- gtsam_unstable/gtsam_unstable.cpython-310-darwin.so +0 -0
- gtsam/.dylibs/libgtsam_unstable.4.3a0.dev202506061330.dylib +0 -0
- {gtsam_develop-4.3a0.dev202506061330.dist-info → gtsam_develop-4.3a0.dev202507301459.dist-info}/WHEEL +0 -0
- {gtsam_develop-4.3a0.dev202506061330.dist-info → gtsam_develop-4.3a0.dev202507301459.dist-info}/top_level.txt +0 -0
gtsam/gtsam/__init__.pyi
CHANGED
|
@@ -11,7 +11,7 @@ from . import noiseModel
|
|
|
11
11
|
from . import so3
|
|
12
12
|
from . import symbol_shorthand
|
|
13
13
|
from . import utilities
|
|
14
|
-
__all__ = ['AHRSFactor', 'AcceleratingScenario', 'AlgebraicDecisionTreeKey', 'AssignmentKey', 'BarometricFactor', 'BatchFixedLagSmoother', 'BearingFactor2D', 'BearingFactor3D', 'BearingFactorPose2', 'BearingRange2D', 'BearingRange3D', 'BearingRangeFactor2D', 'BearingRangeFactor3D', 'BearingRangeFactorPose2', 'BearingRangeFactorPose3', 'BearingRangePose2', 'BearingRangePose3', 'BetweenFactorConstantBias', 'BetweenFactorDouble', 'BetweenFactorPoint2', 'BetweenFactorPoint3', 'BetweenFactorPose2', 'BetweenFactorPose3', 'BetweenFactorRot2', 'BetweenFactorRot3', 'BetweenFactorSO3', 'BetweenFactorSO4', 'BetweenFactorSimilarity2', 'BetweenFactorSimilarity3', 'BetweenFactorVector', 'BinaryMeasurementPoint3', 'BinaryMeasurementRot3', 'BinaryMeasurementUnit3', 'BlockJacobiPreconditionerParameters', 'Cal3', 'Cal3Bundler', 'Cal3DS2', 'Cal3DS2_Base', 'Cal3Fisheye', 'Cal3Unified', 'Cal3_S2', 'Cal3_S2Stereo', 'Cal3f', 'CalibratedCamera', 'CameraSetCal3Bundler', 'CameraSetCal3DS2', 'CameraSetCal3Fisheye', 'CameraSetCal3Unified', 'CameraSetCal3_S2', 'CameraSetPinholePoseCal3_S2', 'Chebyshev1Basis', 'Chebyshev2', 'Chebyshev2Basis', 'CombinedImuFactor', 'ComponentDerivativeFactorChebyshev1Basis', 'ComponentDerivativeFactorChebyshev2', 'ComponentDerivativeFactorChebyshev2Basis', 'ComponentDerivativeFactorFourierBasis', 'ConjugateGradientParameters', 'ConstantTwistScenario', 'ConstantVelocityFactor', 'ConvertNoiseModel', 'CustomFactor', 'DSFMapIndexPair', 'DecisionTreeFactor', 'DegeneracyMode', 'DerivativeFactorChebyshev1Basis', 'DerivativeFactorChebyshev2', 'DerivativeFactorChebyshev2Basis', 'DerivativeFactorFourierBasis', 'DiscreteBayesNet', 'DiscreteBayesTree', 'DiscreteBayesTreeClique', 'DiscreteCluster', 'DiscreteConditional', 'DiscreteDistribution', 'DiscreteEliminationTree', 'DiscreteFactor', 'DiscreteFactorGraph', 'DiscreteJunctionTree', 'DiscreteKeys', 'DiscreteLookupDAG', 'DiscreteLookupTable', 'DiscreteMarginals', 'DiscreteSearch', 'DiscreteSearchSolution', 'DiscreteValues', 'DoglegOptimizer', 'DoglegParams', 'DotWriter', 'DummyPreconditionerParameters', 'EdgeKey', 'EliminateDiscrete', 'EliminateForMPE', 'EliminateQR', 'EpipolarTransfer', 'EssentialMatrix', 'EssentialMatrixConstraint', 'EssentialMatrixFactor', 'EssentialMatrixFactor2', 'EssentialMatrixFactor3', 'EssentialMatrixFactor4Cal3Bundler', 'EssentialMatrixFactor4Cal3DS2', 'EssentialMatrixFactor4Cal3Fisheye', 'EssentialMatrixFactor4Cal3Unified', 'EssentialMatrixFactor4Cal3_S2', 'EssentialMatrixFactor4Cal3f', 'EssentialMatrixFactor5Cal3Bundler', 'EssentialMatrixFactor5Cal3DS2', 'EssentialMatrixFactor5Cal3Fisheye', 'EssentialMatrixFactor5Cal3Unified', 'EssentialMatrixFactor5Cal3_S2', 'EssentialMatrixFactor5Cal3f', 'EssentialTransferFactorCal3Bundler', 'EssentialTransferFactorCal3_S2', 'EssentialTransferFactorCal3f', 'EssentialTransferFactorKCal3Bundler', 'EssentialTransferFactorKCal3_S2', 'EssentialTransferFactorKCal3f', 'EvaluationFactorChebyshev1Basis', 'EvaluationFactorChebyshev2', 'EvaluationFactorChebyshev2Basis', 'EvaluationFactorFourierBasis', 'Event', 'ExtendedKalmanFilterConstantBias', 'ExtendedKalmanFilterNavState', 'ExtendedKalmanFilterPoint2', 'ExtendedKalmanFilterPoint3', 'ExtendedKalmanFilterPose2', 'ExtendedKalmanFilterPose3', 'ExtendedKalmanFilterRot2', 'ExtendedKalmanFilterRot3', 'ExtendedKalmanFilterSimilarity2', 'ExtendedKalmanFilterSimilarity3', 'Factor', 'FindKarcherMeanPoint2', 'FindKarcherMeanPoint3', 'FindKarcherMeanPose2', 'FindKarcherMeanPose3', 'FindKarcherMeanRot2', 'FindKarcherMeanRot3', 'FindKarcherMeanSO3', 'FindKarcherMeanSO4', 'FitBasisChebyshev1Basis', 'FitBasisChebyshev2', 'FitBasisChebyshev2Basis', 'FitBasisFourierBasis', 'FixedLagSmoother', 'FixedLagSmootherResult', 'FourierBasis', 'FrobeniusBetweenFactorPose2', 'FrobeniusBetweenFactorPose3', 'FrobeniusBetweenFactorRot2', 'FrobeniusBetweenFactorRot3', 'FrobeniusBetweenFactorSO3', 'FrobeniusBetweenFactorSO4', 'FrobeniusFactorPose2', 'FrobeniusFactorPose3', 'FrobeniusFactorRot2', 'FrobeniusFactorRot3', 'FrobeniusFactorSO3', 'FrobeniusFactorSO4', 'FrobeniusPriorPose2', 'FrobeniusPriorPose3', 'FrobeniusPriorRot2', 'FrobeniusPriorRot3', 'FrobeniusPriorSO3', 'FrobeniusPriorSO4', 'FundamentalMatrix', 'GPSFactor', 'GPSFactor2', 'GPSFactor2Arm', 'GPSFactor2ArmCalib', 'GPSFactorArm', 'GPSFactorArmCalib', 'GaussNewtonOptimizer', 'GaussNewtonParams', 'GaussianBayesNet', 'GaussianBayesTree', 'GaussianBayesTreeClique', 'GaussianConditional', 'GaussianDensity', 'GaussianEliminationTree', 'GaussianFactor', 'GaussianFactorGraph', 'GaussianISAM', 'GeneralSFMFactor2Cal3Bundler', 'GeneralSFMFactor2Cal3DS2', 'GeneralSFMFactor2Cal3Fisheye', 'GeneralSFMFactor2Cal3Unified', 'GeneralSFMFactor2Cal3_S2', 'GeneralSFMFactor2Cal3f', 'GeneralSFMFactorCal3Bundler', 'GeneralSFMFactorCal3DS2', 'GeneralSFMFactorCal3Fisheye', 'GeneralSFMFactorCal3Unified', 'GeneralSFMFactorCal3_S2', 'GeneralSFMFactorPoseCal3Bundler', 'GeneralSFMFactorPoseCal3DS2', 'GeneralSFMFactorPoseCal3Fisheye', 'GeneralSFMFactorPoseCal3Unified', 'GeneralSFMFactorPoseCal3_S2', 'GenericProjectionFactorCal3DS2', 'GenericProjectionFactorCal3Fisheye', 'GenericProjectionFactorCal3Unified', 'GenericProjectionFactorCal3_S2', 'GenericStereoFactor3D', 'GenericValueCal3Bundler', 'GenericValueCal3DS2', 'GenericValueCal3Fisheye', 'GenericValueCal3Unified', 'GenericValueCal3_S2', 'GenericValueCalibratedCamera', 'GenericValueConstantBias', 'GenericValueEssentialMatrix', 'GenericValueMatrix', 'GenericValuePoint2', 'GenericValuePoint3', 'GenericValuePose2', 'GenericValuePose3', 'GenericValueRot2', 'GenericValueRot3', 'GenericValueStereoPoint2', 'GenericValueVector', 'GncGaussNewtonOptimizer', 'GncGaussNewtonParams', 'GncLMOptimizer', 'GncLMParams', 'GncLossType', 'GraphvizFormatting', 'HessianFactor', 'HybridBayesNet', 'HybridBayesTree', 'HybridBayesTreeClique', 'HybridConditional', 'HybridFactor', 'HybridGaussianConditional', 'HybridGaussianFactor', 'HybridGaussianFactorGraph', 'HybridNonlinearFactor', 'HybridNonlinearFactorGraph', 'HybridOrdering', 'HybridSmoother', 'HybridValues', 'ISAM2', 'ISAM2Clique', 'ISAM2DoglegParams', 'ISAM2GaussNewtonParams', 'ISAM2Params', 'ISAM2Result', 'ISAM2ThresholdMap', 'ImuFactor', 'ImuFactor2', 'IncrementalFixedLagSmoother', 'IndexPair', 'IndexPairSetAsArray', 'InitializePose3', 'IterativeOptimizationParameters', 'JacobianFactor', 'JacobianVector', 'JointMarginal', 'KalmanFilter', 'KarcherMeanFactorPoint2', 'KarcherMeanFactorPoint3', 'KarcherMeanFactorPose2', 'KarcherMeanFactorPose3', 'KarcherMeanFactorRot2', 'KarcherMeanFactorRot3', 'KarcherMeanFactorSO3', 'KarcherMeanFactorSO4', 'KernelFunctionType', 'KeyGroupMap', 'KeyList', 'KeySet', 'LabeledSymbol', 'LevenbergMarquardtOptimizer', 'LevenbergMarquardtParams', 'LinearContainerFactor', 'LinearizationMode', 'MFAS', 'MT19937', 'MagFactor', 'MagFactor1', 'MagPoseFactorPose2', 'MagPoseFactorPose3', 'ManifoldEvaluationFactorChebyshev1BasisPose2', 'ManifoldEvaluationFactorChebyshev1BasisPose3', 'ManifoldEvaluationFactorChebyshev1BasisRot2', 'ManifoldEvaluationFactorChebyshev1BasisRot3', 'ManifoldEvaluationFactorChebyshev2BasisPose2', 'ManifoldEvaluationFactorChebyshev2BasisPose3', 'ManifoldEvaluationFactorChebyshev2BasisRot2', 'ManifoldEvaluationFactorChebyshev2BasisRot3', 'ManifoldEvaluationFactorChebyshev2Pose2', 'ManifoldEvaluationFactorChebyshev2Pose3', 'ManifoldEvaluationFactorChebyshev2Rot2', 'ManifoldEvaluationFactorChebyshev2Rot3', 'ManifoldEvaluationFactorFourierBasisPose2', 'ManifoldEvaluationFactorFourierBasisPose3', 'ManifoldEvaluationFactorFourierBasisRot2', 'ManifoldEvaluationFactorFourierBasisRot3', 'Marginals', 'NavState', 'NoiseFormat', 'NoiseModelFactor', 'NonlinearEquality2Cal3_S2', 'NonlinearEquality2CalibratedCamera', 'NonlinearEquality2ConstantBias', 'NonlinearEquality2PinholeCameraCal3Bundler', 'NonlinearEquality2PinholeCameraCal3Fisheye', 'NonlinearEquality2PinholeCameraCal3Unified', 'NonlinearEquality2PinholeCameraCal3_S2', 'NonlinearEquality2Point2', 'NonlinearEquality2Point3', 'NonlinearEquality2Pose2', 'NonlinearEquality2Pose3', 'NonlinearEquality2Rot2', 'NonlinearEquality2Rot3', 'NonlinearEquality2SO3', 'NonlinearEquality2SO4', 'NonlinearEquality2SOn', 'NonlinearEquality2Similarity2', 'NonlinearEquality2Similarity3', 'NonlinearEquality2StereoPoint2', 'NonlinearEqualityCal3_S2', 'NonlinearEqualityCalibratedCamera', 'NonlinearEqualityConstantBias', 'NonlinearEqualityPinholeCameraCal3Bundler', 'NonlinearEqualityPinholeCameraCal3Fisheye', 'NonlinearEqualityPinholeCameraCal3Unified', 'NonlinearEqualityPinholeCameraCal3_S2', 'NonlinearEqualityPoint2', 'NonlinearEqualityPoint3', 'NonlinearEqualityPose2', 'NonlinearEqualityPose3', 'NonlinearEqualityRot2', 'NonlinearEqualityRot3', 'NonlinearEqualitySO3', 'NonlinearEqualitySO4', 'NonlinearEqualitySOn', 'NonlinearEqualitySimilarity2', 'NonlinearEqualitySimilarity3', 'NonlinearEqualityStereoPoint2', 'NonlinearFactor', 'NonlinearFactorGraph', 'NonlinearISAM', 'NonlinearOptimizer', 'NonlinearOptimizerParams', 'Ordering', 'OrientedPlane3', 'OrientedPlane3DirectionPrior', 'OrientedPlane3Factor', 'PCGSolverParameters', 'PinholeCameraCal3Bundler', 'PinholeCameraCal3DS2', 'PinholeCameraCal3Fisheye', 'PinholeCameraCal3Unified', 'PinholeCameraCal3_S2', 'PinholeCameraCal3f', 'PinholePoseCal3Bundler', 'PinholePoseCal3DS2', 'PinholePoseCal3Fisheye', 'PinholePoseCal3Unified', 'PinholePoseCal3_S2', 'PlanarProjectionFactor1', 'PlanarProjectionFactor2', 'PlanarProjectionFactor3', 'Pose2', 'Pose3', 'Pose3AttitudeFactor', 'PoseRotationPrior2D', 'PoseRotationPrior3D', 'PoseTranslationPrior2D', 'PoseTranslationPrior3D', 'PreconditionerParameters', 'PreintegratedAhrsMeasurements', 'PreintegratedCombinedMeasurements', 'PreintegratedImuMeasurements', 'PreintegratedRotation', 'PreintegratedRotationParams', 'PreintegrationCombinedParams', 'PreintegrationParams', 'PrintDiscreteValues', 'PrintKeyList', 'PrintKeySet', 'PrintKeyVector', 'PriorFactorCal3Bundler', 'PriorFactorCal3DS2', 'PriorFactorCal3Fisheye', 'PriorFactorCal3Unified', 'PriorFactorCal3_S2', 'PriorFactorCalibratedCamera', 'PriorFactorConstantBias', 'PriorFactorDouble', 'PriorFactorNavState', 'PriorFactorPinholeCameraCal3Bundler', 'PriorFactorPinholeCameraCal3Fisheye', 'PriorFactorPinholeCameraCal3Unified', 'PriorFactorPinholeCameraCal3_S2', 'PriorFactorPoint2', 'PriorFactorPoint3', 'PriorFactorPose2', 'PriorFactorPose3', 'PriorFactorRot2', 'PriorFactorRot3', 'PriorFactorSO3', 'PriorFactorSO4', 'PriorFactorSOn', 'PriorFactorSimilarity2', 'PriorFactorSimilarity3', 'PriorFactorStereoPoint2', 'PriorFactorUnit3', 'PriorFactorVector', 'Quaternion', 'RangeFactor2', 'RangeFactor2D', 'RangeFactor3', 'RangeFactor3D', 'RangeFactorCalibratedCamera', 'RangeFactorCalibratedCameraPoint', 'RangeFactorPose2', 'RangeFactorPose3', 'RangeFactorSimpleCamera', 'RangeFactorSimpleCameraPoint', 'RangeFactorWithTransform2D', 'RangeFactorWithTransform3D', 'RangeFactorWithTransformPose2', 'RangeFactorWithTransformPose3', 'RedirectCout', 'ReferenceFrameFactorPoint3Pose3', 'Rot2', 'Rot3', 'Rot3AttitudeFactor', 'RotateDirectionsFactor', 'RotateFactor', 'SO3', 'SO4', 'SOn', 'Sampler', 'Scenario', 'ScenarioRunner', 'SfmData', 'SfmTrack', 'SfmTrack2d', 'ShonanAveraging2', 'ShonanAveraging3', 'ShonanAveragingParameters2', 'ShonanAveragingParameters3', 'ShonanFactor3', 'Similarity2', 'Similarity3', 'SimpleFundamentalMatrix', 'SmartFactorBasePinholeCameraCal3Bundler', 'SmartFactorBasePinholeCameraCal3DS2', 'SmartFactorBasePinholeCameraCal3Fisheye', 'SmartFactorBasePinholeCameraCal3Unified', 'SmartFactorBasePinholeCameraCal3_S2', 'SmartFactorBasePinholePoseCal3Bundler', 'SmartFactorBasePinholePoseCal3DS2', 'SmartFactorBasePinholePoseCal3Fisheye', 'SmartFactorBasePinholePoseCal3Unified', 'SmartFactorBasePinholePoseCal3_S2', 'SmartProjectionFactorPinholeCameraCal3Bundler', 'SmartProjectionFactorPinholeCameraCal3DS2', 'SmartProjectionFactorPinholeCameraCal3Fisheye', 'SmartProjectionFactorPinholeCameraCal3Unified', 'SmartProjectionFactorPinholeCameraCal3_S2', 'SmartProjectionFactorPinholePoseCal3Bundler', 'SmartProjectionFactorPinholePoseCal3DS2', 'SmartProjectionFactorPinholePoseCal3Fisheye', 'SmartProjectionFactorPinholePoseCal3Unified', 'SmartProjectionFactorPinholePoseCal3_S2', 'SmartProjectionParams', 'SmartProjectionPoseFactorCal3Bundler', 'SmartProjectionPoseFactorCal3DS2', 'SmartProjectionPoseFactorCal3Fisheye', 'SmartProjectionPoseFactorCal3Unified', 'SmartProjectionPoseFactorCal3_S2', 'SmartProjectionRigFactorPinholePoseCal3Bundler', 'SmartProjectionRigFactorPinholePoseCal3DS2', 'SmartProjectionRigFactorPinholePoseCal3Fisheye', 'SmartProjectionRigFactorPinholePoseCal3Unified', 'SmartProjectionRigFactorPinholePoseCal3_S2', 'StereoCamera', 'StereoPoint2', 'SubgraphSolver', 'SubgraphSolverParameters', 'Symbol', 'SymbolicBayesNet', 'SymbolicBayesTree', 'SymbolicBayesTreeClique', 'SymbolicCluster', 'SymbolicConditional', 'SymbolicEliminationTree', 'SymbolicFactor', 'SymbolicFactorGraph', 'SymbolicJunctionTree', 'TableDistribution', 'TableFactor', 'TransferFactorFundamentalMatrix', 'TransferFactorSimpleFundamentalMatrix', 'TranslationRecovery', 'TriangulationFactorCal3Bundler', 'TriangulationFactorCal3DS2', 'TriangulationFactorCal3Fisheye', 'TriangulationFactorCal3Unified', 'TriangulationFactorCal3_S2', 'TriangulationFactorPoseCal3Bundler', 'TriangulationFactorPoseCal3DS2', 'TriangulationFactorPoseCal3Fisheye', 'TriangulationFactorPoseCal3Unified', 'TriangulationFactorPoseCal3_S2', 'TriangulationParameters', 'TriangulationResult', 'Unit3', 'Value', 'Values', 'VariableIndex', 'VectorComponentFactorChebyshev1Basis', 'VectorComponentFactorChebyshev2', 'VectorComponentFactorChebyshev2Basis', 'VectorComponentFactorFourierBasis', 'VectorDerivativeFactorChebyshev1Basis', 'VectorDerivativeFactorChebyshev2', 'VectorDerivativeFactorChebyshev2Basis', 'VectorDerivativeFactorFourierBasis', 'VectorEvaluationFactorChebyshev1Basis', 'VectorEvaluationFactorChebyshev2', 'VectorEvaluationFactorChebyshev2Basis', 'VectorEvaluationFactorFourierBasis', 'VectorValues', 'cartesianProduct', 'checkConvergence', 'gtsfm', 'html', 'imuBias', 'initialCamerasAndPointsEstimate', 'initialCamerasEstimate', 'isDebugVersion', 'lago', 'linear_independent', 'load2D', 'load3D', 'markdown', 'mrsymbol', 'mrsymbolChr', 'mrsymbolIndex', 'mrsymbolLabel', 'noiseModel', 'parse2DFactors', 'parse3DFactors', 'readBal', 'readG2o', 'save2D', 'so3', 'symbol', 'symbolChr', 'symbolIndex', 'symbol_shorthand', 'triangulateNonlinear', 'triangulatePoint3', 'triangulateSafe', 'utilities', 'writeBAL', 'writeG2o']
|
|
14
|
+
__all__ = ['AHRSFactor', 'AcceleratingScenario', 'AlgebraicDecisionTreeKey', 'AssignmentKey', 'BarometricFactor', 'BatchFixedLagSmoother', 'BearingFactor2D', 'BearingFactor3D', 'BearingFactorPose2', 'BearingRange2D', 'BearingRange3D', 'BearingRangeFactor2D', 'BearingRangeFactor3D', 'BearingRangeFactorPose2', 'BearingRangeFactorPose3', 'BearingRangePose2', 'BearingRangePose3', 'BetweenFactorConstantBias', 'BetweenFactorDouble', 'BetweenFactorPoint2', 'BetweenFactorPoint3', 'BetweenFactorPose2', 'BetweenFactorPose3', 'BetweenFactorRot2', 'BetweenFactorRot3', 'BetweenFactorSO3', 'BetweenFactorSO4', 'BetweenFactorSimilarity2', 'BetweenFactorSimilarity3', 'BetweenFactorVector', 'BinaryMeasurementPoint3', 'BinaryMeasurementRot3', 'BinaryMeasurementUnit3', 'BlockJacobiPreconditionerParameters', 'Cal3', 'Cal3Bundler', 'Cal3DS2', 'Cal3DS2_Base', 'Cal3Fisheye', 'Cal3Unified', 'Cal3_S2', 'Cal3_S2Stereo', 'Cal3f', 'CalibratedCamera', 'CameraSetCal3Bundler', 'CameraSetCal3DS2', 'CameraSetCal3Fisheye', 'CameraSetCal3Unified', 'CameraSetCal3_S2', 'CameraSetPinholePoseCal3_S2', 'Chebyshev1Basis', 'Chebyshev2', 'Chebyshev2Basis', 'CombinedImuFactor', 'ComponentDerivativeFactorChebyshev1Basis', 'ComponentDerivativeFactorChebyshev2', 'ComponentDerivativeFactorChebyshev2Basis', 'ComponentDerivativeFactorFourierBasis', 'ConjugateGradientParameters', 'ConstantTwistScenario', 'ConstantVelocityFactor', 'ConvertNoiseModel', 'CustomFactor', 'DSFMapIndexPair', 'DecisionTreeFactor', 'DegeneracyMode', 'DerivativeFactorChebyshev1Basis', 'DerivativeFactorChebyshev2', 'DerivativeFactorChebyshev2Basis', 'DerivativeFactorFourierBasis', 'DiscreteBayesNet', 'DiscreteBayesTree', 'DiscreteBayesTreeClique', 'DiscreteCluster', 'DiscreteConditional', 'DiscreteDistribution', 'DiscreteEliminationTree', 'DiscreteFactor', 'DiscreteFactorGraph', 'DiscreteJunctionTree', 'DiscreteKeys', 'DiscreteLookupDAG', 'DiscreteLookupTable', 'DiscreteMarginals', 'DiscreteScenario', 'DiscreteSearch', 'DiscreteSearchSolution', 'DiscreteValues', 'DoglegOptimizer', 'DoglegParams', 'DotWriter', 'DummyPreconditionerParameters', 'EdgeKey', 'EliminateDiscrete', 'EliminateForMPE', 'EliminateQR', 'EpipolarTransfer', 'EssentialMatrix', 'EssentialMatrixConstraint', 'EssentialMatrixFactor', 'EssentialMatrixFactor2', 'EssentialMatrixFactor3', 'EssentialMatrixFactor4Cal3Bundler', 'EssentialMatrixFactor4Cal3DS2', 'EssentialMatrixFactor4Cal3Fisheye', 'EssentialMatrixFactor4Cal3Unified', 'EssentialMatrixFactor4Cal3_S2', 'EssentialMatrixFactor4Cal3f', 'EssentialMatrixFactor5Cal3Bundler', 'EssentialMatrixFactor5Cal3DS2', 'EssentialMatrixFactor5Cal3Fisheye', 'EssentialMatrixFactor5Cal3Unified', 'EssentialMatrixFactor5Cal3_S2', 'EssentialMatrixFactor5Cal3f', 'EssentialTransferFactorCal3Bundler', 'EssentialTransferFactorCal3_S2', 'EssentialTransferFactorCal3f', 'EssentialTransferFactorKCal3Bundler', 'EssentialTransferFactorKCal3_S2', 'EssentialTransferFactorKCal3f', 'EvaluationFactorChebyshev1Basis', 'EvaluationFactorChebyshev2', 'EvaluationFactorChebyshev2Basis', 'EvaluationFactorFourierBasis', 'Event', 'ExtendedKalmanFilterConstantBias', 'ExtendedKalmanFilterNavState', 'ExtendedKalmanFilterPoint2', 'ExtendedKalmanFilterPoint3', 'ExtendedKalmanFilterPose2', 'ExtendedKalmanFilterPose3', 'ExtendedKalmanFilterRot2', 'ExtendedKalmanFilterRot3', 'ExtendedKalmanFilterSimilarity2', 'ExtendedKalmanFilterSimilarity3', 'Factor', 'FindKarcherMeanPoint2', 'FindKarcherMeanPoint3', 'FindKarcherMeanPose2', 'FindKarcherMeanPose3', 'FindKarcherMeanRot2', 'FindKarcherMeanRot3', 'FindKarcherMeanSO3', 'FindKarcherMeanSO4', 'FitBasisChebyshev1Basis', 'FitBasisChebyshev2', 'FitBasisChebyshev2Basis', 'FitBasisFourierBasis', 'FixedLagSmoother', 'FixedLagSmootherResult', 'FourierBasis', 'FrobeniusBetweenFactorGal3', 'FrobeniusBetweenFactorPose2', 'FrobeniusBetweenFactorPose3', 'FrobeniusBetweenFactorRot2', 'FrobeniusBetweenFactorRot3', 'FrobeniusBetweenFactorSO3', 'FrobeniusBetweenFactorSO4', 'FrobeniusBetweenFactorSimilarity2', 'FrobeniusBetweenFactorSimilarity3', 'FrobeniusFactorGal3', 'FrobeniusFactorPose2', 'FrobeniusFactorPose3', 'FrobeniusFactorRot2', 'FrobeniusFactorRot3', 'FrobeniusFactorSO3', 'FrobeniusFactorSO4', 'FrobeniusFactorSimilarity2', 'FrobeniusFactorSimilarity3', 'FrobeniusPriorGal3', 'FrobeniusPriorPose2', 'FrobeniusPriorPose3', 'FrobeniusPriorRot2', 'FrobeniusPriorRot3', 'FrobeniusPriorSO3', 'FrobeniusPriorSO4', 'FrobeniusPriorSimilarity2', 'FrobeniusPriorSimilarity3', 'FundamentalMatrix', 'GPSFactor', 'GPSFactor2', 'GPSFactor2Arm', 'GPSFactor2ArmCalib', 'GPSFactorArm', 'GPSFactorArmCalib', 'Gal3', 'GaussNewtonOptimizer', 'GaussNewtonParams', 'GaussianBayesNet', 'GaussianBayesTree', 'GaussianBayesTreeClique', 'GaussianConditional', 'GaussianDensity', 'GaussianEliminationTree', 'GaussianFactor', 'GaussianFactorGraph', 'GaussianISAM', 'GeneralSFMFactor2Cal3Bundler', 'GeneralSFMFactor2Cal3DS2', 'GeneralSFMFactor2Cal3Fisheye', 'GeneralSFMFactor2Cal3Unified', 'GeneralSFMFactor2Cal3_S2', 'GeneralSFMFactor2Cal3f', 'GeneralSFMFactorCal3Bundler', 'GeneralSFMFactorCal3DS2', 'GeneralSFMFactorCal3Fisheye', 'GeneralSFMFactorCal3Unified', 'GeneralSFMFactorCal3_S2', 'GeneralSFMFactorPoseCal3Bundler', 'GeneralSFMFactorPoseCal3DS2', 'GeneralSFMFactorPoseCal3Fisheye', 'GeneralSFMFactorPoseCal3Unified', 'GeneralSFMFactorPoseCal3_S2', 'GenericProjectionFactorCal3DS2', 'GenericProjectionFactorCal3Fisheye', 'GenericProjectionFactorCal3Unified', 'GenericProjectionFactorCal3_S2', 'GenericStereoFactor3D', 'GenericValueCal3Bundler', 'GenericValueCal3DS2', 'GenericValueCal3Fisheye', 'GenericValueCal3Unified', 'GenericValueCal3_S2', 'GenericValueCalibratedCamera', 'GenericValueConstantBias', 'GenericValueEssentialMatrix', 'GenericValueMatrix', 'GenericValuePoint2', 'GenericValuePoint3', 'GenericValuePose2', 'GenericValuePose3', 'GenericValueRot2', 'GenericValueRot3', 'GenericValueStereoPoint2', 'GenericValueVector', 'GncGaussNewtonOptimizer', 'GncGaussNewtonParams', 'GncLMOptimizer', 'GncLMParams', 'GncLossType', 'GraphvizFormatting', 'HessianFactor', 'HybridBayesNet', 'HybridBayesTree', 'HybridBayesTreeClique', 'HybridConditional', 'HybridFactor', 'HybridGaussianConditional', 'HybridGaussianFactor', 'HybridGaussianFactorGraph', 'HybridNonlinearFactor', 'HybridNonlinearFactorGraph', 'HybridOrdering', 'HybridSmoother', 'HybridValues', 'ISAM2', 'ISAM2Clique', 'ISAM2DoglegParams', 'ISAM2GaussNewtonParams', 'ISAM2Params', 'ISAM2Result', 'ISAM2ThresholdMap', 'ImuFactor', 'ImuFactor2', 'IncrementalFixedLagSmoother', 'IndexPair', 'IndexPairSetAsArray', 'InitializePose3', 'IterativeOptimizationParameters', 'JacobianFactor', 'JacobianVector', 'JointMarginal', 'KalmanFilter', 'KarcherMeanFactorPoint2', 'KarcherMeanFactorPoint3', 'KarcherMeanFactorPose2', 'KarcherMeanFactorPose3', 'KarcherMeanFactorRot2', 'KarcherMeanFactorRot3', 'KarcherMeanFactorSO3', 'KarcherMeanFactorSO4', 'KernelFunctionType', 'KeyGroupMap', 'KeyList', 'KeySet', 'LabeledSymbol', 'LevenbergMarquardtOptimizer', 'LevenbergMarquardtParams', 'LinearContainerFactor', 'LinearizationMode', 'MFAS', 'MT19937', 'MagFactor', 'MagFactor1', 'MagPoseFactorPose2', 'MagPoseFactorPose3', 'ManifoldEvaluationFactorChebyshev1BasisPose2', 'ManifoldEvaluationFactorChebyshev1BasisPose3', 'ManifoldEvaluationFactorChebyshev1BasisRot2', 'ManifoldEvaluationFactorChebyshev1BasisRot3', 'ManifoldEvaluationFactorChebyshev2BasisPose2', 'ManifoldEvaluationFactorChebyshev2BasisPose3', 'ManifoldEvaluationFactorChebyshev2BasisRot2', 'ManifoldEvaluationFactorChebyshev2BasisRot3', 'ManifoldEvaluationFactorChebyshev2Pose2', 'ManifoldEvaluationFactorChebyshev2Pose3', 'ManifoldEvaluationFactorChebyshev2Rot2', 'ManifoldEvaluationFactorChebyshev2Rot3', 'ManifoldEvaluationFactorFourierBasisPose2', 'ManifoldEvaluationFactorFourierBasisPose3', 'ManifoldEvaluationFactorFourierBasisRot2', 'ManifoldEvaluationFactorFourierBasisRot3', 'Marginals', 'NavState', 'NoiseFormat', 'NoiseModelFactor', 'NonlinearEquality2Cal3_S2', 'NonlinearEquality2CalibratedCamera', 'NonlinearEquality2ConstantBias', 'NonlinearEquality2PinholeCameraCal3Bundler', 'NonlinearEquality2PinholeCameraCal3Fisheye', 'NonlinearEquality2PinholeCameraCal3Unified', 'NonlinearEquality2PinholeCameraCal3_S2', 'NonlinearEquality2Point2', 'NonlinearEquality2Point3', 'NonlinearEquality2Pose2', 'NonlinearEquality2Pose3', 'NonlinearEquality2Rot2', 'NonlinearEquality2Rot3', 'NonlinearEquality2SO3', 'NonlinearEquality2SO4', 'NonlinearEquality2SOn', 'NonlinearEquality2Similarity2', 'NonlinearEquality2Similarity3', 'NonlinearEquality2StereoPoint2', 'NonlinearEqualityCal3_S2', 'NonlinearEqualityCalibratedCamera', 'NonlinearEqualityConstantBias', 'NonlinearEqualityPinholeCameraCal3Bundler', 'NonlinearEqualityPinholeCameraCal3Fisheye', 'NonlinearEqualityPinholeCameraCal3Unified', 'NonlinearEqualityPinholeCameraCal3_S2', 'NonlinearEqualityPoint2', 'NonlinearEqualityPoint3', 'NonlinearEqualityPose2', 'NonlinearEqualityPose3', 'NonlinearEqualityRot2', 'NonlinearEqualityRot3', 'NonlinearEqualitySO3', 'NonlinearEqualitySO4', 'NonlinearEqualitySOn', 'NonlinearEqualitySimilarity2', 'NonlinearEqualitySimilarity3', 'NonlinearEqualityStereoPoint2', 'NonlinearFactor', 'NonlinearFactorGraph', 'NonlinearISAM', 'NonlinearOptimizer', 'NonlinearOptimizerParams', 'Ordering', 'OrientedPlane3', 'OrientedPlane3DirectionPrior', 'OrientedPlane3Factor', 'PCGSolverParameters', 'PinholeCameraCal3Bundler', 'PinholeCameraCal3DS2', 'PinholeCameraCal3Fisheye', 'PinholeCameraCal3Unified', 'PinholeCameraCal3_S2', 'PinholeCameraCal3f', 'PinholePoseCal3Bundler', 'PinholePoseCal3DS2', 'PinholePoseCal3Fisheye', 'PinholePoseCal3Unified', 'PinholePoseCal3_S2', 'PlanarProjectionFactor1', 'PlanarProjectionFactor2', 'PlanarProjectionFactor3', 'Pose2', 'Pose3', 'Pose3AttitudeFactor', 'PoseRotationPrior2D', 'PoseRotationPrior3D', 'PoseTranslationPrior2D', 'PoseTranslationPrior3D', 'PreconditionerParameters', 'PreintegratedAhrsMeasurements', 'PreintegratedCombinedMeasurements', 'PreintegratedImuMeasurements', 'PreintegratedRotation', 'PreintegratedRotationParams', 'PreintegrationCombinedParams', 'PreintegrationParams', 'PrintDiscreteValues', 'PrintKeyList', 'PrintKeySet', 'PrintKeyVector', 'PriorFactorCal3Bundler', 'PriorFactorCal3DS2', 'PriorFactorCal3Fisheye', 'PriorFactorCal3Unified', 'PriorFactorCal3_S2', 'PriorFactorCalibratedCamera', 'PriorFactorConstantBias', 'PriorFactorDouble', 'PriorFactorNavState', 'PriorFactorPinholeCameraCal3Bundler', 'PriorFactorPinholeCameraCal3Fisheye', 'PriorFactorPinholeCameraCal3Unified', 'PriorFactorPinholeCameraCal3_S2', 'PriorFactorPoint2', 'PriorFactorPoint3', 'PriorFactorPose2', 'PriorFactorPose3', 'PriorFactorRot2', 'PriorFactorRot3', 'PriorFactorSO3', 'PriorFactorSO4', 'PriorFactorSOn', 'PriorFactorSimilarity2', 'PriorFactorSimilarity3', 'PriorFactorStereoPoint2', 'PriorFactorUnit3', 'PriorFactorVector', 'Quaternion', 'RangeFactor2', 'RangeFactor2D', 'RangeFactor3', 'RangeFactor3D', 'RangeFactorCalibratedCamera', 'RangeFactorCalibratedCameraPoint', 'RangeFactorPose2', 'RangeFactorPose3', 'RangeFactorSimpleCamera', 'RangeFactorSimpleCameraPoint', 'RangeFactorWithTransform2D', 'RangeFactorWithTransform3D', 'RangeFactorWithTransformPose2', 'RangeFactorWithTransformPose3', 'RedirectCout', 'ReferenceFrameFactorPoint3Pose3', 'Rot2', 'Rot3', 'Rot3AttitudeFactor', 'RotateDirectionsFactor', 'RotateFactor', 'SO3', 'SO4', 'SOn', 'Sampler', 'Scenario', 'ScenarioRunner', 'SfmData', 'SfmTrack', 'SfmTrack2d', 'ShonanAveraging2', 'ShonanAveraging3', 'ShonanAveragingParameters2', 'ShonanAveragingParameters3', 'ShonanFactor3', 'Similarity2', 'Similarity3', 'SimpleFundamentalMatrix', 'SmartFactorBasePinholeCameraCal3Bundler', 'SmartFactorBasePinholeCameraCal3DS2', 'SmartFactorBasePinholeCameraCal3Fisheye', 'SmartFactorBasePinholeCameraCal3Unified', 'SmartFactorBasePinholeCameraCal3_S2', 'SmartFactorBasePinholePoseCal3Bundler', 'SmartFactorBasePinholePoseCal3DS2', 'SmartFactorBasePinholePoseCal3Fisheye', 'SmartFactorBasePinholePoseCal3Unified', 'SmartFactorBasePinholePoseCal3_S2', 'SmartProjectionFactorPinholeCameraCal3Bundler', 'SmartProjectionFactorPinholeCameraCal3DS2', 'SmartProjectionFactorPinholeCameraCal3Fisheye', 'SmartProjectionFactorPinholeCameraCal3Unified', 'SmartProjectionFactorPinholeCameraCal3_S2', 'SmartProjectionFactorPinholePoseCal3Bundler', 'SmartProjectionFactorPinholePoseCal3DS2', 'SmartProjectionFactorPinholePoseCal3Fisheye', 'SmartProjectionFactorPinholePoseCal3Unified', 'SmartProjectionFactorPinholePoseCal3_S2', 'SmartProjectionParams', 'SmartProjectionPoseFactorCal3Bundler', 'SmartProjectionPoseFactorCal3DS2', 'SmartProjectionPoseFactorCal3Fisheye', 'SmartProjectionPoseFactorCal3Unified', 'SmartProjectionPoseFactorCal3_S2', 'SmartProjectionRigFactorPinholePoseCal3Bundler', 'SmartProjectionRigFactorPinholePoseCal3DS2', 'SmartProjectionRigFactorPinholePoseCal3Fisheye', 'SmartProjectionRigFactorPinholePoseCal3Unified', 'SmartProjectionRigFactorPinholePoseCal3_S2', 'StereoCamera', 'StereoPoint2', 'SubgraphSolver', 'SubgraphSolverParameters', 'Symbol', 'SymbolicBayesNet', 'SymbolicBayesTree', 'SymbolicBayesTreeClique', 'SymbolicCluster', 'SymbolicConditional', 'SymbolicEliminationTree', 'SymbolicFactor', 'SymbolicFactorGraph', 'SymbolicJunctionTree', 'TableDistribution', 'TableFactor', 'TransferFactorFundamentalMatrix', 'TransferFactorSimpleFundamentalMatrix', 'TranslationRecovery', 'TriangulationFactorCal3Bundler', 'TriangulationFactorCal3DS2', 'TriangulationFactorCal3Fisheye', 'TriangulationFactorCal3Unified', 'TriangulationFactorCal3_S2', 'TriangulationFactorPoseCal3Bundler', 'TriangulationFactorPoseCal3DS2', 'TriangulationFactorPoseCal3Fisheye', 'TriangulationFactorPoseCal3Unified', 'TriangulationFactorPoseCal3_S2', 'TriangulationParameters', 'TriangulationResult', 'Unit3', 'Value', 'Values', 'VariableIndex', 'VectorComponentFactorChebyshev1Basis', 'VectorComponentFactorChebyshev2', 'VectorComponentFactorChebyshev2Basis', 'VectorComponentFactorFourierBasis', 'VectorDerivativeFactorChebyshev1Basis', 'VectorDerivativeFactorChebyshev2', 'VectorDerivativeFactorChebyshev2Basis', 'VectorDerivativeFactorFourierBasis', 'VectorEvaluationFactorChebyshev1Basis', 'VectorEvaluationFactorChebyshev2', 'VectorEvaluationFactorChebyshev2Basis', 'VectorEvaluationFactorFourierBasis', 'VectorValues', 'cartesianProduct', 'checkConvergence', 'gtsfm', 'html', 'imuBias', 'initialCamerasAndPointsEstimate', 'initialCamerasEstimate', 'isDebugVersion', 'lago', 'linear_independent', 'load2D', 'load3D', 'markdown', 'mrsymbol', 'mrsymbolChr', 'mrsymbolIndex', 'mrsymbolLabel', 'noiseModel', 'parse2DFactors', 'parse3DFactors', 'readBal', 'readG2o', 'save2D', 'so3', 'symbol', 'symbolChr', 'symbolIndex', 'symbol_shorthand', 'triangulateNonlinear', 'triangulatePoint3', 'triangulateSafe', 'utilities', 'writeBAL', 'writeG2o']
|
|
15
15
|
class AHRSFactor(NonlinearFactor):
|
|
16
16
|
def __getstate__(self) -> tuple:
|
|
17
17
|
...
|
|
@@ -537,11 +537,6 @@ class BlockJacobiPreconditionerParameters(PreconditionerParameters):
|
|
|
537
537
|
def __init__(self) -> None:
|
|
538
538
|
...
|
|
539
539
|
class Cal3:
|
|
540
|
-
@staticmethod
|
|
541
|
-
def Dim() -> int:
|
|
542
|
-
"""
|
|
543
|
-
return DOF, dimensionality of tangent space
|
|
544
|
-
"""
|
|
545
540
|
def K(self) -> numpy.ndarray[tuple[typing.Literal[3], typing.Literal[3]], numpy.dtype[numpy.float64]]:
|
|
546
541
|
"""
|
|
547
542
|
return calibration matrix K
|
|
@@ -561,10 +556,6 @@ class Cal3:
|
|
|
561
556
|
"""
|
|
562
557
|
aspect ratio
|
|
563
558
|
"""
|
|
564
|
-
def dim(self) -> int:
|
|
565
|
-
"""
|
|
566
|
-
return DOF, dimensionality of tangent space
|
|
567
|
-
"""
|
|
568
559
|
def equals(self, K: Cal3, tol: float) -> bool:
|
|
569
560
|
"""
|
|
570
561
|
Check if equal up to specified tolerance.
|
|
@@ -712,6 +703,10 @@ class Cal3DS2_Base(Cal3):
|
|
|
712
703
|
"""
|
|
713
704
|
def deserialize(self, serialized: str) -> None:
|
|
714
705
|
...
|
|
706
|
+
def k(self) -> numpy.ndarray[tuple[typing.Literal[4], typing.Literal[1]], numpy.dtype[numpy.float64]]:
|
|
707
|
+
"""
|
|
708
|
+
return distortion parameter vector
|
|
709
|
+
"""
|
|
715
710
|
def k1(self) -> float:
|
|
716
711
|
"""
|
|
717
712
|
First distortion coefficient.
|
|
@@ -720,6 +715,14 @@ class Cal3DS2_Base(Cal3):
|
|
|
720
715
|
"""
|
|
721
716
|
Second distortion coefficient.
|
|
722
717
|
"""
|
|
718
|
+
def p1(self) -> float:
|
|
719
|
+
"""
|
|
720
|
+
First tangential distortion coefficient.
|
|
721
|
+
"""
|
|
722
|
+
def p2(self) -> float:
|
|
723
|
+
"""
|
|
724
|
+
Second tangential distortion coefficient.
|
|
725
|
+
"""
|
|
723
726
|
def print(self, s: str = '') -> None:
|
|
724
727
|
"""
|
|
725
728
|
print with optional string
|
|
@@ -748,6 +751,10 @@ class Cal3DS2_Base(Cal3):
|
|
|
748
751
|
|
|
749
752
|
Returns: point in (distorted) image coordinates
|
|
750
753
|
"""
|
|
754
|
+
def vector(self) -> numpy.ndarray[tuple[typing.Literal[9], typing.Literal[1]], numpy.dtype[numpy.float64]]:
|
|
755
|
+
"""
|
|
756
|
+
Return all parameters as a vector.
|
|
757
|
+
"""
|
|
751
758
|
class Cal3Fisheye(Cal3):
|
|
752
759
|
def __getstate__(self) -> tuple:
|
|
753
760
|
...
|
|
@@ -976,6 +983,16 @@ class Cal3_S2(Cal3):
|
|
|
976
983
|
Dcal: optional 2*5 Jacobian wrpt Cal3 parameters
|
|
977
984
|
Dp: optional 2*2 Jacobian wrpt intrinsic coordinates
|
|
978
985
|
|
|
986
|
+
Returns: point in intrinsic coordinates
|
|
987
|
+
"""
|
|
988
|
+
@typing.overload
|
|
989
|
+
def calibrate(self, p: numpy.ndarray[tuple[typing.Literal[3], typing.Literal[1]], numpy.dtype[numpy.float64]]) -> numpy.ndarray[tuple[typing.Literal[3], typing.Literal[1]], numpy.dtype[numpy.float64]]:
|
|
990
|
+
"""
|
|
991
|
+
Convert homogeneous image coordinates to intrinsic coordinates.
|
|
992
|
+
|
|
993
|
+
Args:
|
|
994
|
+
p: point in image coordinates
|
|
995
|
+
|
|
979
996
|
Returns: point in intrinsic coordinates
|
|
980
997
|
"""
|
|
981
998
|
def deserialize(self, serialized: str) -> None:
|
|
@@ -1024,7 +1041,7 @@ class Cal3_S2(Cal3):
|
|
|
1024
1041
|
|
|
1025
1042
|
Returns: point in image coordinates
|
|
1026
1043
|
"""
|
|
1027
|
-
class Cal3_S2Stereo(
|
|
1044
|
+
class Cal3_S2Stereo(Cal3_S2):
|
|
1028
1045
|
@typing.overload
|
|
1029
1046
|
def __init__(self) -> None:
|
|
1030
1047
|
...
|
|
@@ -1034,12 +1051,39 @@ class Cal3_S2Stereo(Cal3):
|
|
|
1034
1051
|
@typing.overload
|
|
1035
1052
|
def __init__(self, v: numpy.ndarray[tuple[M, typing.Literal[1]], numpy.dtype[numpy.float64]]) -> None:
|
|
1036
1053
|
...
|
|
1054
|
+
@typing.overload
|
|
1055
|
+
def __init__(self, fov: float, w: int, h: int, b: float) -> None:
|
|
1056
|
+
...
|
|
1037
1057
|
def __repr__(self, s: str = '') -> str:
|
|
1038
1058
|
...
|
|
1039
1059
|
def baseline(self) -> float:
|
|
1040
1060
|
"""
|
|
1041
1061
|
return baseline
|
|
1042
1062
|
"""
|
|
1063
|
+
@typing.overload
|
|
1064
|
+
def calibrate(self, p: numpy.ndarray[tuple[typing.Literal[2], typing.Literal[1]], numpy.dtype[numpy.float64]]) -> numpy.ndarray[tuple[typing.Literal[2], typing.Literal[1]], numpy.dtype[numpy.float64]]:
|
|
1065
|
+
"""
|
|
1066
|
+
Convert image coordinates uv to intrinsic coordinates xy.
|
|
1067
|
+
|
|
1068
|
+
Args:
|
|
1069
|
+
p: point in image coordinates
|
|
1070
|
+
Dcal: optional 2*6 Jacobian wrpt Cal3_S2Stereo parameters
|
|
1071
|
+
Dp: optional 2*2 Jacobian wrpt intrinsic coordinates
|
|
1072
|
+
|
|
1073
|
+
Returns: point in intrinsic coordinates
|
|
1074
|
+
"""
|
|
1075
|
+
@typing.overload
|
|
1076
|
+
def calibrate(self, p: numpy.ndarray[tuple[typing.Literal[2], typing.Literal[1]], numpy.dtype[numpy.float64]], Dcal: numpy.ndarray[tuple[M, N], numpy.dtype[numpy.float64]], Dp: numpy.ndarray[tuple[M, N], numpy.dtype[numpy.float64]]) -> numpy.ndarray[tuple[typing.Literal[2], typing.Literal[1]], numpy.dtype[numpy.float64]]:
|
|
1077
|
+
"""
|
|
1078
|
+
Convert image coordinates uv to intrinsic coordinates xy.
|
|
1079
|
+
|
|
1080
|
+
Args:
|
|
1081
|
+
p: point in image coordinates
|
|
1082
|
+
Dcal: optional 2*6 Jacobian wrpt Cal3_S2Stereo parameters
|
|
1083
|
+
Dp: optional 2*2 Jacobian wrpt intrinsic coordinates
|
|
1084
|
+
|
|
1085
|
+
Returns: point in intrinsic coordinates
|
|
1086
|
+
"""
|
|
1043
1087
|
def equals(self, other: Cal3_S2Stereo, tol: float) -> bool:
|
|
1044
1088
|
"""
|
|
1045
1089
|
Check if equal up to specified tolerance.
|
|
@@ -1056,6 +1100,28 @@ class Cal3_S2Stereo(Cal3):
|
|
|
1056
1100
|
"""
|
|
1057
1101
|
Given 6-dim tangent vector, create new calibration.
|
|
1058
1102
|
"""
|
|
1103
|
+
@typing.overload
|
|
1104
|
+
def uncalibrate(self, p: numpy.ndarray[tuple[typing.Literal[2], typing.Literal[1]], numpy.dtype[numpy.float64]]) -> numpy.ndarray[tuple[typing.Literal[2], typing.Literal[1]], numpy.dtype[numpy.float64]]:
|
|
1105
|
+
"""
|
|
1106
|
+
Convert intrinsic coordinates xy to image coordinates uv, fixed derivaitves.
|
|
1107
|
+
|
|
1108
|
+
Args:
|
|
1109
|
+
p: point in intrinsic coordinates
|
|
1110
|
+
|
|
1111
|
+
Returns: point in image coordinates
|
|
1112
|
+
"""
|
|
1113
|
+
@typing.overload
|
|
1114
|
+
def uncalibrate(self, p: numpy.ndarray[tuple[typing.Literal[2], typing.Literal[1]], numpy.dtype[numpy.float64]], Dcal: numpy.ndarray[tuple[M, N], numpy.dtype[numpy.float64]], Dp: numpy.ndarray[tuple[M, N], numpy.dtype[numpy.float64]]) -> numpy.ndarray[tuple[typing.Literal[2], typing.Literal[1]], numpy.dtype[numpy.float64]]:
|
|
1115
|
+
"""
|
|
1116
|
+
Convert intrinsic coordinates xy to image coordinates uv, fixed derivaitves.
|
|
1117
|
+
|
|
1118
|
+
Args:
|
|
1119
|
+
p: point in intrinsic coordinates
|
|
1120
|
+
Dcal: optional 2*6 Jacobian wrpt Cal3_S2Stereo parameters
|
|
1121
|
+
Dp: optional 2*2 Jacobian wrpt intrinsic coordinates
|
|
1122
|
+
|
|
1123
|
+
Returns: point in image coordinates
|
|
1124
|
+
"""
|
|
1059
1125
|
def vector(self) -> numpy.ndarray[tuple[typing.Literal[6], typing.Literal[1]], numpy.dtype[numpy.float64]]:
|
|
1060
1126
|
"""
|
|
1061
1127
|
vectorized form (column-wise)
|
|
@@ -1847,9 +1913,7 @@ class CombinedImuFactor(NoiseModelFactor):
|
|
|
1847
1913
|
def evaluateError(self, pose_i: Pose3, vel_i: numpy.ndarray[tuple[M, typing.Literal[1]], numpy.dtype[numpy.float64]], pose_j: Pose3, vel_j: numpy.ndarray[tuple[M, typing.Literal[1]], numpy.dtype[numpy.float64]], bias_i: imuBias.ConstantBias, bias_j: imuBias.ConstantBias) -> numpy.ndarray[tuple[M, typing.Literal[1]], numpy.dtype[numpy.float64]]:
|
|
1848
1914
|
...
|
|
1849
1915
|
def preintegratedMeasurements(self) -> PreintegratedCombinedMeasurements:
|
|
1850
|
-
|
|
1851
|
-
Access the preintegrated measurements.
|
|
1852
|
-
"""
|
|
1916
|
+
...
|
|
1853
1917
|
def serialize(self) -> str:
|
|
1854
1918
|
...
|
|
1855
1919
|
class ComponentDerivativeFactorChebyshev1Basis(NoiseModelFactor):
|
|
@@ -2864,6 +2928,21 @@ class DiscreteMarginals:
|
|
|
2864
2928
|
"""
|
|
2865
2929
|
def print(self, s: str = '', keyFormatter: typing.Callable[[int], str] = ...) -> None:
|
|
2866
2930
|
...
|
|
2931
|
+
class DiscreteScenario(Scenario):
|
|
2932
|
+
@staticmethod
|
|
2933
|
+
def FromCSV(csv_filepath: str) -> DiscreteScenario:
|
|
2934
|
+
"""
|
|
2935
|
+
Named constructor to create a scenario from a CSV file.
|
|
2936
|
+
|
|
2937
|
+
The CSV file should contain a header row followed by data rows. All timestamps will be normalized so that the first timestamp in the file corresponds to t=0 for the scenario. Expected CSV format (16 columns): timestamp,px,py,pz,qw,qx,qy,qz,vx,vy,vz,omegax,omegay,omegaz,ax,ay,az
|
|
2938
|
+
|
|
2939
|
+
Args:
|
|
2940
|
+
csv_filepath: Path to the CSV file.
|
|
2941
|
+
|
|
2942
|
+
Returns: A constructed DiscreteScenario.
|
|
2943
|
+
"""
|
|
2944
|
+
def __init__(self, poses: dict[float, Pose3], angularVelocities_b: dict[float, numpy.ndarray[tuple[typing.Literal[3], typing.Literal[1]], numpy.dtype[numpy.float64]]], velocities_n: dict[float, numpy.ndarray[tuple[typing.Literal[3], typing.Literal[1]], numpy.dtype[numpy.float64]]], accelerations_n: dict[float, numpy.ndarray[tuple[typing.Literal[3], typing.Literal[1]], numpy.dtype[numpy.float64]]]) -> None:
|
|
2945
|
+
...
|
|
2867
2946
|
class DiscreteSearch:
|
|
2868
2947
|
@staticmethod
|
|
2869
2948
|
def FromFactorGraph(factorGraph: DiscreteFactorGraph, ordering: Ordering, buildJunctionTree: bool = False) -> DiscreteSearch:
|
|
@@ -3550,6 +3629,15 @@ class FourierBasis:
|
|
|
3550
3629
|
@staticmethod
|
|
3551
3630
|
def WeightMatrix(N: int, x: numpy.ndarray[tuple[M, typing.Literal[1]], numpy.dtype[numpy.float64]]) -> numpy.ndarray[tuple[M, N], numpy.dtype[numpy.float64]]:
|
|
3552
3631
|
...
|
|
3632
|
+
class FrobeniusBetweenFactorGal3(NoiseModelFactor):
|
|
3633
|
+
@typing.overload
|
|
3634
|
+
def __init__(self, j1: int, j2: int, T12: Gal3) -> None:
|
|
3635
|
+
...
|
|
3636
|
+
@typing.overload
|
|
3637
|
+
def __init__(self, key1: int, key2: int, T12: Gal3, model: noiseModel.Base) -> None:
|
|
3638
|
+
...
|
|
3639
|
+
def evaluateError(self, T1: Gal3, T2: Gal3) -> numpy.ndarray[tuple[M, typing.Literal[1]], numpy.dtype[numpy.float64]]:
|
|
3640
|
+
...
|
|
3553
3641
|
class FrobeniusBetweenFactorPose2(NoiseModelFactor):
|
|
3554
3642
|
@typing.overload
|
|
3555
3643
|
def __init__(self, j1: int, j2: int, T12: Pose2) -> None:
|
|
@@ -3604,6 +3692,33 @@ class FrobeniusBetweenFactorSO4(NoiseModelFactor):
|
|
|
3604
3692
|
...
|
|
3605
3693
|
def evaluateError(self, T1: SO4, T2: SO4) -> numpy.ndarray[tuple[M, typing.Literal[1]], numpy.dtype[numpy.float64]]:
|
|
3606
3694
|
...
|
|
3695
|
+
class FrobeniusBetweenFactorSimilarity2(NoiseModelFactor):
|
|
3696
|
+
@typing.overload
|
|
3697
|
+
def __init__(self, j1: int, j2: int, T12: Similarity2) -> None:
|
|
3698
|
+
...
|
|
3699
|
+
@typing.overload
|
|
3700
|
+
def __init__(self, key1: int, key2: int, T12: Similarity2, model: noiseModel.Base) -> None:
|
|
3701
|
+
...
|
|
3702
|
+
def evaluateError(self, T1: Similarity2, T2: Similarity2) -> numpy.ndarray[tuple[M, typing.Literal[1]], numpy.dtype[numpy.float64]]:
|
|
3703
|
+
...
|
|
3704
|
+
class FrobeniusBetweenFactorSimilarity3(NoiseModelFactor):
|
|
3705
|
+
@typing.overload
|
|
3706
|
+
def __init__(self, j1: int, j2: int, T12: Similarity3) -> None:
|
|
3707
|
+
...
|
|
3708
|
+
@typing.overload
|
|
3709
|
+
def __init__(self, key1: int, key2: int, T12: Similarity3, model: noiseModel.Base) -> None:
|
|
3710
|
+
...
|
|
3711
|
+
def evaluateError(self, T1: Similarity3, T2: Similarity3) -> numpy.ndarray[tuple[M, typing.Literal[1]], numpy.dtype[numpy.float64]]:
|
|
3712
|
+
...
|
|
3713
|
+
class FrobeniusFactorGal3(NoiseModelFactor):
|
|
3714
|
+
@typing.overload
|
|
3715
|
+
def __init__(self, key1: int, key2: int) -> None:
|
|
3716
|
+
...
|
|
3717
|
+
@typing.overload
|
|
3718
|
+
def __init__(self, j1: int, j2: int, model: noiseModel.Base) -> None:
|
|
3719
|
+
...
|
|
3720
|
+
def evaluateError(self, T1: Gal3, T2: Gal3) -> numpy.ndarray[tuple[M, typing.Literal[1]], numpy.dtype[numpy.float64]]:
|
|
3721
|
+
...
|
|
3607
3722
|
class FrobeniusFactorPose2(NoiseModelFactor):
|
|
3608
3723
|
@typing.overload
|
|
3609
3724
|
def __init__(self, key1: int, key2: int) -> None:
|
|
@@ -3658,6 +3773,29 @@ class FrobeniusFactorSO4(NoiseModelFactor):
|
|
|
3658
3773
|
...
|
|
3659
3774
|
def evaluateError(self, T1: SO4, T2: SO4) -> numpy.ndarray[tuple[M, typing.Literal[1]], numpy.dtype[numpy.float64]]:
|
|
3660
3775
|
...
|
|
3776
|
+
class FrobeniusFactorSimilarity2(NoiseModelFactor):
|
|
3777
|
+
@typing.overload
|
|
3778
|
+
def __init__(self, key1: int, key2: int) -> None:
|
|
3779
|
+
...
|
|
3780
|
+
@typing.overload
|
|
3781
|
+
def __init__(self, j1: int, j2: int, model: noiseModel.Base) -> None:
|
|
3782
|
+
...
|
|
3783
|
+
def evaluateError(self, T1: Similarity2, T2: Similarity2) -> numpy.ndarray[tuple[M, typing.Literal[1]], numpy.dtype[numpy.float64]]:
|
|
3784
|
+
...
|
|
3785
|
+
class FrobeniusFactorSimilarity3(NoiseModelFactor):
|
|
3786
|
+
@typing.overload
|
|
3787
|
+
def __init__(self, key1: int, key2: int) -> None:
|
|
3788
|
+
...
|
|
3789
|
+
@typing.overload
|
|
3790
|
+
def __init__(self, j1: int, j2: int, model: noiseModel.Base) -> None:
|
|
3791
|
+
...
|
|
3792
|
+
def evaluateError(self, T1: Similarity3, T2: Similarity3) -> numpy.ndarray[tuple[M, typing.Literal[1]], numpy.dtype[numpy.float64]]:
|
|
3793
|
+
...
|
|
3794
|
+
class FrobeniusPriorGal3(NoiseModelFactor):
|
|
3795
|
+
def __init__(self, j: int, M: numpy.ndarray[tuple[M, N], numpy.dtype[numpy.float64]], model: noiseModel.Base) -> None:
|
|
3796
|
+
...
|
|
3797
|
+
def evaluateError(self, g: Gal3) -> numpy.ndarray[tuple[M, typing.Literal[1]], numpy.dtype[numpy.float64]]:
|
|
3798
|
+
...
|
|
3661
3799
|
class FrobeniusPriorPose2(NoiseModelFactor):
|
|
3662
3800
|
def __init__(self, j: int, M: numpy.ndarray[tuple[M, N], numpy.dtype[numpy.float64]], model: noiseModel.Base) -> None:
|
|
3663
3801
|
...
|
|
@@ -3688,6 +3826,16 @@ class FrobeniusPriorSO4(NoiseModelFactor):
|
|
|
3688
3826
|
...
|
|
3689
3827
|
def evaluateError(self, g: SO4) -> numpy.ndarray[tuple[M, typing.Literal[1]], numpy.dtype[numpy.float64]]:
|
|
3690
3828
|
...
|
|
3829
|
+
class FrobeniusPriorSimilarity2(NoiseModelFactor):
|
|
3830
|
+
def __init__(self, j: int, M: numpy.ndarray[tuple[M, N], numpy.dtype[numpy.float64]], model: noiseModel.Base) -> None:
|
|
3831
|
+
...
|
|
3832
|
+
def evaluateError(self, g: Similarity2) -> numpy.ndarray[tuple[M, typing.Literal[1]], numpy.dtype[numpy.float64]]:
|
|
3833
|
+
...
|
|
3834
|
+
class FrobeniusPriorSimilarity3(NoiseModelFactor):
|
|
3835
|
+
def __init__(self, j: int, M: numpy.ndarray[tuple[M, N], numpy.dtype[numpy.float64]], model: noiseModel.Base) -> None:
|
|
3836
|
+
...
|
|
3837
|
+
def evaluateError(self, g: Similarity3) -> numpy.ndarray[tuple[M, typing.Literal[1]], numpy.dtype[numpy.float64]]:
|
|
3838
|
+
...
|
|
3691
3839
|
class FundamentalMatrix:
|
|
3692
3840
|
@staticmethod
|
|
3693
3841
|
def Dim() -> int:
|
|
@@ -3891,6 +4039,87 @@ class GPSFactorArmCalib(NonlinearFactor):
|
|
|
3891
4039
|
"""
|
|
3892
4040
|
def serialize(self) -> str:
|
|
3893
4041
|
...
|
|
4042
|
+
class Gal3:
|
|
4043
|
+
@staticmethod
|
|
4044
|
+
def Expmap(xi: numpy.ndarray[tuple[typing.Literal[10], typing.Literal[1]], numpy.dtype[numpy.float64]]) -> Gal3:
|
|
4045
|
+
"""
|
|
4046
|
+
Exponential map at identity: tangent vector xi -> manifold element g.
|
|
4047
|
+
"""
|
|
4048
|
+
@staticmethod
|
|
4049
|
+
def Identity() -> Gal3:
|
|
4050
|
+
"""
|
|
4051
|
+
Return the identity element.
|
|
4052
|
+
"""
|
|
4053
|
+
@staticmethod
|
|
4054
|
+
def Logmap(g: Gal3) -> numpy.ndarray[tuple[typing.Literal[10], typing.Literal[1]], numpy.dtype[numpy.float64]]:
|
|
4055
|
+
"""
|
|
4056
|
+
Logarithmic map at identity: manifold element g -> tangent vector xi.
|
|
4057
|
+
"""
|
|
4058
|
+
@typing.overload
|
|
4059
|
+
def __init__(self) -> None:
|
|
4060
|
+
...
|
|
4061
|
+
@typing.overload
|
|
4062
|
+
def __init__(self, R: Rot3, r: numpy.ndarray[tuple[typing.Literal[3], typing.Literal[1]], numpy.dtype[numpy.float64]], v: numpy.ndarray[tuple[typing.Literal[3], typing.Literal[1]], numpy.dtype[numpy.float64]], t: float) -> None:
|
|
4063
|
+
...
|
|
4064
|
+
@typing.overload
|
|
4065
|
+
def __init__(self, M: numpy.ndarray[tuple[typing.Literal[5], typing.Literal[5]], numpy.dtype[numpy.float64]]) -> None:
|
|
4066
|
+
...
|
|
4067
|
+
def __mul__(self, arg0: Gal3) -> Gal3:
|
|
4068
|
+
...
|
|
4069
|
+
def __repr__(self, s: str = '') -> str:
|
|
4070
|
+
...
|
|
4071
|
+
def between(self, other: Gal3) -> Gal3:
|
|
4072
|
+
...
|
|
4073
|
+
def compose(self, other: Gal3) -> Gal3:
|
|
4074
|
+
...
|
|
4075
|
+
def equals(self, other: Gal3, tol: float) -> bool:
|
|
4076
|
+
"""
|
|
4077
|
+
Check equality within tolerance.
|
|
4078
|
+
"""
|
|
4079
|
+
def expmap(self, xi: numpy.ndarray[tuple[typing.Literal[10], typing.Literal[1]], numpy.dtype[numpy.float64]]) -> Gal3:
|
|
4080
|
+
...
|
|
4081
|
+
def inverse(self) -> Gal3:
|
|
4082
|
+
"""
|
|
4083
|
+
Return the inverse of this element.
|
|
4084
|
+
"""
|
|
4085
|
+
def localCoordinates(self, g: Gal3) -> numpy.ndarray[tuple[typing.Literal[10], typing.Literal[1]], numpy.dtype[numpy.float64]]:
|
|
4086
|
+
"""
|
|
4087
|
+
localCoordinates as required by manifold concept: finds tangent vector between *this and g
|
|
4088
|
+
"""
|
|
4089
|
+
def logmap(self, g: Gal3) -> numpy.ndarray[tuple[typing.Literal[10], typing.Literal[1]], numpy.dtype[numpy.float64]]:
|
|
4090
|
+
"""
|
|
4091
|
+
logmap as required by manifold concept Applies logarithmic map to group element that takes *this to g
|
|
4092
|
+
"""
|
|
4093
|
+
def matrix(self) -> numpy.ndarray[tuple[typing.Literal[5], typing.Literal[5]], numpy.dtype[numpy.float64]]:
|
|
4094
|
+
"""
|
|
4095
|
+
Return 5x5 homogeneous matrix representation.
|
|
4096
|
+
"""
|
|
4097
|
+
def print(self, s: str = '') -> None:
|
|
4098
|
+
"""
|
|
4099
|
+
Print with optional string prefix.
|
|
4100
|
+
"""
|
|
4101
|
+
def retract(self, xi: numpy.ndarray[tuple[typing.Literal[10], typing.Literal[1]], numpy.dtype[numpy.float64]]) -> Gal3:
|
|
4102
|
+
...
|
|
4103
|
+
def rotation(self) -> Rot3:
|
|
4104
|
+
"""
|
|
4105
|
+
Access rotation component (Rot3)
|
|
4106
|
+
"""
|
|
4107
|
+
def time(self) -> float:
|
|
4108
|
+
"""
|
|
4109
|
+
Access time component (double)
|
|
4110
|
+
"""
|
|
4111
|
+
def translation(self) -> numpy.ndarray[tuple[typing.Literal[3], typing.Literal[1]], numpy.dtype[numpy.float64]]:
|
|
4112
|
+
"""
|
|
4113
|
+
Access translation component (Point3)
|
|
4114
|
+
"""
|
|
4115
|
+
def vec(self) -> numpy.ndarray[tuple[typing.Literal[25], typing.Literal[1]], numpy.dtype[numpy.float64]]:
|
|
4116
|
+
"""
|
|
4117
|
+
Vectorize 5x5 matrix into a 25-dim vector.
|
|
4118
|
+
"""
|
|
4119
|
+
def velocity(self) -> numpy.ndarray[tuple[typing.Literal[3], typing.Literal[1]], numpy.dtype[numpy.float64]]:
|
|
4120
|
+
"""
|
|
4121
|
+
Access velocity component (Vector3)
|
|
4122
|
+
"""
|
|
3894
4123
|
class GaussNewtonOptimizer(NonlinearOptimizer):
|
|
3895
4124
|
@typing.overload
|
|
3896
4125
|
def __init__(self, graph: NonlinearFactorGraph, initialValues: ...) -> None:
|
|
@@ -7027,9 +7256,7 @@ class ImuFactor(NonlinearFactor):
|
|
|
7027
7256
|
def evaluateError(self, pose_i: Pose3, vel_i: numpy.ndarray[tuple[M, typing.Literal[1]], numpy.dtype[numpy.float64]], pose_j: Pose3, vel_j: numpy.ndarray[tuple[M, typing.Literal[1]], numpy.dtype[numpy.float64]], bias: imuBias.ConstantBias) -> numpy.ndarray[tuple[M, typing.Literal[1]], numpy.dtype[numpy.float64]]:
|
|
7028
7257
|
...
|
|
7029
7258
|
def preintegratedMeasurements(self) -> PreintegratedImuMeasurements:
|
|
7030
|
-
|
|
7031
|
-
Access the preintegrated measurements.
|
|
7032
|
-
"""
|
|
7259
|
+
...
|
|
7033
7260
|
def serialize(self) -> str:
|
|
7034
7261
|
...
|
|
7035
7262
|
class ImuFactor2(NonlinearFactor):
|
|
@@ -7048,9 +7275,7 @@ class ImuFactor2(NonlinearFactor):
|
|
|
7048
7275
|
def evaluateError(self, state_i: NavState, state_j: NavState, bias_i: imuBias.ConstantBias) -> numpy.ndarray[tuple[M, typing.Literal[1]], numpy.dtype[numpy.float64]]:
|
|
7049
7276
|
...
|
|
7050
7277
|
def preintegratedMeasurements(self) -> PreintegratedImuMeasurements:
|
|
7051
|
-
|
|
7052
|
-
Access the preintegrated measurements.
|
|
7053
|
-
"""
|
|
7278
|
+
...
|
|
7054
7279
|
def serialize(self) -> str:
|
|
7055
7280
|
...
|
|
7056
7281
|
class IncrementalFixedLagSmoother(FixedLagSmoother):
|
|
@@ -10501,7 +10726,9 @@ class Pose2:
|
|
|
10501
10726
|
logmap with optional derivatives
|
|
10502
10727
|
"""
|
|
10503
10728
|
def matrix(self) -> numpy.ndarray[tuple[typing.Literal[3], typing.Literal[3]], numpy.dtype[numpy.float64]]:
|
|
10504
|
-
|
|
10729
|
+
"""
|
|
10730
|
+
return transformation matrix
|
|
10731
|
+
"""
|
|
10505
10732
|
def print(self, s: str = '') -> None:
|
|
10506
10733
|
"""
|
|
10507
10734
|
print with optional string
|
|
@@ -11136,9 +11363,7 @@ class PreintegratedCombinedMeasurements:
|
|
|
11136
11363
|
def deserialize(self, serialized: str) -> None:
|
|
11137
11364
|
...
|
|
11138
11365
|
def equals(self, expected: PreintegratedCombinedMeasurements, tol: float) -> bool:
|
|
11139
|
-
|
|
11140
|
-
equals
|
|
11141
|
-
"""
|
|
11366
|
+
...
|
|
11142
11367
|
def integrateMeasurement(self, measuredAcc: numpy.ndarray[tuple[M, typing.Literal[1]], numpy.dtype[numpy.float64]], measuredOmega: numpy.ndarray[tuple[M, typing.Literal[1]], numpy.dtype[numpy.float64]], deltaT: float) -> None:
|
|
11143
11368
|
...
|
|
11144
11369
|
def predict(self, state_i: NavState, bias: imuBias.ConstantBias) -> NavState:
|
|
@@ -11148,9 +11373,7 @@ class PreintegratedCombinedMeasurements:
|
|
|
11148
11373
|
def print(self, s: str = 'Preintegrated Measurements:') -> None:
|
|
11149
11374
|
...
|
|
11150
11375
|
def resetIntegration(self) -> None:
|
|
11151
|
-
|
|
11152
|
-
Re-initializePreintegratedCombinedMeasurements.
|
|
11153
|
-
"""
|
|
11376
|
+
...
|
|
11154
11377
|
def resetIntegrationAndSetBias(self, biasHat: imuBias.ConstantBias) -> None:
|
|
11155
11378
|
...
|
|
11156
11379
|
def serialize(self) -> str:
|
|
@@ -11183,27 +11406,19 @@ class PreintegratedImuMeasurements:
|
|
|
11183
11406
|
def deserialize(self, serialized: str) -> None:
|
|
11184
11407
|
...
|
|
11185
11408
|
def equals(self, expected: PreintegratedImuMeasurements, tol: float) -> bool:
|
|
11186
|
-
|
|
11187
|
-
equals
|
|
11188
|
-
"""
|
|
11409
|
+
...
|
|
11189
11410
|
def integrateMeasurement(self, measuredAcc: numpy.ndarray[tuple[M, typing.Literal[1]], numpy.dtype[numpy.float64]], measuredOmega: numpy.ndarray[tuple[M, typing.Literal[1]], numpy.dtype[numpy.float64]], deltaT: float) -> None:
|
|
11190
11411
|
...
|
|
11191
11412
|
def predict(self, state_i: NavState, bias: imuBias.ConstantBias) -> NavState:
|
|
11192
11413
|
...
|
|
11193
11414
|
def preintMeasCov(self) -> numpy.ndarray[tuple[M, N], numpy.dtype[numpy.float64]]:
|
|
11194
|
-
|
|
11195
|
-
Return pre-integrated measurement covariance.
|
|
11196
|
-
"""
|
|
11415
|
+
...
|
|
11197
11416
|
def preintegrated(self) -> numpy.ndarray[tuple[typing.Literal[9], typing.Literal[1]], numpy.dtype[numpy.float64]]:
|
|
11198
11417
|
...
|
|
11199
11418
|
def print(self, s: str = '') -> None:
|
|
11200
|
-
|
|
11201
|
-
print
|
|
11202
|
-
"""
|
|
11419
|
+
...
|
|
11203
11420
|
def resetIntegration(self) -> None:
|
|
11204
|
-
|
|
11205
|
-
Re-initializePreintegratedImuMeasurements.
|
|
11206
|
-
"""
|
|
11421
|
+
...
|
|
11207
11422
|
def resetIntegrationAndSetBias(self, biasHat: imuBias.ConstantBias) -> None:
|
|
11208
11423
|
...
|
|
11209
11424
|
def serialize(self) -> str:
|
|
@@ -11315,8 +11530,6 @@ class PreintegrationCombinedParams(PreintegrationParams):
|
|
|
11315
11530
|
...
|
|
11316
11531
|
def getBiasAccCovariance(self) -> numpy.ndarray[tuple[typing.Literal[3], typing.Literal[3]], numpy.dtype[numpy.float64]]:
|
|
11317
11532
|
...
|
|
11318
|
-
def getBiasAccOmegaInit(self) -> numpy.ndarray[tuple[typing.Literal[6], typing.Literal[6]], numpy.dtype[numpy.float64]]:
|
|
11319
|
-
...
|
|
11320
11533
|
def getBiasOmegaCovariance(self) -> numpy.ndarray[tuple[typing.Literal[3], typing.Literal[3]], numpy.dtype[numpy.float64]]:
|
|
11321
11534
|
...
|
|
11322
11535
|
def print(self, s: str = '') -> None:
|
|
@@ -11325,8 +11538,6 @@ class PreintegrationCombinedParams(PreintegrationParams):
|
|
|
11325
11538
|
...
|
|
11326
11539
|
def setBiasAccCovariance(self, cov: numpy.ndarray[tuple[M, N], numpy.dtype[numpy.float64]]) -> None:
|
|
11327
11540
|
...
|
|
11328
|
-
def setBiasAccOmegaInit(self, cov: numpy.ndarray[tuple[M, N], numpy.dtype[numpy.float64]]) -> None:
|
|
11329
|
-
...
|
|
11330
11541
|
def setBiasOmegaCovariance(self, cov: numpy.ndarray[tuple[M, N], numpy.dtype[numpy.float64]]) -> None:
|
|
11331
11542
|
...
|
|
11332
11543
|
class PreintegrationParams(PreintegratedRotationParams):
|
|
@@ -13159,6 +13370,11 @@ class Similarity2:
|
|
|
13159
13370
|
Each pair is of the form (aTi, bTi). Given a list of pairs in frame a, and a list of pairs in frame b, Align() will compute the best-fit Similarity2 aSb transformation to align them. First, the rotation aRb will be computed as the average (Karcher mean) of many estimates aRb (from each pair). Afterwards, the scale factor will be computed using the algorithm described here: http://www5.informatik.uni-erlangen.de/Forschung/Publikationen/2005/Zinsser05-PSR.pdf
|
|
13160
13371
|
"""
|
|
13161
13372
|
@staticmethod
|
|
13373
|
+
def Dim() -> int:
|
|
13374
|
+
"""
|
|
13375
|
+
Dimensionality of tangent space = 4 DOF - used to autodetect sizes.
|
|
13376
|
+
"""
|
|
13377
|
+
@staticmethod
|
|
13162
13378
|
def Expmap(v: numpy.ndarray[tuple[M, typing.Literal[1]], numpy.dtype[numpy.float64]]) -> Similarity2:
|
|
13163
13379
|
"""
|
|
13164
13380
|
Exponential map at the identity.
|
|
@@ -13169,6 +13385,11 @@ class Similarity2:
|
|
|
13169
13385
|
Hat maps from tangent vector to Lie algebra.
|
|
13170
13386
|
"""
|
|
13171
13387
|
@staticmethod
|
|
13388
|
+
def Identity() -> Similarity2:
|
|
13389
|
+
"""
|
|
13390
|
+
Return an identity transform.
|
|
13391
|
+
"""
|
|
13392
|
+
@staticmethod
|
|
13172
13393
|
def Logmap(S: Similarity2) -> numpy.ndarray[tuple[typing.Literal[4], typing.Literal[1]], numpy.dtype[numpy.float64]]:
|
|
13173
13394
|
"""
|
|
13174
13395
|
Log map at the identity$ [t_x, t_y, \\delta, \\lambda] $.
|
|
@@ -13193,8 +13414,18 @@ class Similarity2:
|
|
|
13193
13414
|
@typing.overload
|
|
13194
13415
|
def __init__(self, T: numpy.ndarray[tuple[M, N], numpy.dtype[numpy.float64]]) -> None:
|
|
13195
13416
|
...
|
|
13417
|
+
def __mul__(self, arg0: Similarity2) -> Similarity2:
|
|
13418
|
+
...
|
|
13196
13419
|
def __repr__(self, s: str = '') -> str:
|
|
13197
13420
|
...
|
|
13421
|
+
def between(self, other: Similarity2) -> Similarity2:
|
|
13422
|
+
...
|
|
13423
|
+
def compose(self, other: Similarity2) -> Similarity2:
|
|
13424
|
+
...
|
|
13425
|
+
def dim(self) -> int:
|
|
13426
|
+
"""
|
|
13427
|
+
Dimensionality of tangent space = 4 DOF.
|
|
13428
|
+
"""
|
|
13198
13429
|
def equals(self, sim: Similarity2, tol: float) -> bool:
|
|
13199
13430
|
"""
|
|
13200
13431
|
Compare with tolerance.
|
|
@@ -13203,18 +13434,28 @@ class Similarity2:
|
|
|
13203
13434
|
"""
|
|
13204
13435
|
expmap as required by manifold concept Applies exponential map to v and composes with *this
|
|
13205
13436
|
"""
|
|
13437
|
+
def inverse(self) -> Similarity2:
|
|
13438
|
+
"""
|
|
13439
|
+
Return the inverse.
|
|
13440
|
+
"""
|
|
13441
|
+
def localCoordinates(self, t2: Similarity2) -> numpy.ndarray[tuple[typing.Literal[4], typing.Literal[1]], numpy.dtype[numpy.float64]]:
|
|
13442
|
+
...
|
|
13206
13443
|
def logmap(self, g: Similarity2) -> numpy.ndarray[tuple[typing.Literal[4], typing.Literal[1]], numpy.dtype[numpy.float64]]:
|
|
13207
13444
|
"""
|
|
13208
13445
|
logmap as required by manifold concept Applies logarithmic map to group element that takes *this to g
|
|
13209
13446
|
"""
|
|
13210
13447
|
def matrix(self) -> numpy.ndarray[tuple[typing.Literal[3], typing.Literal[3]], numpy.dtype[numpy.float64]]:
|
|
13211
13448
|
"""
|
|
13212
|
-
Calculate
|
|
13449
|
+
Calculate 3*3 matrix group equivalent.
|
|
13213
13450
|
"""
|
|
13214
13451
|
def print(self, s: str = '') -> None:
|
|
13215
13452
|
"""
|
|
13216
13453
|
Print with optional string.
|
|
13217
13454
|
"""
|
|
13455
|
+
def retract(self, v: numpy.ndarray[tuple[M, typing.Literal[1]], numpy.dtype[numpy.float64]]) -> Similarity2:
|
|
13456
|
+
"""
|
|
13457
|
+
retract as required by manifold concept: applies v at *this
|
|
13458
|
+
"""
|
|
13218
13459
|
def rotation(self) -> Rot2:
|
|
13219
13460
|
"""
|
|
13220
13461
|
Return a GTSAM rotation.
|
|
@@ -13255,6 +13496,11 @@ class Similarity3:
|
|
|
13255
13496
|
Each pair is of the form (aTi, bTi). Given a list of pairs in frame a, and a list of pairs in frame b, Align() will compute the best-fit Similarity3 aSb transformation to align them. First, the rotation aRb will be computed as the average (Karcher mean) of many estimates aRb (from each pair). Afterwards, the scale factor will be computed using the algorithm described here: http://www5.informatik.uni-erlangen.de/Forschung/Publikationen/2005/Zinsser05-PSR.pdf
|
|
13256
13497
|
"""
|
|
13257
13498
|
@staticmethod
|
|
13499
|
+
def Dim() -> int:
|
|
13500
|
+
"""
|
|
13501
|
+
Dimensionality of tangent space = 7 DOF - used to autodetect sizes.
|
|
13502
|
+
"""
|
|
13503
|
+
@staticmethod
|
|
13258
13504
|
def Expmap(v: numpy.ndarray[tuple[M, typing.Literal[1]], numpy.dtype[numpy.float64]]) -> Similarity3:
|
|
13259
13505
|
"""
|
|
13260
13506
|
Exponential map at the identity.
|
|
@@ -13270,6 +13516,11 @@ class Similarity3:
|
|
|
13270
13516
|
Returns: 4*4 element of Lie algebra that can be exponentiated
|
|
13271
13517
|
"""
|
|
13272
13518
|
@staticmethod
|
|
13519
|
+
def Identity() -> Similarity3:
|
|
13520
|
+
"""
|
|
13521
|
+
Return an identity transform.
|
|
13522
|
+
"""
|
|
13523
|
+
@staticmethod
|
|
13273
13524
|
def Logmap(s: Similarity3) -> numpy.ndarray[tuple[typing.Literal[7], typing.Literal[1]], numpy.dtype[numpy.float64]]:
|
|
13274
13525
|
"""
|
|
13275
13526
|
Log map at the identity$ [R_x,R_y,R_z, t_x, t_y, t_z, \\lambda] $.
|
|
@@ -13294,8 +13545,18 @@ class Similarity3:
|
|
|
13294
13545
|
@typing.overload
|
|
13295
13546
|
def __init__(self, T: numpy.ndarray[tuple[M, N], numpy.dtype[numpy.float64]]) -> None:
|
|
13296
13547
|
...
|
|
13548
|
+
def __mul__(self, arg0: Similarity3) -> Similarity3:
|
|
13549
|
+
...
|
|
13297
13550
|
def __repr__(self, s: str = '') -> str:
|
|
13298
13551
|
...
|
|
13552
|
+
def between(self, other: Similarity3) -> Similarity3:
|
|
13553
|
+
...
|
|
13554
|
+
def compose(self, other: Similarity3) -> Similarity3:
|
|
13555
|
+
...
|
|
13556
|
+
def dim(self) -> int:
|
|
13557
|
+
"""
|
|
13558
|
+
Dimensionality of tangent space = 7 DOF.
|
|
13559
|
+
"""
|
|
13299
13560
|
def equals(self, sim: Similarity3, tol: float) -> bool:
|
|
13300
13561
|
"""
|
|
13301
13562
|
Compare with tolerance.
|
|
@@ -13304,6 +13565,12 @@ class Similarity3:
|
|
|
13304
13565
|
"""
|
|
13305
13566
|
expmap as required by manifold concept Applies exponential map to v and composes with *this
|
|
13306
13567
|
"""
|
|
13568
|
+
def inverse(self) -> Similarity3:
|
|
13569
|
+
"""
|
|
13570
|
+
Return the inverse.
|
|
13571
|
+
"""
|
|
13572
|
+
def localCoordinates(self, t2: Similarity3) -> numpy.ndarray[tuple[typing.Literal[7], typing.Literal[1]], numpy.dtype[numpy.float64]]:
|
|
13573
|
+
...
|
|
13307
13574
|
def logmap(self, g: Similarity3) -> numpy.ndarray[tuple[typing.Literal[7], typing.Literal[1]], numpy.dtype[numpy.float64]]:
|
|
13308
13575
|
"""
|
|
13309
13576
|
logmap as required by manifold concept Applies logarithmic map to group element that takes *this to g
|
|
@@ -13316,6 +13583,10 @@ class Similarity3:
|
|
|
13316
13583
|
"""
|
|
13317
13584
|
Print with optional string.
|
|
13318
13585
|
"""
|
|
13586
|
+
def retract(self, v: numpy.ndarray[tuple[M, typing.Literal[1]], numpy.dtype[numpy.float64]]) -> Similarity3:
|
|
13587
|
+
"""
|
|
13588
|
+
retract as required by manifold concept: applies v at *this
|
|
13589
|
+
"""
|
|
13319
13590
|
def rotation(self) -> Rot3:
|
|
13320
13591
|
"""
|
|
13321
13592
|
Return a GTSAM rotation.
|