首页 | 本学科首页   官方微博 | 高级检索  
相似文献
 共查询到20条相似文献,搜索用时 31 毫秒
1.
In this paper we propose a new approach to solve some challenges in the simultaneous localization and mapping (SLAM) problem based on the relative map filter (RMF). This method assumes that the relative distances between the landmarks of relative map are estimated fully independently. This considerably reduces the computational complexity to average number of landmarks observed in each scan. To solve the ambiguity that may happen in finding the absolute locations of robot and landmarks, we have proposed two separate methods, the lowest position error (LPE) and minimum variance position estimator (MVPE). Another challenge in RMF is data association problem where we also propose an algorithm which works by using motion sensors without engaging in their cumulative error. To apply these methods, we switch successively between the absolute and relative positions of landmarks. Having a sufficient number of landmarks in the environment, our algorithm estimates the positions of robot and landmarks without using motion sensors and kinematics of robot. Motion sensors are only used for data association. The empirical studies on the proposed RMF-SLAM algorithm with the LPE or MVPE methods show a better accuracy in localization of robot and landmarks in comparison with the absolute map filter SLAM.  相似文献   

2.
This article introduces the incorporation of acoustic sensors for the localization of a mobile robot. The robot is considered as a sound source and its position is located applying a Time Delay of Arrival (TDOA) method. Since the accuracy of this method varies with the microphone array, a navigation acoustic map that indicates the location errors is built. This map also provides the robot with navigation trajectories point-to-point and the control is capable to drive the robot through these trajectories to a desired configuration. The proposed localization method is thoroughly tested using both a 900?Hz square signal and the natural sound of the robot, which is driven near the desired point with an average error of 0.067?m.  相似文献   

3.
Localization is a key issue for a mobile robot, in particular in environments where a globally accurate positioning system, such as GPS, is not available. In these environments, accurate and efficient robot localization is not a trivial task, as an increase in accuracy usually leads to an impoverishment in efficiency and viceversa. Active perception appears as an appealing way to improve the localization process by increasing the richness of the information acquired from the environment. In this paper, we present an active perception strategy for a mobile robot provided with a visual sensor mounted on a pan-tilt mechanism. The visual sensor has a limited field of view, so the goal of the active perception strategy is to use the pan-tilt unit to direct the sensor to informative parts of the environment. To achieve this goal, we use a topological map of the environment and a Bayesian non-parametric estimation of robot position based on a particle filter. We slightly modify the regular implementation of this filter by including an additional step that selects the best perceptual action using Monte Carlo estimations. We understand the best perceptual action as the one that produces the greatest reduction in uncertainty about the robot position. We also consider in our optimization function a cost term that favors efficient perceptual actions. Previous works have proposed active perception strategies for robot localization, but mainly in the context of range sensors, grid representations of the environment, and parametric techniques, such as the extended Kalman filter. Accordingly, the main contributions of this work are: i) Development of a sound strategy for active selection of perceptual actions in the context of a visual sensor and a topological map; ii) Real time operation using a modified version of the particle filter and Monte Carlo based estimations; iii) Implementation and testing of these ideas using simulations and a real case scenario. Our results indicate that, in terms of accuracy of robot localization, the proposed approach decreases mean average error and standard deviation with respect to a passive perception scheme. Furthermore, in terms of efficiency, the active scheme is able to operate in real time without adding a relevant overhead to the regular robot operation.  相似文献   

4.
A vision-based navigation system is presented for determining a mobile robot's position and orientation using panoramic imagery. Omni-directional sensors are useful in obtaining a 360° field of view, permitting various objects in the vicinity of a robot to be imaged simultaneously. Recognizing landmarks in a panoramic image from an a priori model of distinct features in an environment allows a robot's location information to be updated. A system is shown for tracking vertex and line features for omni-directional cameras constructed with catadioptric (containing both mirrors and lenses) optics. With the aid of the panoramic Hough transform, line features can be tracked without restricting the mirror geometry so that it satisfies the single viewpoint criteria. This allows the use of rectangular scene features to be used as landmarks. Two paradigms for localization are explored, with experiments conducted with synthetic and real images. A working implementation on a mobile robot is also shown.  相似文献   

5.
Mobile robots are generally equipped with proprioceptive motion sensors such as odometers and inertial sensors. These sensors are used for dead-reckoning navigation in an indoor environment where GPS is not available. However, this dead-reckoning scheme is susceptible to drift error in position and heading. This study proposes using grid line patterns which are often found on the surface of floors or ceilings in an indoor environment to obtain pose (i.e., position and orientation) fix information without additional external position information by artificial beacons or landmarks. The grid lines can provide relative pose information of a robot with respect to the grid structure and thus can be used to correct the pose estimation errors. However, grid line patterns are repetitive in nature, which leads to difficulties in estimating its configuration and structure using conventional Gaussian filtering that represent the system uncertainty using a unimodal function (e.g., Kalman filter). In this study, a probabilistic sensor model to deal with multiple hypotheses is employed and an online navigation filter is designed in the framework of particle filtering. To demonstrate the performance of the proposed approach, an experiment was performed in an indoor environment using a wheeled mobile robot, and the results are presented.  相似文献   

6.
《Advanced Robotics》2013,27(6-7):923-939
A wheel-type mobile robot is simply able to localize with odometry. However, for mobile agricultural robots, it is necessary to consider that the environment is uneven terrain. Therefore, odometry is unreliable and it is necessary to augment the odometry by measuring the position of the robot relative to known objects in the environments. This paper describes the application of localization based on the DC magnetic field that occurs in the environment on mobile agricultural robots. In this research, a magnetic sensor is applied to scan the DC magnetic field to build a magnetic database. The robot localizes by matching magnetic sensor readings against the magnetic database. The experimental results indicate that the robot is able to localize accurately with the proposed method and the cumulative error can be eliminated by applying the localization results to compensate for the odometry.  相似文献   

7.
Detection of landmarks is essential in mobile robotics for navigation tasks like building topological maps or robot localization. Doors are one of the most common landmarks since they show the topological structure of indoor environments. In this paper, the novel paradigm of fuzzy temporal rules is used for detecting doors from the information of ultrasound sensors. This paradigm can be used both to model the necessary knowledge for detection and to consider the temporal variation of several sensor signals. Experimental results using a Nomad 200 mobile robot in a real environment produce 91% of doors were correctly detected, which show the reliability and robustness of the system.  相似文献   

8.
In this article, we propose a localization scheme for a mobile robot based on the distance between the robot and moving objects. This method combines the distance data obtained from ultrasonic sensors in a mobile robot, and estimates the location of the mobile robot and the moving object. The movement of the object is detected by a combination of data and the object’s estimated position. Then, the mobile robot’s location is derived from the a priori known initial state. We use kinematic modeling that represents the movement of a robot and an object. A Kalman-filtering algorithm is used for addressing estimation error and measurement noise. Throughout the computer simulation experiments, the performance is verified. Finally, the results of experiments are presented and discussed. The proposed approach allows a mobile robot to seek its own position in a weakly structured environment. This work was presented in part at the 12th International Symposium on Artificial Life and Robotics, Oita, Japan, January 25–27, 2007  相似文献   

9.
Active Markov localization for mobile robots   总被引:19,自引:0,他引:19  
Localization is the problem of determining the position of a mobile robot from sensor data. Most existing localization approaches are passive, i.e., they do not exploit the opportunity to control the robot's effectors during localization. This paper proposes an active localization approach. The approach is based on Markov localization and provides rational criteria for (1) setting the robot's motion direction (exploration), and (2) determining the pointing direction of the sensors so as to most efficiently localize the robot. Furthermore, it is able to deal with noisy sensors and approximative world models. The appropriateness of our approach is demonstrated empirically using a mobile robot in a structured office environment.  相似文献   

10.
Robot Pose Estimation in Unknown Environments by Matching 2D Range Scans   总被引:14,自引:0,他引:14  
A mobile robot exploring an unknown environment has no absolute frame of reference for its position, other than features it detects through its sensors. Using distinguishable landmarks is one possible approach, but it requires solving the object recognition problem. In particular, when the robot uses two-dimensional laser range scans for localization, it is difficult to accurately detect and localize landmarks in the environment (such as corners and occlusions) from the range scans.In this paper, we develop two new iterative algorithms to register a range scan to a previous scan so as to compute relative robot positions in an unknown environment, that avoid the above problems. The first algorithm is based on matching data points with tangent directions in two scans and minimizing a distance function in order to solve the displacement between the scans. The second algorithm establishes correspondences between points in the two scans and then solves the point-to-point least-squares problem to compute the relative pose of the two scans. Our methods work in curved environments and can handle partial occlusions by rejecting outliers.  相似文献   

11.
This paper describes an efficient and robust localization system for indoor mobile robots and AGVs. The system utilizes a sensor that measures bearings to artificial landmarks, and an efficient triangulation method. We present a calibration method for the system components and overcome typical problems for sensors of the mentioned type, which are localization in motion and incorrect identification of landmarks. The resulting localization system was tested on a mobile robot. It consumes less than 4% of a Pentium4 3.2 GHz processing power while providing an accurate and reliable localization result every 0.5 s. The system was successfully incorporated within a real mobile robot system which performs many other computational tasks in parallel.  相似文献   

12.
In this work, we examine the classic problem of robot navigation via visual simultaneous localization and mapping (SLAM), but introducing the concept of dual optical and thermal (cross-spectral) sensing with the addition of sensor handover from one to the other. In our approach we use a novel combination of two primary sensors: co-registered optical and thermal cameras. Mobile robot navigation is driven by two simultaneous camera images from the environment over which feature points are extracted and matched between successive frames. A bearing-only visual SLAM approach is then implemented using successive feature point observations to identify and track environment landmarks using an extended Kalman filter (EKF). Six-degree-of-freedom mobile robot and environment landmark positions are managed by the EKF approach illustrated using optical, thermal and combined optical/thermal features in addition to handover from one sensor to another. Sensor handover is primarily targeted at a continuous SLAM operation during varying illumination conditions (e.g., changing from night to day). The final methodology is tested in outdoor environments with variation in the light conditions and robot trajectories producing results that illustrate that the additional use of a thermal sensor improves the accuracy of landmark detection and that the sensor handover is viable for solving the SLAM problem using this sensor combination.  相似文献   

13.
SLAM 问题中机器人定位误差分析与控制   总被引:6,自引:1,他引:5  
移动机器人同步定位与建图问题 (Simultaneous localization and mapping, SLAM) 是机器人能否在未知环境中实现完全自主的关键问题之一. 其中, 机器人定位估计对于保持地图的一致性非常重要. 本文分析了 SLAM 问题中机器人定位误差的收敛特性. 分析表明随着机器人的运动,机器人定位误差总体上逐渐增大; 在完全未知环境中无法预测机器人定位误差的上限. 根据理论分析, 本文提出了一种控制机器人定位误差在单位距离上增长速度的算法. 该算法通过搜索获得满足定位误差限制的最佳的机器人运动速度, 从而控制机器人定位误差的增长.  相似文献   

14.
In this paper, we propose a multi-sensor fusion algorithm based on particle filters for mobile robot localisation in crowded environments. Our system is able to fuse the information provided by sensors placed on-board, and sensors external to the robot (off-board). We also propose a methodology for fast system deployment, map construction, and sensor calibration with a limited number of training samples. We validated our proposal experimentally with a laser range-finder, a WiFi card, a magnetic compass, and an external multi-camera network. We have carried out experiments that validate our deployment and calibration methodology. Moreover, we performed localisation experiments in controlled situations and real robot operation in social events. We obtained the best results from the fusion of all the sensors available: the precision and stability was sufficient for mobile robot localisation. No single sensor is reliable in every situation, but nevertheless our algorithm works with any subset of sensors: if a sensor is not available, the performance just degrades gracefully.  相似文献   

15.
A new area expansion algorithm for the localization scheme, using temporary beacons, is proposed in this paper. The effective area of the active beacons is limited by the strength of the ultrasonic signals in a noisy environment. When a mobile robot needs to move into a hazardous area or into an unstructured environment where the beacons with pre-specified position information are not available, the localization may solely rely on dead reckoning sensors such as encoders. To overcome the error accumulation by using dead-reckoning, a new scheme is developed, in this paper, in which the mobile robot carries a few temporary beacons which do not have any pre-stored position information. When the mobile robot encounters a dangerous or unstructured environment, it utilizes the temporary beacons to localize itself. An auto-calibration algorithm has been developed to provide the position information to the temporary beacons before they are used for the localization. With these temporary beacons and the auto-calibration algorithm, mobile robots can safely pass unstructured areas. The effectiveness of the temporary beacons and auto-calibration algorithm is verified through real experiments of mobile robot navigation.  相似文献   

16.
《Advanced Robotics》2013,27(6):737-762
Latest advances in hardware technology and state-of-the-art of mobile robots and artificial intelligence research can be employed to develop autonomous and distributed monitoring systems. A mobile service robot requires the perception of its present position to co-exist with humans and support humans effectively in populated environments. To realize this, a robot needs to keep track of relevant changes in the environment. This paper proposes localization of a mobile robot using images recognized by distributed intelligent networked devices in intelligent space (ISpace) in order to achieve these goals. This scheme combines data from the observed position, using dead-reckoning sensors, and the estimated position, using images of moving objects, such as a walking human captured by a camera system, to determine the location of a mobile robot. The moving object is assumed to be a point-object and projected onto an image plane to form a geometrical constraint equation that provides position data of the object based on the kinematics of the ISpace. Using the a priori known path of a moving object and a perspective camera model, the geometric constraint equations that represent the relation between image frame coordinates for a moving object and the estimated robot's position are derived. The proposed method utilizes the error between the observed and estimated image coordinates to localize the mobile robot, and the Kalman filtering scheme is used for the estimation of the mobile robot location. The proposed approach is applied for a mobile robot in ISpace to show the reduction of uncertainty in determining the location of a mobile robot, and its performance is verified by computer simulation and experiment.  相似文献   

17.
Position error is a significant limitation for industrial robots in high-precision machining and manufacturing. Efficient error measurement and compensation for robots equipped with end-effectors are difficult in industrial environments. This paper proposes a robot calibration method based on an elasto–geometrical error and gravity model. Firstly, a geometric error model was established based on the D-H method, and the gravity and compliance error models were constructed to predict the elastic deformation caused by the self-weight of the robot. Subsequently, the position error model was established by considering the attitude error of the robot flange coordinate system. A two-step robot configuration selection method was developed based on the sequential floating forward selection algorithm to optimize the robot configuration for calibrating the position error and gravity models. Then, the geometric error and compliance coefficient were identified simultaneously based on the hybrid evolution algorithm. The gravity model parameters were identified based on the same algorithm using the joint torque signal provided by the robot controller. Finally, calibration and compensation experiments were conducted on a KR-160 industrial robot equipped with a spindle using a laser tracker and internal robot data. The experimental results show that the robot tool center point error can be significantly improved by using the proposed method.  相似文献   

18.
文章磁目标跟踪系统选用霍尼韦尔HMC1043磁传感器阵列来采集永磁体的磁场信息,并实现定位。由于磁场传感器阵列的各传感器位置、方向和灵敏度直接影响系统定位的精确度,所以要求对这些磁传感器参数进行准确的标定。文章针对磁传感器阵列的标定问题提出了目标误差函数和优化计算方法。通过对所有参数的迭代计算和优化更新使目标误差函数达到最小,完成对磁传感器的位置、方向和灵敏度等参数的标定。文章方法已对实际传感器系统实施应用。在MATLAB环境下,PC机采集目标磁体的磁场信号,通过算法计算确定所有磁传感器的位置、方向和灵敏度,完成标定。通过文章方法的标定,系统定位精度有明显的提高,本方法的可行性和合理性也因此得到验证。  相似文献   

19.
Pathfinding is becoming more and more common in autonomous vehicle navigation, robot localization, and other computer vision applications. In this paper, a novel approach to mapping and localization is presented that extracts visual landmarks from a robot dataset acquired by a Kinect sensor. The visual landmarks are detected and recognized using the improved scale-invariant feature transform (I-SIFT) method. The methodology is based on detecting stable and invariant landmarks in consecutive (red-green-blue depth) RGB-D frames of the robot dataset. These landmarks are then used to determine the robot path, and a map is constructed by using the visual landmarks. A number of experiments were performed on various datasets in an indoor environment. The proposed method performs efficient landmark detection in various environments, which includes changes in rotation and illumination. The experimental results show that the proposed method can solve the simultaneous localization and mapping (SLAM) problem using stable visual landmarks, but with less computation time.  相似文献   

20.
Resource-constrained mobile sensors require periodic position measurements for navigation around the sensing region. Such information is often obtained using GPS or onboard sensors such as optical encoders. However, GPS is not reliable in all environments, and odometry accrues error over time. Although several localization techniques exist for wireless sensor networks, they are typically time consuming, resource intensive, and/or require expensive hardware, all of which are undesirable for lightweight mobile devices. In this paper, we describe a technique for determining spatial relationships that is suitable for resource-constrained mobile sensors. Angular separation between multiple pairs of stationary sensor nodes is derived using wheel encoder data in conjunction with the measured Doppler shift of an RF interference signal. Our experimental results demonstrate that using this technique, a robot is able to determine the angular separation between four pairs of sensors in a 45 × 35 m sensing region with an average error of 0.28 rad. in 0.68 s.  相似文献   

设为首页 | 免责声明 | 关于勤云 | 加入收藏

Copyright©北京勤云科技发展有限公司  京ICP备09084417号