首页 | 本学科首页   官方微博 | 高级检索  
相似文献
 共查询到20条相似文献,搜索用时 781 毫秒
1.
Reactive control for a mobile robot can be defined as a mapping from a perceptual space to a command space. This mapping can be hard-coded by the user (potential fields, fuzzy logic), and can also be learnt. This paper is concerned with supervised learning for perception to action mapping for a mobile robot. Among the existing neural approaches for supervised learning of a function, we have selected the grow and learn network for its properties adapted to robotic problems: incrementality and flexible structure. We will present the results we have obtained with this network using first raw sensor data and then pre-processed measures with the automatic construction of virtual sensors.  相似文献   

2.
We propose to use a multi-camera rig for simultaneous localization and mapping (SLAM), providing flexibility in sensor placement on mobile robot platforms while exploiting the stronger localization constraints provided by omni-directional sensors. In this context, we present a novel probabilistic approach to data association, that takes into account that features can also move between cameras under robot motion. Our approach circumvents the combinatorial data association problem by using an incremental expectation maximization algorithm. In the expectation step we determine a distribution over correspondences by sampling. In the maximization step, we find optimal parameters of a density over the robot motion and environment structure. By summarizing the sampling results in so-called virtual measurements, the resulting optimization simplifies to the equivalent optimization problem for known correspondences. We present results for simulated data, as well as for data obtained by a mobile robot equipped with a multi-camera rig.  相似文献   

3.
We present an approach for planning robotic manipulation tasks that uses a learned mapping between geometric states and logical predicates. Manipulation planning, because it requires task-level and geometric reasoning, requires such a mapping to convert between the two. Consider a robot tasked with putting several cups on a tray. The robot needs to find positions for all the objects, and may need to nest one cup inside another to get them all on the tray. This requires translating back and forth between symbolic states that the planner uses, such as stacked (cup1,cup2), and geometric states representing the positions and poses of the objects. We learn the mapping from labelled examples, and importantly learn a representation that can be used in both the forward (from geometric to symbolic) and reverse directions. This enables us to build symbolic representations of scenes the robot observes, but also to translate a desired symbolic state from a plan into a geometric state that the robot can achieve through manipulation. We also show how such a mapping can be used for efficient manipulation planning: the planner first plans symbolically, then applies the mapping to generate geometric positions that are then sent to a path planner.  相似文献   

4.
We present a mostly vision-based controller for mapping and completely covering a rectangular area by meandering cleaning lanes. The robot is guided along a parallel course by controlling the current distance to its previous lane. In order to frequently compute and–if necessary–correct the robot’s distance to the previous lane, a dense topological map of the robot’s workspace is built. The map stores snapshots, i.e. panoramic images, taken at regular distances while moving along a cleaning lane. For estimating the distance, we combine bearing information obtained by local visual homing with distance information derived from the robot’s odometry. In contrast to traditional mapping applications, we do not compute the robot’s full pose w.r.t. an external reference frame. We rather rely on partial pose estimation and only compute the sufficient and necessary information to solve the task. For our specific application this includes estimates of (i) the robot’s distance to the previous lane and of (ii) the robot’s orientation w.r.t. world coordinates. The results show that the proposed method achieves good results with only a small portion of overlap or gaps between the lanes. The dense topological representation of space and the proposed controller will be used as building blocks for more complex cleaning strategies making the robot capable of covering complex-shaped workspaces such as rooms or apartments.  相似文献   

5.
Reasoning about shadows in a mobile robot environment   总被引:1,自引:1,他引:0  
This paper describes a logic-based formalism for qualitative spatial reasoning with cast shadows (Perceptual Qualitative Relations on Shadows, or PQRS) and presents results of a mobile robot qualitative self-localisation experiment using this formalism. Shadow detection was accomplished by mapping the images from the robot’s monocular colour camera into a HSV colour space and then thresholding on the V dimension. We present results of self-localisation using two methods for obtaining the threshold automatically: in one method the images are segmented according to their grey-scale histograms, in the other, the threshold is set according to a prediction about the robot’s location, based upon a qualitative spatial reasoning theory about shadows. This theory-driven threshold search and the qualitative self-localisation procedure are the main contributions of the present research. To the best of our knowledge this is the first work that uses qualitative spatial representations both to perform robot self-localisation and to calibrate a robot’s interpretation of its perceptual input.  相似文献   

6.
Localisation and mapping with an omnidirectional camera becomes more difficult as the landmark appearances change dramatically in the omnidirectional image. With conventional techniques, it is difficult to match the features of the landmark with the template. We present a novel robot simultaneous localisation and mapping (SLAM) algorithm with an omnidirectional camera, which uses incremental landmark appearance learning to provide posterior probability distribution for estimating the robot pose under a particle filtering framework. The major contribution of our work is to represent the posterior estimation of the robot pose by incremental probabilistic principal component analysis, which can be naturally incorporated into the particle filtering algorithm for robot SLAM. Moreover, the innovative method of this article allows the adoption of the severe distorted landmark appearances viewed with omnidirectional camera for robot SLAM. The experimental results demonstrate that the localisation error is less than 1 cm in an indoor environment using five landmarks, and the location of the landmark appearances can be estimated within 5 pixels deviation from the ground truth in the omnidirectional image at a fairly fast speed.  相似文献   

7.
为了适应越来越复杂的非结构化环境,设计了一种基于球铰链连接和柔性支撑杆结合的线驱动连续型机械臂,并基于常曲率模型的假设建立连续型机器人的运动学模型,研究连续型机器人驱动映射关系,利用MATLAB进行运动学和驱动映射的仿真,仿真结果表明连续型机器人的空间优越性。搭建三关节连续型机器人样机平台,基于连续型机器人的特点设计末端关节跟随手柄操作模式,并在样机平台上实验验证,实验结果表明了运动学模型和驱动映射关系的合理性和正确性以及操控方式的可行性。  相似文献   

8.
9.
The availability of efficient mapping systems to produce accurate representations of initially unknown environments is recognized as one of the main requirements for autonomous mobile robots. In this paper, we present an efficient mapping system that has been implemented on a mobile robot equipped with a laser range scanner. The system builds geometrical point-based maps of environments employing an information-based exploration strategy that determines the best observation positions by taking into account both the distance travelled and the information gathered. Our exploration strategy, being based on solid mathematical foundations, differs from many ad hoc exploration strategies proposed in literature. We present: (a) the theoretical aspects of the criterion for determining the best observation positions for a robot building a map, (b) the implementation of a mapping system that uses the proposed criterion, and (c) the experimental validation of our approach.  相似文献   

10.
We contribute a method for improving the skill execution performance of a robot by complementing an existing algorithmic solution with corrective human demonstration. We apply the proposed method to the biped walking problem, which is a good example of a complex low level skill due to the complicated dynamics of the walk process in a high dimensional state and action space. We introduce an incremental learning approach to improve the Nao humanoid robot’s stability during walking. First, we identify, extract, and record a complete walk cycle from the motion of the robot as it executes a given walk algorithm as a black box. Second, we apply offline advice operators for improving the stability of the learned open-loop walk cycle. Finally, we present an algorithm to directly modify the recorded walk cycle using real time corrective human demonstration. The demonstrator delivers the corrective feedback using a commercially available wireless game controller without touching the robot. Through the proposed algorithm, the robot learns a closed-loop correction policy for the open-loop walk by mapping the corrective demonstrations to the sensory readings received while walking. Experiment results demonstrate a significant improvement in the walk stability.  相似文献   

11.
庄严  王伟  王珂  徐晓东 《自动化学报》2005,31(6):925-933
该文研究了部分结构化室内环境中自主移动机器人同时定位和地图构建问题.基于激光和视觉传感器模型的不同,加权最小二乘拟合方法和非局部最大抑制算法被分别用于提取二维水平环境特征和垂直物体边缘.为完成移动机器人在缺少先验地图支持的室内环境中的自主导航任务,该文提出了同时进行扩展卡尔曼滤波定位和构建具有不确定性描述的二维几何地图的具体方法.通过对于SmartROB-2移动机器人平台所获得的实验结果和数据的分析讨论,论证了所提出方法的有效性和实用性.  相似文献   

12.
激光雷达是移动机器人同步定位与地图构建(SLAM)的重要模块.对目前主流的基于激光雷达的SLAM方法(Gmapping和Hector SLAM)进行研究,借助开源机器人操作系统(ROS),在自主研发的移动机器人平台上配备激光雷达,实现了不同参数配置下两种算法的地图构建.实验为参数最优配置指明了方向,且证明了Hector SLAM的整体构图精度高于Gmapping,但对参数配置要求较高.  相似文献   

13.
Physical Path Planning Using a Pervasive Embedded Network   总被引:1,自引:0,他引:1  
We evaluate a technique that uses an embedded network deployed pervasively throughout an environment to aid robots in navigation. The embedded nodes do not know their absolute or relative positions and the mobile robots do not perform localization or mapping. Yet, the mobile robot is able to navigate through complex environments effectively. First, we present an algorithm for physical path planning and its implementation on the Gnats, a novel embedded network platform. Next, we investigate the quality of the computed paths. We present quantitative results collected from a real-world embedded network of 60 nodes. Experimentally, we find that, on average, the path computed by the network is only 24% longer than the optimal path. Finally, we show that the paths computed by the network are useful for a simple mobile robot. Results from a network of 156 nodes in a static environment and a network of 60 nodes in a dynamic environment are presented.  相似文献   

14.
We present a simultaneous localization and mapping (SLAM) algorithm that uses Bézier curves as static landmark primitives rather than feature points. Our approach allows us to estimate the full six degrees of freedom pose of a robot while providing a structured map that can be used to assist a robot in motion planning and control. We demonstrate how to reconstruct the three‐dimensional (3D) location of curve landmarks from a stereo pair and how to compare the 3D shape of curve landmarks between chronologically sequential stereo frames to solve the data association problem. We also present a method to combine curve landmarks for mapping purposes, resulting in a map with a continuous set of curves that contain fewer landmark states than conventional point‐based SLAM algorithms. We demonstrate our algorithm's effectiveness with numerous experiments, including comparisons to existing state‐of‐the‐art SLAM algorithms.  相似文献   

15.
In this article we present a class of position control schemes for robot manipulators based on feedback of visual information processed through artificial neural networks. We exploit the approximation capabilities of neural networks to avoid the computation of the robot inverse kinematics as well as the inverse task space–camera mapping which involves tedious calibration procedures. Our main stability result establishes rigorously that in spite of the neural network giving an approximation of these mappings, the closed‐loop system including the robot nonlinear dynamics is locally asymptotically stable provided that the Jacobian of the neural network is nonsingular. The feasibility of the proposed neural controller is illustrated through experiments on a planar robot. © 2000 John Wiley & Sons, Inc.  相似文献   

16.
Heterogeneous Teams of Modular Robots for Mapping and Exploration   总被引:3,自引:2,他引:1  
In this article, we present the design of a team of heterogeneous, centimeter-scale robots that collaborate to map and explore unknown environments. The robots, called Millibots, are configured from modular components that include sonar and IR sensors, camera, communication, computation, and mobility modules. Robots with different configurations use their special capabilities collaboratively to accomplish a given task. For mapping and exploration with multiple robots, it is critical to know the relative positions of each robot with respect to the others. We have developed a novel localization system that uses sonar-based distance measurements to determine the positions of all the robots in the group. With their positions known, we use an occupancy grid Bayesian mapping algorithm to combine the sensor data from multiple robots with different sensing modalities. Finally, we present the results of several mapping experiments conducted by a user-guided team of five robots operating in a room containing multiple obstacles.  相似文献   

17.
Wide-baseline stereo vision for terrain mapping   总被引:3,自引:0,他引:3  
Terrain mapping is important for mobile robots to perform localization and navigation. Stereo vision has been used extensively for this purpose in outdoor mapping tasks. However, conventional stereo does not scale well to distant terrain. This paper examines the use of wide-baseline stereo vision in the context of a mobile robot for terrain mapping, and we are particularly interested in the application of this technique to terrain mapping for Mars exploration. In wide-baseline stereo, the images are not captured simultaneously by two cameras, but by a single camera at different positions. The larger baseline allows more accurate depth estimation of distant terrain, but the robot motion between camera positions introduces two new problems. One issue is that the robot estimates the relative positions of the camera at the two locations imprecisely, unlike the precise calibration that is performed in conventional stereo. Furthermore, the wide-baseline results in a larger change in viewpoint than in conventional stereo. Thus, the images are less similar and this makes the stereo matching process more difficult. Our methodology addresses these issues using robust motion estimation and feature matching. We give results using real images of terrain on Earth and Mars and discuss the successes and failures of the technique.  相似文献   

18.
Traditionally, simultaneous localization and mapping (SLAM) algorithms solve the localization and mapping problem in explored regions. This paper presents a prediction-based SLAM algorithm (called P-SLAM), which has an environmental-structure predictor to predict the structure inside an unexplored region (i.e., look-ahead mapping). The prediction process is based on the observation of the surroundings of an unexplored region and comparing it with the built map of explored regions. If a similar environment/structure is matched in the map of explored regions, a hypothesis is generated to indicate that a similar structure has been explored before. If the environment has repeated structures, the mobile robot can use the predicted structure as a virtual mapping, and decide whether or not to explore the unexplored region to save the exploration time. If the mobile robot decides to explore the unexplored region, a correct prediction can be used to speed up the SLAM process and build a more accurate map. We have also derived the Bayesian formulation of P-SLAM to show its compact recursive form for real-time operation. We have experimentally implemented the proposed P-SLAM on a Pioneer 3-DX mobile robot using a Rao-Blackwellized particle filter in real time. Computer simulations and experimental results validated the performance of the proposed P-SLAM and its effectiveness in indoor environments  相似文献   

19.
Self-calibration of a space robot   总被引:5,自引:0,他引:5  
We present a neural-network method to recalibrate automatically a commercial robot after undergoing wear or damage, which works on top of the nominal inverse kinematics embedded in its controller. Our starting point has been the work of Ritter et al. (1989, 1992) on the use of extended self-organizing maps to learn the whole inverse kinematics mapping from scratch. Besides adapting their approach to learning only the deviations from the nominal kinematics, we have introduced several modifications to improve the cooperation between neurons. These modifications not only speed up learning by two orders of magnitude, but also produce some desirable side effects, like parameter stability. After extensive experimentation through simulation, the recalibration system has been installed in the REIS robot included in the space-station mock-up at Daimler-Benz Aerospace. Tests performed in this set-up have been constrained by the need to preserve robot integrity, but the results have been concordant with those predicted through simulation.  相似文献   

20.
Place recognition is a fundamental perceptual problem at the heart of many basic robot operations, most notably mapping. Failures can result from ambiguous sensor readings and environments with similar appearances. In this paper, we describe a robust place recognition algorithm that fuses a number of uncertain local matches into a high-confidence global match. We describe the theoretical basis of the approach and present extensive experimental results from a variety of sensor modalities and environments.  相似文献   

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

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