In recent years, reconstructing a sparse map from a simultaneous localization and mapping(SLAM) system on a conventional CPU has undergone remarkable progress. However,obtaining a dense map from the system often requi...In recent years, reconstructing a sparse map from a simultaneous localization and mapping(SLAM) system on a conventional CPU has undergone remarkable progress. However,obtaining a dense map from the system often requires a highperformance GPU to accelerate computation. This paper proposes a dense mapping approach which can remove outliers and obtain a clean 3D model using a CPU in real-time. The dense mapping approach processes keyframes and establishes data association by using multi-threading technology. The outliers are removed by changing detections of associated vertices between keyframes. The implicit surface data of inliers is represented by a truncated signed distance function and fused with an adaptive weight. A global hash table and a local hash table are used to store and retrieve surface data for data-reuse. Experiment results show that the proposed approach can precisely remove the outliers in scene and obtain a dense 3D map with a better visual effect in real-time.展开更多
At present,simultaneous localization and mapping(SLAM) for an autonomous underwater vehicle(AUV)is a research hotspot.Aiming at the problem of non-linear model and non-Gaussian noise in AUV motion,an improved method o...At present,simultaneous localization and mapping(SLAM) for an autonomous underwater vehicle(AUV)is a research hotspot.Aiming at the problem of non-linear model and non-Gaussian noise in AUV motion,an improved method of variance reduction fast simultaneous localization and mapping(FastSLAM) with simulated annealing is proposed to solve the problems of particle degradation,particle depletion and particle loss in traditional FastSLAM,which lead to the reduction of AUV location estimation accuracy.The adaptive exponential fading factor is generated by the anneal function of simulated annealing algorithm to improve the effective particle number and replace resampling.By increasing the weight of small particles and decreasing the weight of large particles,the variance of particle weight can be reduced,the number of effective particles can be increased,and the accuracy of AUV location and feature location estimation can be improved to some extent by retaining more information carried by particles.The experimental results based on trial data show that the proposed simulated annealing variance reduction FastSLAM method avoids particle degradation,maintains the diversity of particles,weakened the degeneracy and improves the accuracy and stability of AUV navigation and localization system.展开更多
Simultaneous localization and mapping (SLAM) is a key technology for mobile robots operating under unknown environment. While FastSLAM algorithm is a popular solution to the SLAM problem, it suffers from two major d...Simultaneous localization and mapping (SLAM) is a key technology for mobile robots operating under unknown environment. While FastSLAM algorithm is a popular solution to the SLAM problem, it suffers from two major drawbacks: one is particle set degeneracy due to lack of observation information in proposal distribution design of the particle filter; the other is errors accumulation caused by linearization of the nonlinear robot motion model and the nonlinear environment observation model. For the purpose of overcoming the above problems, a new iterated sigma point FastSLAM (ISP-FastSLAM) algorithm is proposed. The main contribution of the algorithm lies in the utilization of iterated sigma point Kalman filter (ISPKF), which minimizes statistical linearization error through Gaussian-Newton iteration, to design an optimal proposal distribution of the particle filter and to estimate the environment landmarks. On the basis of Rao-Blackwellized particle filter, the proposed ISP-FastSLAM algorithm is comprised by two main parts: in the first part, an iterated sigma point particle filter (ISPPF) to localize the robot is proposed, in which the proposal distribution is accurately estimated by the ISPKF; in the second part, a set of ISPKFs is used to estimate the environment landmarks. The simulation test of the proposed ISP-FastSLAM algorithm compared with FastSLAM2.0 algorithm and Unscented FastSLAM algorithm is carried out, and the performances of the three algorithms are compared. The simulation and comparing results show that the proposed ISP-FastSLAM outperforms other two algorithms both in accuracy and in robustness. The proposed algorithm provides reference for the optimization research of FastSLAM algorithm.展开更多
ORB-SLAM3(simultaneous localization and mapping)是当前最优秀的视觉SLAM算法之一,然而其基于静态环境的假设导致算法在高动态环境下精度不佳甚至定位失败。针对这一问题,提出一种结合光流和实例分割的动态特征点去除方法,以提高ORB-...ORB-SLAM3(simultaneous localization and mapping)是当前最优秀的视觉SLAM算法之一,然而其基于静态环境的假设导致算法在高动态环境下精度不佳甚至定位失败。针对这一问题,提出一种结合光流和实例分割的动态特征点去除方法,以提高ORB-SLAM3在高动态环境下的定位精度。并且在TUM数据集上进行了RGB-D相机模式和单目相机模式的实验,实验结果表明了该方法的有效性。展开更多
Simultaneous localization and mapping(SLAM)has been applied across a wide range of areas from robotics to automatic pilot.Most of the SLAM algorithms are based on the assumption that the noise is timeinvariant Gaussia...Simultaneous localization and mapping(SLAM)has been applied across a wide range of areas from robotics to automatic pilot.Most of the SLAM algorithms are based on the assumption that the noise is timeinvariant Gaussian distribution.In some cases,this assumption no longer holds and the performance of the traditional SLAM algorithms declines.In this paper,we present a robust SLAM algorithm based on variational Bayes method by modelling the observation noise as inverse-Wishart distribution with "harmonic mean".Besides,cubature integration is utilized to solve the problem of nonlinear system.The proposed algorithm can effectively solve the problem of filtering divergence for traditional filtering algorithm when suffering the time-variant observation noise,especially for heavy-tai led noise.To validate the algorithm,we compare it with other t raditional filtering algorithms.The results show the effectiveness of the algorithm.展开更多
A novel mobile robot simultaneous localization and mapping (SLAM) method is implemented by using the Rao- Blackwellized particle filter (RBPF) for monocular vision-based autonomous robot in unknown indoor environment....A novel mobile robot simultaneous localization and mapping (SLAM) method is implemented by using the Rao- Blackwellized particle filter (RBPF) for monocular vision-based autonomous robot in unknown indoor environment. The particle filter combined with unscented Kalman filter (UKF) for extending the path posterior by sampling new poses integrating the current observation. Landmark position estimation and update is implemented through UKF. Furthermore, the number of resampling steps is determined adaptively, which greatly reduces the particle depletion problem. Monocular CCD camera mounted on the robot tracks the 3D natural point landmarks structured with matching image feature pairs extracted through Scale Invariant Feature Transform (SIFT). The matching for multi-dimension SIFT features which are highly distinctive due to a special descriptor is implemented with a KD-Tree. Experiments on the robot Pioneer3 showed that our method is very precise and stable.展开更多
FastSLAM is a popular framework which uses a Rao-Blackwellized particle filter to solve the simultaneous localization and mapping problem(SLAM). However, in this framework there are two important potential limitatio...FastSLAM is a popular framework which uses a Rao-Blackwellized particle filter to solve the simultaneous localization and mapping problem(SLAM). However, in this framework there are two important potential limitations, the particle depletion problem and the linear approximations of the nonlinear functions. To overcome these two drawbacks, this paper proposes a new FastSLAM algorithm based on revised genetic resampling and square root unscented particle filter(SR-UPF). Double roulette wheels as the selection operator, and fast Metropolis-Hastings(MH) as the mutation operator and traditional crossover are combined to form a new resampling method. Amending the particle degeneracy and keeping the particle diversity are both taken into considerations in this method. As SR-UPF propagates the sigma points through the true nonlinearity, it decreases the linearization errors. By directly transferring the square root of the state covariance matrix, SR-UPF has better numerical stability. Both simulation and experimental results demonstrate that the proposed algorithm can improve the diversity of particles, and perform well on estimation accuracy and consistency.展开更多
This article proposes a simultaneous localization and mapping(SLAM) version with continuous probabilistic mapping(CPSLAM), i.e., an algorithm of simultaneous localization and mapping that avoids the use of grids, and ...This article proposes a simultaneous localization and mapping(SLAM) version with continuous probabilistic mapping(CPSLAM), i.e., an algorithm of simultaneous localization and mapping that avoids the use of grids, and thus, does not require a discretized environment. A Markov random field(MRF) is considered to model this SLAM version with high spatial resolution maps. The mapping methodology is based on a point cloud generated by successive observations of the environment, which is kept bounded and representative by including a novel recursive subsampling method. The CP-SLAM problem is solved via iterated conditional modes(ICM), which is a classic algorithm with theoretical convergence over any MRF. The probabilistic maps are the most appropriate to represent dynamic environments, and can be easily implemented in other versions of the SLAM problem, such as the multi-robot version. Simulations and real experiments show the flexibility and excellent performance of this proposal.展开更多
A method of underwater simultaneous localization and mapping(SLAM)based on on-board looking forward sonar is proposed.The real-time data flow is obtained to form the underwater acoustic images and these images are pre...A method of underwater simultaneous localization and mapping(SLAM)based on on-board looking forward sonar is proposed.The real-time data flow is obtained to form the underwater acoustic images and these images are pre-processed and positions of objects are extracted for SLAM.Extended Kalman filter(EKF)is selected as the kernel approach to enable the underwater vehicle to construct a feature map,and the EKF can locate the underwater vehicle through the map.In order to improve the association effciency,a novel association method based on ant colony algorithm is introduced.Results obtained on simulation data and real acoustic vision data in tank are displayed and discussed.The proposed method maintains better association effciency and reduces navigation error,and is effective and feasible.展开更多
In order to meet the application requirements of autonomous vehicles, this paper proposes a simultaneous localization and mapping (SLAM) algorithm, which uses a VoxelGrid filter to down sample the point cloud data, ...In order to meet the application requirements of autonomous vehicles, this paper proposes a simultaneous localization and mapping (SLAM) algorithm, which uses a VoxelGrid filter to down sample the point cloud data, with the combination of iterative closest points (ICP) algorithm and Gaussian model for particles updating, the matching between the local map and the global map to quantify particles' importance weight. The crude estimation by using ICP algorithm can find the high probability area of autonomous vehicles' poses, which would decrease particle numbers, increase algorithm speed and restrain particles' impoverishment. The calculation of particles' importance weight based on matching of attribute between grid maps is simple and practicable. Experiments carried out with the autonomous vehicle platform validate the effectiveness of our approaches.展开更多
在ORB-SLAM(oriented fast and rotated brief-simultaneous localization and mapping)框架的基础上,采用半直接视觉里程计(semi-direct visual odometry,SVO)法和稠密直接法替代特征点法,并利用慕尼黑工业大学SLAM数据集进行测试和对...在ORB-SLAM(oriented fast and rotated brief-simultaneous localization and mapping)框架的基础上,采用半直接视觉里程计(semi-direct visual odometry,SVO)法和稠密直接法替代特征点法,并利用慕尼黑工业大学SLAM数据集进行测试和对比。结果表明,SVO和ORB-SLAM在单目模式下的平均解算时间分别为31.1 ms、20.5 ms,RGB-D模式下的平均解算时间分别为39.5 ms、32.5 ms。某些条件下SVO解算的轨迹精度可以达到甚至高于ORB-SLAM。展开更多
This paper describes a brain-inspired simultaneous localization and mapping (SLAM) system using oriented features from accelerated segment test and rotated binary robust independent elementary (ORB) features of R...This paper describes a brain-inspired simultaneous localization and mapping (SLAM) system using oriented features from accelerated segment test and rotated binary robust independent elementary (ORB) features of RGB (red, green, blue) sensor for a mobile robot. The core SLAM system, dubbed RatSLAM, can construct a cognitive map using information of raw odometry and visual scenes in the path traveled. Different from existing RatSLAM system which only uses a simple vector to represent features of visual image, in this paper, we employ an efficient and very fast descriptor method, called ORB, to extract features from RCB images. Experiments show that these features are suitable to recognize the sequences of familiar visual scenes. Thus, while loop closure errors are detected, the descriptive features will help to modify the pose estimation by driving loop closure and localization in a map correction algorithm. Efficiency and robustness of our method are also demonstrated by comparing with different visual processing algorithms.展开更多
Mobile robot systems performing simultaneous localization and mapping(SLAM) are generally plagued by non-Gaussian noise.To improve both accuracy and robustness under non-Gaussian measurement noise,a robust SLAM algori...Mobile robot systems performing simultaneous localization and mapping(SLAM) are generally plagued by non-Gaussian noise.To improve both accuracy and robustness under non-Gaussian measurement noise,a robust SLAM algorithm is proposed.It is based on the square-root cubature Kalman filter equipped with a Huber' s generalized maximum likelihood estimator(GM-estimator).In particular,the square-root cubature rule is applied to propagate the robot state vector and covariance matrix in the time update,the measurement update and the new landmark initialization stages of the SLAM.Moreover,gain weight matrices with respect to the measurement residuals are calculated by utilizing Huber' s technique in the measurement update step.The measurement outliers are suppressed by lower Kalman gains as merging into the system.The proposed algorithm can achieve better performance under the condition of non-Gaussian measurement noise in comparison with benchmark algorithms.The simulation results demonstrate the advantages of the proposed SLAM algorithm.展开更多
This paper addresses a sensor-based simultaneous localization and mapping (SLAM) algorithm for camera tracking in a virtual studio environment. The traditional camera tracking methods in virtual studios are vision-b...This paper addresses a sensor-based simultaneous localization and mapping (SLAM) algorithm for camera tracking in a virtual studio environment. The traditional camera tracking methods in virtual studios are vision-based or sensor-based. However, the chroma keying process in virtual studios requires color cues, such as blue background, to segment foreground objects to be inserted into images and videos. Chroma keying limits the application of vision-based tracking methods in virtual studios since the background cannot provide enough feature information. Furthermore, the conventional sensor-based tracking approaches suffer from the jitter, drift or expensive computation due to the characteristics of individual sensor system. Therefore, the SLAM techniques from the mobile robot area are first investigated and adapted to the camera tracking area. Then, a sensor-based SLAM extension algorithm for two dimensional (2D) camera tracking in virtual studio is described. Also, a technique called map adjustment is proposed to increase the accuracy' and efficiency of the algorithm. The feasibility and robustness of the algorithm is shown by experiments. The simulation results demonstrate that the sensor-based SLAM algorithm can satisfy the fundamental 2D camera tracking requirement in virtual studio environment.展开更多
A new method for speeding up the state augment operations involved in the compressed extended Kalman filter-based simultaneous localization and mapping (CEKF-SLAM) algorithm was proposed. State augment usually requi...A new method for speeding up the state augment operations involved in the compressed extended Kalman filter-based simultaneous localization and mapping (CEKF-SLAM) algorithm was proposed. State augment usually requires a fully-updated state eovariance so as to append the information of newly observed landmarks, thus computational volume increases quadratically with the number of landmarks in the whole map. It was proved that state augment can also be achieved by augmenting just one auxiliary coefficient ma- trix. This method can yield identical estimation results as those using EKF-SLAM algorithm, and computa- tional amount grows only linearly with number of increased landmarks in the local map. The efficiency of this quick state augment for CEKF-SLAM algorithm has been validated by a sophisticated simulation project.展开更多
To tackle the problem of simultaneous localization and mapping(SLAM) in dynamic environments, a novel algorithm using landscape theory of aggregation is presented. By exploiting the coherent explanation how actors for...To tackle the problem of simultaneous localization and mapping(SLAM) in dynamic environments, a novel algorithm using landscape theory of aggregation is presented. By exploiting the coherent explanation how actors form alignments in a game provided by the landscape theory of aggregation, the algorithm is able to explicitly deal with the ever-changing relationship between the static objects and the moving objects without any prior models of the moving objects. The effectiveness of the method has been validated by experiments in two representative dynamic environments: the campus road and the urban road.展开更多
In recent years, there have been a lot of interests in incorporating semantics into simultaneous localization and mapping (SLAM) systems. This paper presents an approach to generate an outdoor large-scale 3D dense s...In recent years, there have been a lot of interests in incorporating semantics into simultaneous localization and mapping (SLAM) systems. This paper presents an approach to generate an outdoor large-scale 3D dense semantic map based on binocular stereo vision. The inputs to system are stereo color images from a moving vehicle. First, dense 3D space around the vehicle is constructed, and tile motion of camera is estimated by visual odometry. Meanwhile, semantic segmentation is performed through the deep learning technology online, and the semantic labels are also used to verify tim feature matching in visual odometry. These three processes calculate the motion, depth and semantic label of every pixel in the input views. Then, a voxel conditional random field (CRF) inference is introduced to fuse semantic labels to voxel. After that, we present a method to remove the moving objects by incorporating the semantic labels, which improves the motion segmentation accuracy. The last is to generate tile dense 3D semantic map of an urban environment from arbitrary long image sequence. We evaluate our approach on KITTI vision benchmark, and the results show that the proposed method is effective.展开更多
This paper presents a hierarchical simultaneous localization and mapping(SLAM) system for a small unmanned aerial vehicle(UAV) using the output of an inertial measurement unit(IMU) and the bearing-only observati...This paper presents a hierarchical simultaneous localization and mapping(SLAM) system for a small unmanned aerial vehicle(UAV) using the output of an inertial measurement unit(IMU) and the bearing-only observations from an onboard monocular camera.A homography based approach is used to calculate the motion of the vehicle in 6 degrees of freedom by image feature match.This visual measurement is fused with the inertial outputs by an indirect extended Kalman filter(EKF) for attitude and velocity estimation.Then,another EKF is employed to estimate the position of the vehicle and the locations of the features in the map.Both simulations and experiments are carried out to test the performance of the proposed system.The result of the comparison with the referential global positioning system/inertial navigation system(GPS/INS) navigation indicates that the proposed SLAM can provide reliable and stable state estimation for small UAVs in GPS-denied environments.展开更多
A method of underwater simultaneous localization and mapping (SLAM) based on forward-looking sonar was proposed in this paper. Positions of objects were obtained by the forward-looking sonar, and an improved associa...A method of underwater simultaneous localization and mapping (SLAM) based on forward-looking sonar was proposed in this paper. Positions of objects were obtained by the forward-looking sonar, and an improved association method based on an ant colony algorithm was introduced to estimate the positions. In order to improve the precision of the positions, the extended Kalman filter (EKF) was adopted. The presented algorithm was tested in a tank, and the maximum estimation error of SLAM gained was 0.25 m. The tests verify that this method can maintain better association efficiency and reduce navigatioJ~ error.展开更多
基金supported by the National Natural Science Foundation of China(61473202)。
文摘In recent years, reconstructing a sparse map from a simultaneous localization and mapping(SLAM) system on a conventional CPU has undergone remarkable progress. However,obtaining a dense map from the system often requires a highperformance GPU to accelerate computation. This paper proposes a dense mapping approach which can remove outliers and obtain a clean 3D model using a CPU in real-time. The dense mapping approach processes keyframes and establishes data association by using multi-threading technology. The outliers are removed by changing detections of associated vertices between keyframes. The implicit surface data of inliers is represented by a truncated signed distance function and fused with an adaptive weight. A global hash table and a local hash table are used to store and retrieve surface data for data-reuse. Experiment results show that the proposed approach can precisely remove the outliers in scene and obtain a dense 3D map with a better visual effect in real-time.
基金supported by the National Science Fund of China under Grants 61603034China Postdoctoral Science Foundation under Grant 2019M653870XB+1 种基金Beijing Municipal Natural Science Foundation (3182027)Fundamental Research Funds for the Central Universities,China,FRF-GF-17-B44,and XJS191315
文摘At present,simultaneous localization and mapping(SLAM) for an autonomous underwater vehicle(AUV)is a research hotspot.Aiming at the problem of non-linear model and non-Gaussian noise in AUV motion,an improved method of variance reduction fast simultaneous localization and mapping(FastSLAM) with simulated annealing is proposed to solve the problems of particle degradation,particle depletion and particle loss in traditional FastSLAM,which lead to the reduction of AUV location estimation accuracy.The adaptive exponential fading factor is generated by the anneal function of simulated annealing algorithm to improve the effective particle number and replace resampling.By increasing the weight of small particles and decreasing the weight of large particles,the variance of particle weight can be reduced,the number of effective particles can be increased,and the accuracy of AUV location and feature location estimation can be improved to some extent by retaining more information carried by particles.The experimental results based on trial data show that the proposed simulated annealing variance reduction FastSLAM method avoids particle degradation,maintains the diversity of particles,weakened the degeneracy and improves the accuracy and stability of AUV navigation and localization system.
基金supported by Open Foundation of State Key Laboratory of Robotics and System, China (Grant No. SKLRS-2009-ZD-04)National Natural Science Foundation of China (Grant No. 60909055, Grant No.61005070)Fundamental Research Funds for the Central Universities of China (Grant No. 2009JBZ001-2)
文摘Simultaneous localization and mapping (SLAM) is a key technology for mobile robots operating under unknown environment. While FastSLAM algorithm is a popular solution to the SLAM problem, it suffers from two major drawbacks: one is particle set degeneracy due to lack of observation information in proposal distribution design of the particle filter; the other is errors accumulation caused by linearization of the nonlinear robot motion model and the nonlinear environment observation model. For the purpose of overcoming the above problems, a new iterated sigma point FastSLAM (ISP-FastSLAM) algorithm is proposed. The main contribution of the algorithm lies in the utilization of iterated sigma point Kalman filter (ISPKF), which minimizes statistical linearization error through Gaussian-Newton iteration, to design an optimal proposal distribution of the particle filter and to estimate the environment landmarks. On the basis of Rao-Blackwellized particle filter, the proposed ISP-FastSLAM algorithm is comprised by two main parts: in the first part, an iterated sigma point particle filter (ISPPF) to localize the robot is proposed, in which the proposal distribution is accurately estimated by the ISPKF; in the second part, a set of ISPKFs is used to estimate the environment landmarks. The simulation test of the proposed ISP-FastSLAM algorithm compared with FastSLAM2.0 algorithm and Unscented FastSLAM algorithm is carried out, and the performances of the three algorithms are compared. The simulation and comparing results show that the proposed ISP-FastSLAM outperforms other two algorithms both in accuracy and in robustness. The proposed algorithm provides reference for the optimization research of FastSLAM algorithm.
文摘ORB-SLAM3(simultaneous localization and mapping)是当前最优秀的视觉SLAM算法之一,然而其基于静态环境的假设导致算法在高动态环境下精度不佳甚至定位失败。针对这一问题,提出一种结合光流和实例分割的动态特征点去除方法,以提高ORB-SLAM3在高动态环境下的定位精度。并且在TUM数据集上进行了RGB-D相机模式和单目相机模式的实验,实验结果表明了该方法的有效性。
基金the National Natural Science Foundation of China(No.61803260)。
文摘Simultaneous localization and mapping(SLAM)has been applied across a wide range of areas from robotics to automatic pilot.Most of the SLAM algorithms are based on the assumption that the noise is timeinvariant Gaussian distribution.In some cases,this assumption no longer holds and the performance of the traditional SLAM algorithms declines.In this paper,we present a robust SLAM algorithm based on variational Bayes method by modelling the observation noise as inverse-Wishart distribution with "harmonic mean".Besides,cubature integration is utilized to solve the problem of nonlinear system.The proposed algorithm can effectively solve the problem of filtering divergence for traditional filtering algorithm when suffering the time-variant observation noise,especially for heavy-tai led noise.To validate the algorithm,we compare it with other t raditional filtering algorithms.The results show the effectiveness of the algorithm.
基金Project (No. 2002AA735041) supported by the Hi-Tech Researchand Development Program (863) of China
文摘A novel mobile robot simultaneous localization and mapping (SLAM) method is implemented by using the Rao- Blackwellized particle filter (RBPF) for monocular vision-based autonomous robot in unknown indoor environment. The particle filter combined with unscented Kalman filter (UKF) for extending the path posterior by sampling new poses integrating the current observation. Landmark position estimation and update is implemented through UKF. Furthermore, the number of resampling steps is determined adaptively, which greatly reduces the particle depletion problem. Monocular CCD camera mounted on the robot tracks the 3D natural point landmarks structured with matching image feature pairs extracted through Scale Invariant Feature Transform (SIFT). The matching for multi-dimension SIFT features which are highly distinctive due to a special descriptor is implemented with a KD-Tree. Experiments on the robot Pioneer3 showed that our method is very precise and stable.
基金supported by National Natural Science Foundation of China(No.61101197)Research Fund for the Doctoral Program of Higher Education of China(No.20093219120025)
文摘FastSLAM is a popular framework which uses a Rao-Blackwellized particle filter to solve the simultaneous localization and mapping problem(SLAM). However, in this framework there are two important potential limitations, the particle depletion problem and the linear approximations of the nonlinear functions. To overcome these two drawbacks, this paper proposes a new FastSLAM algorithm based on revised genetic resampling and square root unscented particle filter(SR-UPF). Double roulette wheels as the selection operator, and fast Metropolis-Hastings(MH) as the mutation operator and traditional crossover are combined to form a new resampling method. Amending the particle degeneracy and keeping the particle diversity are both taken into considerations in this method. As SR-UPF propagates the sigma points through the true nonlinearity, it decreases the linearization errors. By directly transferring the square root of the state covariance matrix, SR-UPF has better numerical stability. Both simulation and experimental results demonstrate that the proposed algorithm can improve the diversity of particles, and perform well on estimation accuracy and consistency.
基金Argentinean National Council for Scientific Research (CONICET)the National University of San Juan (UNSJ) of ArgentinaNVIDIA Corporation for their support
文摘This article proposes a simultaneous localization and mapping(SLAM) version with continuous probabilistic mapping(CPSLAM), i.e., an algorithm of simultaneous localization and mapping that avoids the use of grids, and thus, does not require a discretized environment. A Markov random field(MRF) is considered to model this SLAM version with high spatial resolution maps. The mapping methodology is based on a point cloud generated by successive observations of the environment, which is kept bounded and representative by including a novel recursive subsampling method. The CP-SLAM problem is solved via iterated conditional modes(ICM), which is a classic algorithm with theoretical convergence over any MRF. The probabilistic maps are the most appropriate to represent dynamic environments, and can be easily implemented in other versions of the SLAM problem, such as the multi-robot version. Simulations and real experiments show the flexibility and excellent performance of this proposal.
基金the National Natural Science Foundation of China(No.51009040)the Fund of National Defence Key Laboratory of Autonomous Underwater Vehicle Technology(No.2008002)the Scientific Service Special Fund of University in China(No.E091002)
文摘A method of underwater simultaneous localization and mapping(SLAM)based on on-board looking forward sonar is proposed.The real-time data flow is obtained to form the underwater acoustic images and these images are pre-processed and positions of objects are extracted for SLAM.Extended Kalman filter(EKF)is selected as the kernel approach to enable the underwater vehicle to construct a feature map,and the EKF can locate the underwater vehicle through the map.In order to improve the association effciency,a novel association method based on ant colony algorithm is introduced.Results obtained on simulation data and real acoustic vision data in tank are displayed and discussed.The proposed method maintains better association effciency and reduces navigation error,and is effective and feasible.
基金Supported by the Major Research Plan of the National Natural Science Foundation of China(91120003)Surface Project of the National Natural Science Foundation of China(61173076)
文摘In order to meet the application requirements of autonomous vehicles, this paper proposes a simultaneous localization and mapping (SLAM) algorithm, which uses a VoxelGrid filter to down sample the point cloud data, with the combination of iterative closest points (ICP) algorithm and Gaussian model for particles updating, the matching between the local map and the global map to quantify particles' importance weight. The crude estimation by using ICP algorithm can find the high probability area of autonomous vehicles' poses, which would decrease particle numbers, increase algorithm speed and restrain particles' impoverishment. The calculation of particles' importance weight based on matching of attribute between grid maps is simple and practicable. Experiments carried out with the autonomous vehicle platform validate the effectiveness of our approaches.
文摘在ORB-SLAM(oriented fast and rotated brief-simultaneous localization and mapping)框架的基础上,采用半直接视觉里程计(semi-direct visual odometry,SVO)法和稠密直接法替代特征点法,并利用慕尼黑工业大学SLAM数据集进行测试和对比。结果表明,SVO和ORB-SLAM在单目模式下的平均解算时间分别为31.1 ms、20.5 ms,RGB-D模式下的平均解算时间分别为39.5 ms、32.5 ms。某些条件下SVO解算的轨迹精度可以达到甚至高于ORB-SLAM。
基金supported by National Natural Science Foundation of China(No.61673283)
文摘This paper describes a brain-inspired simultaneous localization and mapping (SLAM) system using oriented features from accelerated segment test and rotated binary robust independent elementary (ORB) features of RGB (red, green, blue) sensor for a mobile robot. The core SLAM system, dubbed RatSLAM, can construct a cognitive map using information of raw odometry and visual scenes in the path traveled. Different from existing RatSLAM system which only uses a simple vector to represent features of visual image, in this paper, we employ an efficient and very fast descriptor method, called ORB, to extract features from RCB images. Experiments show that these features are suitable to recognize the sequences of familiar visual scenes. Thus, while loop closure errors are detected, the descriptive features will help to modify the pose estimation by driving loop closure and localization in a map correction algorithm. Efficiency and robustness of our method are also demonstrated by comparing with different visual processing algorithms.
基金Supported by the National High Technology Research and Development Program of China(2010AA09Z104)the Fundamental Research Funds of the Zhejiang University(2014FZA5020)
文摘Mobile robot systems performing simultaneous localization and mapping(SLAM) are generally plagued by non-Gaussian noise.To improve both accuracy and robustness under non-Gaussian measurement noise,a robust SLAM algorithm is proposed.It is based on the square-root cubature Kalman filter equipped with a Huber' s generalized maximum likelihood estimator(GM-estimator).In particular,the square-root cubature rule is applied to propagate the robot state vector and covariance matrix in the time update,the measurement update and the new landmark initialization stages of the SLAM.Moreover,gain weight matrices with respect to the measurement residuals are calculated by utilizing Huber' s technique in the measurement update step.The measurement outliers are suppressed by lower Kalman gains as merging into the system.The proposed algorithm can achieve better performance under the condition of non-Gaussian measurement noise in comparison with benchmark algorithms.The simulation results demonstrate the advantages of the proposed SLAM algorithm.
文摘This paper addresses a sensor-based simultaneous localization and mapping (SLAM) algorithm for camera tracking in a virtual studio environment. The traditional camera tracking methods in virtual studios are vision-based or sensor-based. However, the chroma keying process in virtual studios requires color cues, such as blue background, to segment foreground objects to be inserted into images and videos. Chroma keying limits the application of vision-based tracking methods in virtual studios since the background cannot provide enough feature information. Furthermore, the conventional sensor-based tracking approaches suffer from the jitter, drift or expensive computation due to the characteristics of individual sensor system. Therefore, the SLAM techniques from the mobile robot area are first investigated and adapted to the camera tracking area. Then, a sensor-based SLAM extension algorithm for two dimensional (2D) camera tracking in virtual studio is described. Also, a technique called map adjustment is proposed to increase the accuracy' and efficiency of the algorithm. The feasibility and robustness of the algorithm is shown by experiments. The simulation results demonstrate that the sensor-based SLAM algorithm can satisfy the fundamental 2D camera tracking requirement in virtual studio environment.
基金Sponsored by the Beijing Education Committee Cooperation Building Foundation Project
文摘A new method for speeding up the state augment operations involved in the compressed extended Kalman filter-based simultaneous localization and mapping (CEKF-SLAM) algorithm was proposed. State augment usually requires a fully-updated state eovariance so as to append the information of newly observed landmarks, thus computational volume increases quadratically with the number of landmarks in the whole map. It was proved that state augment can also be achieved by augmenting just one auxiliary coefficient ma- trix. This method can yield identical estimation results as those using EKF-SLAM algorithm, and computa- tional amount grows only linearly with number of increased landmarks in the local map. The efficiency of this quick state augment for CEKF-SLAM algorithm has been validated by a sophisticated simulation project.
基金Project(XK100070532)supported by Beijing Education Committee Cooperation Building Foundation,China
文摘To tackle the problem of simultaneous localization and mapping(SLAM) in dynamic environments, a novel algorithm using landscape theory of aggregation is presented. By exploiting the coherent explanation how actors form alignments in a game provided by the landscape theory of aggregation, the algorithm is able to explicitly deal with the ever-changing relationship between the static objects and the moving objects without any prior models of the moving objects. The effectiveness of the method has been validated by experiments in two representative dynamic environments: the campus road and the urban road.
基金supported by National Natural Science Foundation of China(Nos.NSFC 61473042 and 61105092)Beijing Higher Education Young Elite Teacher Project(No.YETP1215)
文摘In recent years, there have been a lot of interests in incorporating semantics into simultaneous localization and mapping (SLAM) systems. This paper presents an approach to generate an outdoor large-scale 3D dense semantic map based on binocular stereo vision. The inputs to system are stereo color images from a moving vehicle. First, dense 3D space around the vehicle is constructed, and tile motion of camera is estimated by visual odometry. Meanwhile, semantic segmentation is performed through the deep learning technology online, and the semantic labels are also used to verify tim feature matching in visual odometry. These three processes calculate the motion, depth and semantic label of every pixel in the input views. Then, a voxel conditional random field (CRF) inference is introduced to fuse semantic labels to voxel. After that, we present a method to remove the moving objects by incorporating the semantic labels, which improves the motion segmentation accuracy. The last is to generate tile dense 3D semantic map of an urban environment from arbitrary long image sequence. We evaluate our approach on KITTI vision benchmark, and the results show that the proposed method is effective.
基金supported by National High Technology Research Development Program of China (863 Program) (No.2011AA040202)National Science Foundation of China (No.51005008)
文摘This paper presents a hierarchical simultaneous localization and mapping(SLAM) system for a small unmanned aerial vehicle(UAV) using the output of an inertial measurement unit(IMU) and the bearing-only observations from an onboard monocular camera.A homography based approach is used to calculate the motion of the vehicle in 6 degrees of freedom by image feature match.This visual measurement is fused with the inertial outputs by an indirect extended Kalman filter(EKF) for attitude and velocity estimation.Then,another EKF is employed to estimate the position of the vehicle and the locations of the features in the map.Both simulations and experiments are carried out to test the performance of the proposed system.The result of the comparison with the referential global positioning system/inertial navigation system(GPS/INS) navigation indicates that the proposed SLAM can provide reliable and stable state estimation for small UAVs in GPS-denied environments.
基金Supported by the National Natural Science Foundation of China(51009040)National Defence Key Laboratory of Autonomous Underwater Vehicle Technology(2008002)Scientific Service Special Funds of University in China(E091002)
文摘A method of underwater simultaneous localization and mapping (SLAM) based on forward-looking sonar was proposed in this paper. Positions of objects were obtained by the forward-looking sonar, and an improved association method based on an ant colony algorithm was introduced to estimate the positions. In order to improve the precision of the positions, the extended Kalman filter (EKF) was adopted. The presented algorithm was tested in a tank, and the maximum estimation error of SLAM gained was 0.25 m. The tests verify that this method can maintain better association efficiency and reduce navigatioJ~ error.