期刊文献+
共找到55篇文章
< 1 2 3 >
每页显示 20 50 100
Dense Mapping From an Accurate Tracking SLAM 被引量:5
1
作者 Weijie Huang Guoshan Zhang Xiaowei Han 《IEEE/CAA Journal of Automatica Sinica》 SCIE EI CSCD 2020年第6期1565-1574,共10页
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. 展开更多
关键词 Adaptive weights data association dense mapping hash table simultaneous localization and mapping(slam)
在线阅读 下载PDF
Research on simultaneous localization and mapping for AUV by an improved method:Variance reduction FastSLAM with simulated annealing 被引量:5
2
作者 Jiashan Cui Dongzhu Feng +1 位作者 Yunhui Li Qichen Tian 《Defence Technology(防务技术)》 SCIE EI CAS CSCD 2020年第3期651-661,共11页
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. 展开更多
关键词 Autonomous underwater vehicle(AUV) SONAR Simultaneous localization and mapping(slam) Simulated annealing FASTslam
在线阅读 下载PDF
Robust Iterated Sigma Point FastSLAM Algorithm for Mobile Robot Simultaneous Localization and Mapping 被引量:2
3
作者 SONG Yu SONG Yongduan LI Qingling 《Chinese Journal of Mechanical Engineering》 SCIE EI CAS CSCD 2011年第4期693-700,共8页
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. 展开更多
关键词 mobile robot simultaneous localization and mapping slam particle filter Kalman filter unscented transformation
在线阅读 下载PDF
一种基于增广EKF的移动机器人SLAM方法 被引量:7
4
作者 肖雄 李旦 +1 位作者 陈锡锻 李刚 《机电工程》 CAS 2014年第1期109-113,共5页
针对移动机器人同步定位与地图构建(SLAM)过程中系统测程法误差累积问题,采用测程法误差模型和车轮速度误差模型的映像关系,结合增广扩展卡尔曼滤波(AEKF)算法结构和实际机器人模型,提出了一种有效提高定位精度的SLAM方法。将机器人速... 针对移动机器人同步定位与地图构建(SLAM)过程中系统测程法误差累积问题,采用测程法误差模型和车轮速度误差模型的映像关系,结合增广扩展卡尔曼滤波(AEKF)算法结构和实际机器人模型,提出了一种有效提高定位精度的SLAM方法。将机器人速度校正参数附加到卡尔曼滤波算法的向量空间中,以形成增广状态空间,同时预测和更新了SLAM初始状态空间和速度校正参数,笔者在线实时修正机器人的速度和航向角,避免积累航向角误差,从而降低了测程法误差。基于均方根误差和归一化估计方差进行了仿真实验分析,研究结果表明:与EKF-SLAM相比,所提出的方法具有更好的估计性能,使算法保持良好的一致性,大幅度提高了机器人自身定位精度和路标估计准确度。 展开更多
关键词 增广扩展卡尔曼滤波 同步定位与地图构建 测程法误差 均方根误差 归一化误差 simultaneous localization and mapping(slam)
在线阅读 下载PDF
面向高动态环境的ORB-SLAM3算法优化 被引量:5
5
作者 傅柳军 龚烨 +2 位作者 李礼 万伟 姚剑 《测绘地理信息》 CSCD 2021年第S01期93-96,共4页
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) ORB-slam3 动态场景 Mask R-CNN 光流
原文传递
Robust Variational Bayesian Adaptive Cubature Kalman Filtering Algorithm for Simultaneous Localization and Mapping with Heavy-Tailed Noise 被引量:4
6
作者 ZHANG Zhuqing DONG Pengu +2 位作者 TUO Hongya LIU Guangjun JIA He 《Journal of Shanghai Jiaotong university(Science)》 EI 2020年第1期76-87,共12页
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. 展开更多
关键词 SIMULTANEOUS localization and mapping(slam) VARIATIONAL Bayesian(VB) heavy-tailed noise ROBUST estimation
原文传递
A novel method for mobile robot simultaneous localization and mapping 被引量:4
7
作者 LI Mao-hai HONG Bing-rong +1 位作者 LUO Rong-hua WEI Zhen-hua 《Journal of Zhejiang University-Science A(Applied Physics & Engineering)》 SCIE EI CAS CSCD 2006年第6期937-944,共8页
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. 展开更多
关键词 Mobile robot Rao-Blackwellized particle filter (RBPF) Monocular vision Simultaneous localization and mapping slam
在线阅读 下载PDF
An Improved FastSLAM Algorithm Based on Revised Genetic Resampling and SR-UPF 被引量:6
8
作者 Tai-Zhi Lv Chun-Xia Zhao Hao-Feng Zhang 《International Journal of Automation and computing》 EI CSCD 2018年第3期325-334,共10页
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. 展开更多
关键词 Simultaneous localization and mapping slam genetic algorithm square root unscented particle filter (SR-UPF) fastMetropolis-Hastings (MH) double roulette wheels.
原文传递
Continuous Probabilistic SLAM Solved via Iterated Conditional Modes 被引量:2
9
作者 J.Gimenez A.Amicarelli +2 位作者 J.M.Toibero F.di Sciascio R.Carelli 《International Journal of Automation and computing》 EI CSCD 2019年第6期838-850,共13页
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. 展开更多
关键词 PROBABILISTIC simultaneous localization and mapping(slam) dynamic obstacles Markov random fields(MRF) ITERATED CONDITIONAL modes(ICM) kernel estimator
原文传递
Simultaneous Localization and Mapping of Autonomous Underwater Vehicle Using Looking Forward Sonar 被引量:2
10
作者 曾文静 万磊 +1 位作者 张铁栋 黄蜀玲 《Journal of Shanghai Jiaotong university(Science)》 EI 2012年第1期91-97,共7页
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. 展开更多
关键词 simultaneous localization and mapping(slam) autonomous underwater vehicle(AUV) LOOKING FORWARD SONAR extended KALMAN filter(EKF)
原文传递
Localization and mapping in urban area based on 3D point cloud of autonomous vehicles 被引量:2
11
作者 王美玲 李玉 +2 位作者 杨毅 朱昊 刘彤 《Journal of Beijing Institute of Technology》 EI CAS 2016年第4期473-482,共10页
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. 展开更多
关键词 simultaneous localization and mapping slam Rao-Blackwellized particle filter RB-PF) VoxelGrid filter ICP algorithm Gaussian model urban area
在线阅读 下载PDF
基于ORB-SLAM框架的直接法改进与对比 被引量:2
12
作者 李浩东 陶钧 +1 位作者 刘辰宇 龙宇浩 《测绘地理信息》 CSCD 2022年第S01期211-215,共5页
在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。 展开更多
关键词 同步定位与建图(simultaneous localization and mapping slam) ORB-slam 特征点法 直接法
原文传递
A Brain-inspired SLAM System Based on ORB Features 被引量:4
13
作者 Sun-Chun Zhou Rui Yan +2 位作者 Jia-Xin Li Ying-Ke Chen Huajin Tang 《International Journal of Automation and computing》 EI CSCD 2017年第5期564-575,共12页
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. 展开更多
关键词 Simultaneous localization and mapping slam Ratslam mobile robot oriented features from accelerated segment test and rotated binary robust independent elementary (ORB) features of RGB (red green blue) cognitive map.
原文传递
Robust SLAM using square-root cubature Kalman filter and Huber's GM-estimator 被引量:2
14
作者 徐巍军 Jiang Rongxin +2 位作者 Xie Li Tian Xiang Chen Yaowu 《High Technology Letters》 EI CAS 2016年第1期38-46,共9页
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. 展开更多
关键词 square-root cubature Kalman filter simultaneous localization and mappingslam Huber' s GM-estimator ROBUSTNESS
在线阅读 下载PDF
A Sensor-based SLAM Algorithm for Camera Tracking in Virtual Studio 被引量:1
15
作者 Mansour Moniri Claude C.Chibelushi 《International Journal of Automation and computing》 EI 2008年第2期152-162,共11页
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. 展开更多
关键词 Simultaneous localization and mapping slam particle filter chroma key camera tracking
在线阅读 下载PDF
Rapid State Augmentation for Compressed EKF-Based Simultaneous Localization and Mapping 被引量:1
16
作者 窦丽华 张海强 +1 位作者 陈杰 方浩 《Journal of Beijing Institute of Technology》 EI CAS 2009年第2期192-197,共6页
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. 展开更多
关键词 simultaneous localization and mapping slam extended Kalman filter state augment compu- tational volume
在线阅读 下载PDF
A novel algorithm for SLAM in dynamic environments using landscape theory of aggregation 被引量:1
17
作者 华承昊 窦丽华 +1 位作者 方浩 付浩 《Journal of Central South University》 SCIE EI CAS CSCD 2016年第10期2587-2594,共8页
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. 展开更多
关键词 mobile robot simultaneous localization and mapping(slam) dynamic environment landscape theory of aggregation iterative closest point
在线阅读 下载PDF
Large-scale 3D Semantic Mapping Using Stereo Vision 被引量:1
18
作者 Yi Yang Fan Qiu +3 位作者 Hao Li Lu Zhang Mei-Ling Wang Meng-Yin Fu 《International Journal of Automation and computing》 EI CSCD 2018年第2期194-206,共13页
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. 展开更多
关键词 Semantic map stereo vision motion segmentation visual odometry simultaneous localization and mapping slam).
原文传递
Bearing-only Visual SLAM for Small Unmanned Aerial Vehicles in GPS-denied Environments 被引量:7
19
作者 Chao-Lei Wang Tian-Miao Wang +2 位作者 Jian-Hong Liang Yi-Cheng Zhang Yi Zhou 《International Journal of Automation and computing》 EI CSCD 2013年第5期387-396,共10页
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. 展开更多
关键词 Visual simultaneous localization and mappingslam bearing-only observation inertial measurement unit small unmanned aerial vehicles(UAVs) GPS-denied environment
原文传递
Underwater Simultaneous Localization and Mapping Based on Forward-looking Sonar 被引量:1
20
作者 Tiedong Zhang Wenjing Zeng Lei Wan 《Journal of Marine Science and Application》 2011年第3期371-376,共6页
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. 展开更多
关键词 simultaneous localization and mapping slam looking forward sonar extended Kalman filter (EKF)
在线阅读 下载PDF
上一页 1 2 3 下一页 到第
使用帮助 返回顶部