首页 | 本学科首页   官方微博 | 高级检索  
相似文献
 共查询到20条相似文献,搜索用时 31 毫秒
1.
In this paper we propose a machine learning technique for real-time robot path planning for an autonomous robot in a planar environment with obstacles where the robot possess no a priori map of its environment. Our main insight in this paper is that a robot’s path planning times can be significantly reduced if it can refer to previous maneuvers it used to avoid obstacles during earlier missions, and adapt that information to avoid obstacles during its current navigation. We propose an online path planning algorithm called LearnerRRT that utilizes a pattern matching technique called Sample Consensus Initial Alignment (SAC-IA) in combination with an experience-based learning technique to adapt obstacle boundary patterns encountered in previous environments to the current scenario followed by corresponding adaptations in the obstacle-avoidance paths. Our proposed algorithm LearnerRRT works as a learning-based reactive path planning technique which enables robots to improve their overall path planning performance by locally improving maneuvers around commonly encountered obstacle patterns by accessing previously accumulated environmental information. We have conducted several experiments in simulations and hardware to verify the performance of the LearnerRRT algorithm and compared it with a state-of-the-art sampling-based planner. LearnerRRT on average takes approximately 10% of the planning time and 14% of the total time taken by the sampling-based planner to solve the same navigation task based on simulation results and takes only 33% of the planning time, 46% of total time and 95% of total distance compared to the sampling-based planner based on our hardware results.  相似文献   

2.
Integration of Control Theory and Genetic Programming paradigm toward development a family of controllers is addressed in this paper. These controllers are applied for autonomous navigation with collision avoidance and bounded velocity of an omnidirectional mobile robot. We introduce the concepts of natural and adaptive behaviors to relate each control objective with a desired behavior for the mobile robot. Natural behaviors lead the system to fulfill a task inherently. In this work, the motion of the mobile robot to achieve desired position, ensured by applying a Control-Theory-based controller, defines the natural behavior. The adaptive behavior, learned through Genetic-Programming, fits the robot motion in order to avoid collision with an obstacle while fulfilling velocity constraints. Hence, the behavior of the mobile robot is the addition of the natural and the adaptive behaviors. Our proposed methodology achieves the discovery of 9402 behaviors without collisions where asymptotic convergence to desired goal position is demonstrated by Lyapunov stability theory. Effectiveness of proposed framework is illustrated through a comparison between experiments and numerical simulations for a real mobile robot.  相似文献   

3.
4.
Obstacle avoidance methods approach the problem of mobile robot autonomous navigation by steering the robot in real-time according to the most recent sensor readings, being suitable to dynamic or unknown environments. However, real-time performance is commonly gained by ignoring the robot shape and some or all of its kinematic restrictions which may lead to poor navigation performance in many practical situations. In this paper we propose a framework where a kinematically constrained and any-shape robot is transformed in real-time into a free-flying point in a new space where well-known obstacle avoidance methods are applicable. Our contribution with this framework is twofold: the definition of generalized space transformations that cover most of the existing transformational approaches, and a reactive navigation system where multiple transformations can be applied concurrently in order to optimize robot motion decisions. As a result, these transformations allow existing obstacle avoidance methods to perform better detection of the surrounding free-space, through “sampling” the space with paths compatible with the robot kinematics. We illustrate how to design these space transformations with some examples from our experience with real robots navigating in indoor, cluttered, and dynamic scenarios. Also, we provide experimental results that demonstrate the advantages of our approach over previous methods when facing similar situations.
Juan-Antonio Fernández-MadrigalEmail:
  相似文献   

5.
障碍距离检测是移动机器人导航的关键问题之一。为了实现精确实时的障碍检测,针对某二维TOF激光雷达,对其数据标定、物体表面的属性、混合像素等因素进行试验,评估了其测距性能。同时,通过移动机器人运行过程中激光雷达的测距数据分析,设计了动态自适应滤波器以消除障碍检测中的测距噪声干扰。运行过程中的障碍检测试验表明:该方法可以实现可靠的障碍检测,并为移动机器人导航中环境建模、自定位及路径规划提供支持。  相似文献   

6.
This paper addresses the NP-complete problem of Navigation Among Movable Obstacles (NAMO) in which a robot is required to find a collision-free path toward a goal through manipulating and transferring some movable objects on its way. The robot’s main goal is to optimize a performance criterion such as runtime, length of transit or transfer paths, number of manipulated obstacles, total number of displacements of all objects, etc. We have designed a recursive algorithm capable of solving various NAMO problems, ranging from linear monotone to nonlinear non-monotone, and with convex or concave polygonal obstacles. Through the adopted approach, the original problem is decomposed into recursively-solved subproblems, in each of which only one movable object is manipulated. In each call of the algorithm, first a Visibility Graph determines a path from the robot’s current configuration to an intermediate goal configuration, and then a tentative final configuration for the last object intercepting the path is calculated using the Penetration Depth concept. It is assumed that the objects can be pulled or pushed, but not rotated, in a continuous space, and under such assumptions the method is complete and locally optimal for convex objects, with a worst-case time complexity of O(n43m) in which m is the number of movable objects and n is the number of all vertices on them. Several computational experiments showed that compared to the existing methods in the literature, the proposed recursive method achieved equal or smaller number of transferred obstacles or the total number of displacements of all objects in majority of the test problems.  相似文献   

7.
8.
移动机器人导航中激光雷达测距性能研究   总被引:7,自引:0,他引:7  
距离检测是移动机器人导航的一个关键问题.文章介绍了基于飞行时间法测距的二维激光雷达LMS291的工作原理,分析了影响LMS291测距性能的误差因素,通过统计分析对测距数据进行标定,研究了不同物体表面属性对测距精度的影响;通过混合像素测定方法确定LMS291的角度分辨率;通过对激光雷达测距性能的试验,建立测距误差模型.所得结论可以为复杂非结构化环境下移动机器人导航中障碍检测、环境建模及自定位提供支持.  相似文献   

9.
This study proposes an efficient wall-following and navigation control model that includes three control modes, namely w all-f ollowing (WF), t oward-g oal (TG), and b ehavior m anager (BM). To achieve an adaptive controller for WF mode, an efficientr ecurrent f uzzy c erebellar m odel a rticulation c ontroller (RFCMAC) based on d ynamic g roup a rtificial b ee c olony (DGABC) is proposed for implementing reinforcement learning process. The fitness function includes four assessment factors which are defined as follows: (1) maintaining safe distance between the mobile robot and the wall; (2) ensuring successfully running a cycle; (3) avoiding mobile robot collisions; (4) mobile robot running at a maximum speed. Moreover, the BM is used to switch WF mode and TG mode, and is employed as an escape mechanism based on the relationship between the robot and the environment. The experimental results show that the proposed DGABC is more effective than the traditional ABC in WF mode. The proposed control method also obtains a better navigation control than other methods in unknown environments.  相似文献   

10.
11.
This paper presents a real-time navigating system named Destination Driven Navigator for a mobile robot operating in unstructured static and dynamic environments. We have designed a new obstacle representation method named Cross-Line Obstacle Representation and a new concept work space to reduce the robot's search space and the environment storage cost, an Adapted Regression Model to predict dynamic obstacles' motion, Multi-State Path Repair rules to quickly translate an infeasible path into feasible one, and the path-planning algorithm to generate a path. A high-level Destination Driven Navigator uses these methods, models and algorithms to guide a mobile robot traveling in various environments while avoiding static and dynamic obstacles. A group of experiments has been conducted. The results exhibit that the Destination Driven Navigator is a powerful and effective paradigm for robot motion planning and obstacle avoidance.  相似文献   

12.
《Advanced Robotics》2013,27(5):463-478
This paper describes the theory and an experiment of a velocity potential approach to path planning and avoiding moving obstacles for an autonomous mobile robot by use of the Laplace potential. This new navigation function for path planning is feasible for guiding a mobile robot avoiding arbitrarily moving obstacles and reaching the goal in real time. The essential feature of the navigation function comes from the introduction of fluid flow dynamics into the path planning. The experiment is conducted to verify the effectiveness of the navigation function for obstacle avoidance in a real world. Two examples of the experiment are presented; first, the avoidance of a moving obstacle in parallel line-bounded space, and second, the avoidance of one moving obstacle and another standing obstacle. The robot can reach the goal after successfully avoiding the obstacles in these cases.  相似文献   

13.
Physics-based motion planning is a challenging task, since it requires the computation of the robot motions while allowing possible interactions with (some of) the obstacles in the environment. Kinodynamic motion planners equipped with a dynamic engine acting as state propagator are usually used for that purpose. The difficulties arise in the setting of the adequate forces for the interactions and because these interactions may change the pose of the manipulatable obstacles, thus either facilitating or preventing the finding of a solution path. The use of knowledge can alleviate the stated difficulties. This paper proposes the use of an enhanced state propagator composed of a dynamic engine and a low-level geometric reasoning process that is used to determine how to interact with the objects, i.e. from where and with which forces. The proposal, called κ-PMP can be used with any kinodynamic planner, thus giving rise to e.g. κ-RRT. The approach also includes a preprocessing step that infers from a semantic abstract knowledge described in terms of an ontology the manipulation knowledge required by the reasoning process. The proposed approach has been validated with several examples involving an holonomic mobile robot, a robot with differential constraints and a serial manipulator, and benchmarked using several state-of-the art kinodynamic planners. The results showed a significant difference in the power consumption with respect to simple physics-based planning, an improvement in the success rate and in the quality of the solution paths.  相似文献   

14.
Mobile robots have been widely implemented in industrial automation and smart factories. Different types of mobile robots work cooperatively in the workspace to complete some complicated tasks. Therefore, the main requirement for multi-robot systems is collision-free navigation in dynamic environments. In this paper, we propose a sensor network based navigation system for ground mobile robots in dynamic industrial cluttered environments. A range finder sensor network is deployed on factory floor to detect any obstacles in the field of view and perform a global navigation for any robots simultaneously travelling in the factory. The obstacle detection and robot navigation are integrated into the sensor network and the robot is only required for a low-level path tracker. The novelty of this paper is to propose a sensor network based navigation system with a novel artificial potential field (APF) based navigation algorithm. Computer simulations and experiments confirm the performance of the proposed method.  相似文献   

15.
16.
This paper describes a mobile robot equipped with a real time sound localization system as well as a sonar system for obstacle detection. The sound localization method is based on a model of the precedence effect of the human auditory system to cope with echoes and reverberations. Sound localization and robot navigation experiments were conducted. The results show that the robot is capable of localizing sounding objects in a reverberant environment and approaching the objects without collisions, even when the objects were behind obstacles. Environment flexibility and error robustness of the system were discussed as well.  相似文献   

17.
在移动机器人环境建图中,动态障碍物的存在直接影响传感器的读数,导致产生不一致的环境地图,因此,移动机器人构建地图必须滤除动态障碍物干扰。采用直线插补的方法在先前的局部图上搜寻机器人与目标点之间是否存在障碍物,若存在障碍,则可判定该障碍物已移走(即为动态障碍),应该予以滤除。实验结果证明,该方法能在建图过程中有效地滤除动态障碍,并能有效减少静态障碍物探测的误差累积,算法复杂度小。  相似文献   

18.
A sensor-based fuzzy algorithm is proposed to navigate a mobile robot in a 2-dimensional unknown environment filled with stationary polygonal obstacles. When the robot is at the starting point, vertices of the obstacles that are visible from the robot are scanned by the sensors and the one with the highest priority is chosen. Here, priority is an output fuzzy variable whose value is determined by fuzzy rules. The robot is then navigated from the starting point to the chosen vertex along the line segment connecting these two points. Taking the chosen vertex as the new starting point, the next navigation decision is made. The navigation process will be repeated until the goal point is reached.In implementation of fuzzy rules, the ranges of fuzzy variables are parameters to be determined. In order to evaluate the effect of different range parameters on the navigation algorithm, the total traveling distance of the robot is defined as the performance index first. Then a learning mechanism, which is similar to the simulated annealing method in the neural network theory, is presented to find the optimal range parameters which minimize the performance index. Several simulation examples are included for illustration.  相似文献   

19.
This paper presents a novel reactive collision avoidance method for mobile robots moving in dense and cluttered environments. The proposed method, entitled Tangential Gap flow (TGF), simplifies the navigation problem using a divide and conquer strategy inspired by the well-known Nearness-Diagram Navigation (ND) techniques. At each control cycle, the TGF extracts free openings surrounding the robot and identifies the suitable heading which makes the best progress towards the goal. This heading is then adjusted to avoid the risk of collision with nearby obstacles based on two concepts namely, tangential and gap flow navigation. The tangential navigation steers the robot parallel to the boundary of the closest obstacle while still emphasizing the progress towards the goal. The gap flow navigation safely and smoothly drives the robot towards the free area in between obstacles that lead to the target. The resultant trajectory is faster, shorter and less-oscillatory when compared to the ND methods. Furthermore, identifying the avoidance maneuver is extended to consider all nearby obstacle points and generate an avoidance rule applicable for all obstacle configurations. Consequently, a smoother yet much more stable behavior is achieved. The stability of the motion controller, that guides the robot towards the desired goal, is proved in the Lyapunov sense. Experimental results including a performance evaluation in very dense and complex environments demonstrate the power of the proposed approach. Additionally, a discussion and comparison with existing Nearness-Diagram Navigation variants is presented.  相似文献   

20.
This paper presents a summary of the research aimed at developing a new reliable methodology for robot navigation and obstacle avoidance. This new approach is based on the artificial potential field (APF) method, which is used extensively for obstacle avoidance. The classical APF is dependent only on the separation distance between the robot and the surrounding obstacles. The new scheme introduces a variable, which is used to determine the importance that each obstacle has on the robot's future path. The importance variable is dependent on the obstacles position, both angle and distance, with respect to the robot. Simulation results are presented demonstrating the ability of the algorithm to perform successfully in simple environments.  相似文献   

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

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