data:image/s3,"s3://crabby-images/02ace/02ace956f9868cf2a1a780bd2c0a517cd3a46077" alt="JAR search and dependency download from the Maven repository"
boofcv.factory.sfm.FactoryVisualOdometry Maven / Gradle / Ivy
Go to download
Show more of this group Show more artifacts with this name
Show all versions of boofcv-sfm Show documentation
Show all versions of boofcv-sfm Show documentation
BoofCV is an open source Java library for real-time computer vision and robotics applications.
The newest version!
/*
* Copyright (c) 2021, Peter Abeles. All Rights Reserved.
*
* This file is part of BoofCV (http://boofcv.org).
*
* Licensed under the Apache License, Version 2.0 (the "License");
* you may not use this file except in compliance with the License.
* You may obtain a copy of the License at
*
* http://www.apache.org/licenses/LICENSE-2.0
*
* Unless required by applicable law or agreed to in writing, software
* distributed under the License is distributed on an "AS IS" BASIS,
* WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied.
* See the License for the specific language governing permissions and
* limitations under the License.
*/
package boofcv.factory.sfm;
import boofcv.abst.disparity.StereoDisparitySparse;
import boofcv.abst.feature.associate.AssociateDescription2D;
import boofcv.abst.feature.associate.EnforceUniqueByScore;
import boofcv.abst.feature.associate.ScoreAssociation;
import boofcv.abst.feature.describe.DescribePointRadiusAngle;
import boofcv.abst.feature.detdesc.DetectDescribePoint;
import boofcv.abst.geo.Estimate1ofPnP;
import boofcv.abst.geo.EstimateNofPnP;
import boofcv.abst.geo.RefinePnP;
import boofcv.abst.geo.Triangulate2ViewsMetric;
import boofcv.abst.sfm.DepthSparse3D_to_PixelTo3D;
import boofcv.abst.sfm.ImagePixelTo3D;
import boofcv.abst.sfm.d2.ImageMotion2D;
import boofcv.abst.sfm.d3.*;
import boofcv.abst.tracker.PointTracker;
import boofcv.alg.feature.associate.AssociateStereo2D;
import boofcv.alg.geo.pose.*;
import boofcv.alg.sfm.DepthSparse3D;
import boofcv.alg.sfm.StereoSparse3D;
import boofcv.alg.sfm.d3.*;
import boofcv.alg.sfm.d3.direct.PyramidDirectColorDepth;
import boofcv.alg.sfm.d3.structure.MaxGeoKeyFrameManager;
import boofcv.alg.sfm.d3.structure.TickTockKeyFrameManager;
import boofcv.alg.sfm.d3.structure.VisOdomKeyFrameManager;
import boofcv.alg.sfm.robust.DistancePlane2DToPixelSq;
import boofcv.alg.sfm.robust.GenerateSe2_PlanePtPixel;
import boofcv.factory.disparity.FactoryStereoDisparity;
import boofcv.factory.feature.associate.FactoryAssociation;
import boofcv.factory.feature.describe.FactoryDescribePointRadiusAngle;
import boofcv.factory.feature.detdesc.FactoryDetectDescribe;
import boofcv.factory.geo.ConfigTriangulation;
import boofcv.factory.geo.EstimatorToGenerator;
import boofcv.factory.geo.FactoryMultiView;
import boofcv.factory.geo.FactoryMultiViewRobust;
import boofcv.factory.tracker.FactoryPointTracker;
import boofcv.factory.transform.pyramid.FactoryPyramid;
import boofcv.struct.feature.TupleDesc;
import boofcv.struct.geo.Point2D3D;
import boofcv.struct.image.ImageBase;
import boofcv.struct.image.ImageGray;
import boofcv.struct.image.ImageType;
import boofcv.struct.image.Planar;
import boofcv.struct.pyramid.ConfigDiscreteLevels;
import boofcv.struct.pyramid.ImagePyramid;
import boofcv.struct.sfm.PlanePtPixel;
import boofcv.struct.sfm.Stereo2D3D;
import georegression.fitting.se.ModelManagerSe2_F64;
import georegression.fitting.se.ModelManagerSe3_F64;
import georegression.struct.se.Se2_F64;
import georegression.struct.se.Se3_F64;
import org.ddogleg.fitting.modelset.ransac.Ransac;
import org.jetbrains.annotations.Nullable;
/**
* Factory for creating visual odometry algorithms.
*
* @author Peter Abeles
*/
@SuppressWarnings({"unchecked", "rawtypes"})
public class FactoryVisualOdometry {
/**
* Creates monocular visual odometry which relies on the ground being a flat plane
*/
public static >
MonocularPlaneVisualOdometry monoPlaneInfinity( @Nullable ConfigPlanarTrackPnP config, Class imageType ) {
if (config == null)
config = new ConfigPlanarTrackPnP();
PointTracker tracker = FactoryPointTracker.tracker(config.tracker, imageType, null);
//squared pixel error
double ransacTOL = config.ransac.inlierThreshold*config.ransac.inlierThreshold;
var manager = new ModelManagerSe2_F64();
var distance = new DistancePlane2DToPixelSq();
var generator = new GenerateSe2_PlanePtPixel();
Ransac motion = FactoryMultiViewRobust.
createRansac(config.ransac, ransacTOL, manager, PlanePtPixel.class);
motion.setModel(generator::newConcurrent, distance::newConcurrent);
VisOdomMonoPlaneInfinity alg = new VisOdomMonoPlaneInfinity<>(
config.thresholdAdd, config.thresholdRetire, config.ransac.inlierThreshold, motion, tracker);
return new MonoPlaneInfinity_to_MonocularPlaneVisualOdometry<>(alg, distance, generator,
ImageType.single(imageType));
}
/**
* Monocular plane based visual odometry algorithm which creates a synthetic overhead view and tracks image
* features inside this synthetic view.
*
* @param cellSize (Overhead) size of ground cells in overhead image in world units
* @param maxCellsPerPixel (Overhead) Specifies the minimum resolution. Higher values allow lower resolutions.
* Try 20
* @param mapHeightFraction (Overhead) Truncates the overhead view. Must be from 0 to 1.0. 1.0 includes
* the entire image.
* @param inlierGroundTol (RANSAC) RANSAC tolerance in overhead image pixels
* @param ransacIterations (RANSAC) Number of iterations used when estimating motion
* @param thresholdRetire (2D Motion) Drop tracks if they are not in inliers set for this many turns.
* @param absoluteMinimumTracks (2D Motion) Spawn tracks if the number of inliers drops below the specified number
* @param respawnTrackFraction (2D Motion) Spawn tracks if the number of tracks has dropped below this fraction of the
* original number
* @param respawnCoverageFraction (2D Motion) Spawn tracks if the total coverage drops below this relative fraction
* @param tracker Image feature tracker
* @param imageType Type of image being processed
* @return MonocularPlaneVisualOdometry
* @see VisOdomMonoOverheadMotion2D
*/
public static >
MonocularPlaneVisualOdometry monoPlaneOverhead( double cellSize,
double maxCellsPerPixel,
double mapHeightFraction,
double inlierGroundTol,
int ransacIterations,
int thresholdRetire,
int absoluteMinimumTracks,
double respawnTrackFraction,
double respawnCoverageFraction,
PointTracker tracker,
ImageType imageType ) {
ImageMotion2D motion2D = FactoryMotion2D.createMotion2D(
ransacIterations, inlierGroundTol*inlierGroundTol, thresholdRetire,
absoluteMinimumTracks, respawnTrackFraction, respawnCoverageFraction, false, tracker, new Se2_F64());
VisOdomMonoOverheadMotion2D alg =
new VisOdomMonoOverheadMotion2D<>(cellSize, maxCellsPerPixel, mapHeightFraction, motion2D, imageType);
return new MonoOverhead_to_MonocularPlaneVisualOdometry<>(alg, imageType);
}
/**
* Stereo vision based visual odometry algorithm which runs a sparse feature tracker in the left camera and
* estimates the range of tracks once when first detected using disparity between left and right cameras.
*
* @return StereoVisualOdometry
* @see VisOdomMonoDepthPnP
*/
public static >
StereoVisualOdometry stereoMonoPnP( @Nullable ConfigStereoMonoTrackPnP config, Class imageType ) {
if (config == null)
config = new ConfigStereoMonoTrackPnP();
PointTracker tracker = FactoryPointTracker.tracker(config.tracker, imageType, null);
StereoDisparitySparse disparity = FactoryStereoDisparity.sparseRectifiedBM(config.disparity, imageType);
return stereoMonoPnP(config.scene, disparity, tracker, imageType);
}
/**
* Stereo vision based visual odometry algorithm which runs a sparse feature tracker in the left camera and
* estimates the range of tracks once when first detected using disparity between left and right cameras.
*
* @param configVO Configuration for visual odometry
* @param sparseDisparity Estimates the 3D location of features
* @param tracker Image point feature tracker.
* @param imageType Type of image being processed.
* @return StereoVisualOdometry
* @see VisOdomMonoDepthPnP
*/
public static >
StereoVisualOdometry stereoMonoPnP( @Nullable ConfigVisOdomTrackPnP configVO,
StereoDisparitySparse sparseDisparity,
PointTracker tracker,
Class imageType ) {
if (configVO == null)
configVO = new ConfigVisOdomTrackPnP();
final ConfigVisOdomTrackPnP _configVO = configVO;
var distance = new PnPDistanceReprojectionSq();
var manager = new ModelManagerSe3_F64();
// Need to square the error RANSAC inliers
double ransacTOL = configVO.ransac.inlierThreshold*configVO.ransac.inlierThreshold;
Ransac motion = FactoryMultiViewRobust.
createRansac(configVO.ransac, ransacTOL, manager, Point2D3D.class);
motion.setModel(() -> {
Estimate1ofPnP estimator = FactoryMultiView.pnp_1(_configVO.pnp, -1, 1);
return new EstimatorToGenerator<>(estimator);
}
, distance::newConcurrentChild);
RefinePnP refine = null;
if (configVO.refineIterations > 0) {
refine = FactoryMultiView.pnpRefine(1e-12, configVO.refineIterations);
}
VisOdomKeyFrameManager keyframe = switch (configVO.keyframes.type) {
case MAX_GEO -> new MaxGeoKeyFrameManager(configVO.keyframes.geoMinCoverage);
case TICK_TOCK -> new TickTockKeyFrameManager(configVO.keyframes.tickPeriod);
};
// Range from sparse disparity
var pixelTo3D = new StereoSparse3D<>(sparseDisparity, imageType);
VisOdomMonoDepthPnP alg = new VisOdomMonoDepthPnP<>(motion, pixelTo3D, refine, tracker);
alg.getBundleViso().bundle.setSba(FactoryMultiView.bundleSparseMetric(configVO.bundle));
alg.getBundleViso().bundle.configConverge.setTo(configVO.bundleConverge);
alg.setFrameManager(keyframe);
alg.setThresholdRetireTracks(configVO.dropOutlierTracks);
alg.getBundleViso().getSelectTracks().maxFeaturesPerFrame = configVO.bundleMaxFeaturesPerFrame;
alg.getBundleViso().getSelectTracks().minTrackObservations = configVO.bundleMinObservations;
return new WrapVisOdomMonoStereoDepthPnP<>(alg, pixelTo3D, distance, imageType);
}
public static , Depth extends ImageGray>
DepthVisualOdometry rgbDepthPnP( ConfigRgbDepthTrackPnP config,
Class visualType, Class depthType ) {
PointTracker tracker = FactoryPointTracker.tracker(config.tracker, visualType, null);
DepthSparse3D sparseDepth;
ImageType depthInfo = ImageType.single(depthType);
if (depthInfo.getDataType().isInteger()) {
sparseDepth = (DepthSparse3D)new DepthSparse3D.I(config.depthScale);
} else {
sparseDepth = (DepthSparse3D)new DepthSparse3D.F32(config.depthScale);
}
return rgbDepthPnP(config.scene, sparseDepth, tracker, visualType, depthType);
}
public static , Depth extends ImageGray>
DepthVisualOdometry rgbDepthPnP( ConfigVisOdomTrackPnP configVO,
DepthSparse3D sparseDepth,
PointTracker tracker,
Class visualType, Class depthType ) {
// Range from sparse disparity
ImagePixelTo3D pixelTo3D = new DepthSparse3D_to_PixelTo3D<>(sparseDepth);
var distance = new PnPDistanceReprojectionSq();
var manager = new ModelManagerSe3_F64();
// 1/2 a pixel tolerance for RANSAC inliers
double ransacTOL = configVO.ransac.inlierThreshold*configVO.ransac.inlierThreshold;
Ransac motion = FactoryMultiViewRobust.
createRansac(configVO.ransac, ransacTOL, manager, Point2D3D.class);
motion.setModel(() -> {
Estimate1ofPnP estimator = FactoryMultiView.pnp_1(configVO.pnp, -1, 1);
return new EstimatorToGenerator<>(estimator);
}, distance::newConcurrentChild);
RefinePnP refine = null;
if (configVO.refineIterations > 0) {
refine = FactoryMultiView.pnpRefine(1e-12, configVO.refineIterations);
}
VisOdomKeyFrameManager keyframe = switch (configVO.keyframes.type) {
case MAX_GEO -> new MaxGeoKeyFrameManager(configVO.keyframes.geoMinCoverage);
case TICK_TOCK -> new TickTockKeyFrameManager(configVO.keyframes.tickPeriod);
};
VisOdomMonoDepthPnP alg = new VisOdomMonoDepthPnP<>(motion, pixelTo3D, refine, tracker);
alg.getBundleViso().bundle.setSba(FactoryMultiView.bundleSparseMetric(configVO.bundle));
alg.getBundleViso().bundle.configConverge.setTo(configVO.bundleConverge);
alg.setFrameManager(keyframe);
alg.setThresholdRetireTracks(configVO.dropOutlierTracks);
alg.getBundleViso().getSelectTracks().maxFeaturesPerFrame = configVO.bundleMaxFeaturesPerFrame;
alg.getBundleViso().getSelectTracks().minTrackObservations = configVO.bundleMinObservations;
return new VisOdomPixelDepthPnP_to_DepthVisualOdometry<>
(sparseDepth, alg, distance, ImageType.single(visualType), depthType);
}
/**
* Creates an instance of {@link VisOdomDualTrackPnP}.
*
* @param configVO Configuration
* @param imageType Type of input image
* @return The new instance
*/
public static >
StereoVisualOdometry stereoDualTrackerPnP( @Nullable ConfigStereoDualTrackPnP configVO, Class imageType ) {
if (configVO == null)
configVO = new ConfigStereoDualTrackPnP();
configVO.checkValidity();
PointTracker trackerLeft = FactoryPointTracker.tracker(configVO.tracker, imageType, null);
PointTracker trackerRight = FactoryPointTracker.tracker(configVO.tracker, imageType, null);
return stereoDualTrackerPnP(configVO.scene, trackerLeft, trackerRight, configVO, imageType);
}
public static , Desc extends TupleDesc>
StereoVisualOdometry stereoDualTrackerPnP( ConfigVisOdomTrackPnP configVO,
PointTracker trackerLeft,
PointTracker trackerRight,
ConfigStereoDualTrackPnP hack,
Class imageType ) {
if (configVO == null)
configVO = new ConfigVisOdomTrackPnP();
configVO.checkValidity();
// Pixel tolerance for RANSAC inliers - euclidean error squared from left + right images
double ransacTOL = 2*configVO.ransac.inlierThreshold*configVO.ransac.inlierThreshold;
// Each of these data structures is common to all threads OR contains common internal elements
var sharedLeftToRight = new Se3_F64();
var distanceLeft = new PnPDistanceReprojectionSq();
var distanceRight = new PnPDistanceReprojectionSq();
var distanceStereo = new PnPStereoDistanceReprojectionSq();
Ransac motion = FactoryMultiViewRobust.
createRansac(configVO.ransac, ransacTOL, new ModelManagerSe3_F64(), Stereo2D3D.class);
ConfigVisOdomTrackPnP _configVO = configVO;
motion.setModel(() -> {
EstimateNofPnP pnp = FactoryMultiView.pnp_N(_configVO.pnp, -1);
var pnpStereo = new PnPStereoEstimator(pnp,
distanceLeft.newConcurrentChild(),
distanceRight.newConcurrentChild(), 0);
pnpStereo.setLeftToRightReference(sharedLeftToRight);
return new EstimatorToGenerator<>(pnpStereo);
}, distanceStereo::newConcurrentChild);
RefinePnPStereo refinePnP = null;
if (configVO.refineIterations > 0) {
refinePnP = new PnPStereoRefineRodrigues(1e-12, configVO.refineIterations);
}
Triangulate2ViewsMetric triangulate2 = FactoryMultiView.triangulate2ViewMetric(
new ConfigTriangulation(ConfigTriangulation.Type.GEOMETRIC));
VisOdomKeyFrameManager keyframe = switch (configVO.keyframes.type) {
case MAX_GEO -> new MaxGeoKeyFrameManager(configVO.keyframes.geoMinCoverage);
case TICK_TOCK -> new TickTockKeyFrameManager(configVO.keyframes.tickPeriod);
};
DescribePointRadiusAngle descriptor = FactoryDescribePointRadiusAngle.
generic(hack.stereoDescribe, ImageType.single(imageType));
Class descType = descriptor.getDescriptionType();
ScoreAssociation scorer = FactoryAssociation.defaultScore(descType);
AssociateStereo2D associateL2R = new AssociateStereo2D<>(scorer, hack.epipolarTol);
// need to make sure associations are unique
AssociateDescription2D associateUnique = FactoryAssociation.ensureUnique(associateL2R);
if (!associateL2R.uniqueDestination() || !associateL2R.uniqueSource()) {
associateUnique = new EnforceUniqueByScore.Describe2D<>(associateL2R, true, true);
}
VisOdomDualTrackPnP alg = new VisOdomDualTrackPnP<>(
hack.epipolarTol, trackerLeft, trackerRight, descriptor, associateUnique, triangulate2,
motion, refinePnP);
alg.getBundleViso().bundle.setSba(FactoryMultiView.bundleSparseMetric(configVO.bundle));
alg.getBundleViso().bundle.configConverge.setTo(configVO.bundleConverge);
alg.setDescribeRadius(hack.stereoRadius);
alg.setFrameManager(keyframe);
alg.setThresholdRetireTracks(configVO.dropOutlierTracks);
alg.getBundleViso().getSelectTracks().maxFeaturesPerFrame = configVO.bundleMaxFeaturesPerFrame;
alg.getBundleViso().getSelectTracks().minTrackObservations = configVO.bundleMinObservations;
return new WrapVisOdomDualTrackPnP<>(alg, sharedLeftToRight, distanceLeft, distanceRight, distanceStereo,
associateL2R, refinePnP, imageType);
}
/**
* Creates a stereo visual odometry algorithm that uses the two most recent frames (4 images total) to estimate
* motion.
*
* @see VisOdomStereoQuadPnP
*/
public static , Desc extends TupleDesc>
StereoVisualOdometry stereoQuadPnP( ConfigStereoQuadPnP config, Class imageType ) {
// Pixel tolerance for RANSAC inliers - euclidean error squared from left + right images
double ransacTOL = 2*config.ransac.inlierThreshold*config.ransac.inlierThreshold;
Ransac motion = FactoryMultiViewRobust.
createRansac(config.ransac, ransacTOL, new ModelManagerSe3_F64(), Stereo2D3D.class);
// Each of these data structures is common to all threads OR contains common internal elements
var sharedLeftToRight = new Se3_F64();
var distanceLeft = new PnPDistanceReprojectionSq();
var distanceRight = new PnPDistanceReprojectionSq();
var distanceStereo = new PnPStereoDistanceReprojectionSq();
// Creates new models, but careful to make sure everything is thread safe and that common priors are
// referenced by each instance.
motion.setModel(() -> {
EstimateNofPnP pnp = FactoryMultiView.pnp_N(config.pnp, -1);
var pnpStereo = new PnPStereoEstimator(pnp,
distanceLeft.newConcurrentChild(),
distanceRight.newConcurrentChild(), 0);
pnpStereo.setLeftToRightReference(sharedLeftToRight);
return new EstimatorToGenerator<>(pnpStereo);
}, distanceStereo::newConcurrentChild);
RefinePnPStereo refinePnP = null;
if (config.refineIterations > 0) {
refinePnP = new PnPStereoRefineRodrigues(1e-12, config.refineIterations);
}
DetectDescribePoint detector = FactoryDetectDescribe.generic(config.detectDescribe, imageType);
Class descType = detector.getDescriptionType();
// need to make sure associations are unique
ScoreAssociation scorer = FactoryAssociation.defaultScore(descType);
AssociateStereo2D associateL2R = new AssociateStereo2D<>(scorer, config.epipolarTol);
associateL2R.setMaxScoreThreshold(config.associateL2R.maxErrorThreshold);
AssociateDescription2D associateF2F = FactoryAssociation.generic2(config.associateF2F, detector);
Triangulate2ViewsMetric triangulate = FactoryMultiView.triangulate2ViewMetric(
new ConfigTriangulation(ConfigTriangulation.Type.GEOMETRIC));
VisOdomStereoQuadPnP alg = new VisOdomStereoQuadPnP<>(
detector, associateF2F, associateL2R, triangulate, motion, refinePnP);
alg.getBundle().sba = FactoryMultiView.bundleSparseMetric(config.bundle);
alg.getBundle().configConverge.setTo(config.bundleConverge);
return new WrapVisOdomQuadPnP<>(alg, refinePnP, associateL2R,
distanceStereo, distanceLeft, distanceRight, imageType);
}
/**
* Wraps around a {@link StereoVisualOdometry} instance and will rescale the input images and adjust the cameras
* intrinsic parameters automatically. Rescaling input images is often an easy way to improve runtime performance
* with a minimal hit on pose accuracy.
*
* @param vo Visual odometry algorithm which is being wrapped
* @param scaleFactor Scale factor that the image should be reduced by, Try 0.5 for half size.
* @param Image type
* @return StereoVisualOdometry
*/
public static > StereoVisualOdometry scaleInput( StereoVisualOdometry vo, double scaleFactor ) {
return new StereoVisualOdometryScaleInput<>(vo, scaleFactor);
}
/**
* Wraps around a {@link MonocularPlaneVisualOdometry} instance and will rescale the input images and adjust the cameras
* intrinsic parameters automatically. Rescaling input images is often an easy way to improve runtime performance
* with a minimal hit on pose accuracy.
*
* @param vo Visual odometry algorithm which is being wrapped
* @param scaleFactor Scale factor that the image should be reduced by, Try 0.5 for half size.
* @param Image type
* @return StereoVisualOdometry
*/
public static > MonocularPlaneVisualOdometry scaleInput( MonocularPlaneVisualOdometry vo, double scaleFactor ) {
return new MonocularPlaneVisualOdometryScaleInput<>(vo, scaleFactor);
}
public static , Depth extends ImageGray>
DepthVisualOdometry, Depth> depthDirect( DepthSparse3D sparse3D,
ImageType> visualType, Class depthType ) {
ImagePyramid> pyramid = FactoryPyramid.discreteGaussian(
ConfigDiscreteLevels.levels(3),
-1, 2, false, visualType);
PyramidDirectColorDepth alg = new PyramidDirectColorDepth<>(pyramid);
return new PyramidDirectColorDepth_to_DepthVisualOdometry<>(sparse3D, alg, depthType);
}
}
© 2015 - 2025 Weber Informatics LLC | Privacy Policy