首页 | 官方网站   微博 | 高级检索  
相似文献
 共查询到20条相似文献,搜索用时 15 毫秒
1.

Mobile robots can be applied to a wide range of problems, and the demand for these applications has risen in recent years, increasing interest in the study of mobile robotics. Many studies have examined the path planning problem, one of the most important issues in mobile robotics. However, the grid paths found by traditional planners are often not the true shortest paths or are not smooth because their potential headings are artificially constrained to multiples of 45 degrees. These paths are unfit for application to mobile robots because the high number of heading changes increases the energy required to move the mobile robot. Some studies have proposed a post-processing step to smooth the grid path. However, in this case, the post-smoothed path may not necessarily find the true shortest path because the post-smoothed path is still constrained to headings of multiples of 45 degrees. This study attempts to develop a global path planner that can directly find an optimal and smoother path without post-processing to smooth the path. We propose a heterogeneous-ants-based path planner (HAB-PP) as a global path planner to overcome the shortcomings mentioned above. The HAB-PP was created by modifying and optimizing the global path planning procedure from the ant colony optimization (ACO) algorithm. The proposed algorithm differs from the traditional ACO path planning algorithm in three respects: modified transition probability function for moving ants, modified pheromone update rule, and heterogeneous ants. The simulation results demonstrate the effectiveness of the HAB-PP.

  相似文献   

2.
Creating collision-free trajectories for mobile robots, known as the path planning problem, is considered to be one of the basic problems in robotics. In case of multiple robotic systems, the complexity of such systems increases proportionally with the number of robots, due to the fact that all robots must act as one unit to complete one composite task, such as retaining a specific formation. The proposed path planner employs a combination of Cellular Automata (CA) and Ant Colony Optimization (ACO) techniques in order to create collision-free trajectories for every robot of a team while their formation is kept immutable. The method reacts with obstacle distribution changes and therefore can be used in dynamical or unknown environments, without the need of a priori knowledge of the space. The team is divided into subgroups and all the desired pathways are created with the combined use of a CA path planner and an ACO algorithm. In case of lack of pheromones, paths are created using the CA path planner. Compared to other methods, the proposed method can create accurate collision-free paths in real time with low complexity while the implemented system is completely autonomous. A simulation environment was created to test the effectiveness of the applied CA rules and ACO principles. Moreover, the proposed method was implemented in a system using a real world simulation environment, called Webots. The CA and ACO combined algorithm was applied to a team of multiple simulated robots without the interference of a central control. Simulation and experimental results indicate that accurate collision free paths could be created with low complexity, confirming the robustness of the method.  相似文献   

3.
In an autonomous multi-mobile robot environment, path planning and collision avoidance are important functions used to perform a given task collaboratively and cooperatively. This study considers these important and challenging problems. The proposed approach is based on a potential field method and fuzzy logic system. First, a global path planner selects the paths of the robots that minimize the potential value from each robot to its own target using a potential field. Then, a local path planner modifies the path and orientation from the global planner to avoid collisions with static and dynamic obstacles using a fuzzy logic system. In this paper, each robot independently selects its destination and considers other robots as dynamic obstacles, and there is no need to predict the motion of obstacles. This process continues until the corresponding target of each robot is found. To test this method, an autonomous multi-mobile robot simulator (AMMRS) is developed, and both simulation-based and experimental results are given. The results show that the path planning and collision avoidance strategies are effective and useful for multi-mobile robot systems.  相似文献   

4.
张金学  李媛媛  掌明 《计算机仿真》2012,29(1):176-179,205
在自主移动机器人的许多应用中,路径规划技术顺序地设置一套分散的路径点来引导机器人以最短的时间从起始位置到达目标点。针对移动机器人路径规划问题,提出了一种非完整型机器人路径规划技术,该技术采用基本原子操纵方法来解决车型机器人路径规划问题,并采用平滑路径规划方法来产生更多的连续路径用以解决基本原子操纵技术在做路径规划时具有很不连续的缺点从而为机器人获得最优路径。仿真结果证明了该方法的有效性和实用性。  相似文献   

5.
Applying a path planner based on RRT to cooperative multirobot box-pushing   总被引:1,自引:0,他引:1  
Considering robot systems in the real world, a multirobot system where multiple robots work simultaneously without colliding with each other is more practical than a single-robot system where only one robot works. Therefore, solving the path-planning problem in a multirobot system is very important. In this study, we developed a path-planner based on the rapidly exploring random tree (RRT), which is a data structure and algorithm designed for efficiently searching for multirobot box-pushing, and made experiments in real environments. A path planner must construct a plan which avoids the robot colliding with obstacles or with other robots. Moreover, in some cases, a robot must collaborate with other robots to transport the box without colliding with any obstacles. Our proposed path planner constructs a box-transportation plan and the path plans of each robot bearing the above considerations in mind. Experimental results showed that our proposed planner can construct a multirobot box-pushing plan without colliding with obstacles, and that the robots can execute tasks according to the plan in real environments. We also checked that multiple robots can perform problem tasks when only one robot could not transport the box to the goal. This work was presented in part at the 13th International Symposium on Articifial Life and Robotics, Oita, Japan, January 31–February 2, 2008  相似文献   

6.
This paper presents a real-time path planning algorithm that guarantees probabilistic feasibility for autonomous robots with uncertain dynamics operating amidst one or more dynamic obstacles with uncertain motion patterns. Planning safe trajectories under such conditions requires both accurate prediction and proper integration of future obstacle behavior within the planner. Given that available observation data is limited, the motion model must provide generalizable predictions that satisfy dynamic and environmental constraints, a limitation of existing approaches. This work presents a novel solution, named RR-GP, which builds a learned motion pattern model by combining the flexibility of Gaussian processes (GP) with the efficiency of RRT-Reach, a sampling-based reachability computation. Obstacle trajectory GP predictions are conditioned on dynamically feasible paths identified from the reachability analysis, yielding more accurate predictions of future behavior. RR-GP predictions are integrated with a robust path planner, using chance-constrained RRT, to identify probabilistically feasible paths. Theoretical guarantees of probabilistic feasibility are shown for linear systems under Gaussian uncertainty; approximations for nonlinear dynamics and/or non-Gaussian uncertainty are also presented. Simulations demonstrate that, with this planner, an autonomous vehicle can safely navigate a complex environment in real-time while significantly reducing the risk of collisions with dynamic obstacles.  相似文献   

7.
Failures in mobile robot navigation are often caused by errors in localizing the robot relative to its environment. This paper explores the idea that these errors can be considerably reduced by planning paths taking the robot through positions where pertinent features of the environment can be sensed. It introduces the notion of a “sensory uncertainty field” (SUF). For every possible robot configuration q, this field estimates the distribution of possible errors in the robot configuration that would be computed by a localization function matching the data given by the sensors against an environment model, if the robot was at q. A planner is proposed which uses a precomputed SUF to generate paths that minimize expected errors or any other criterion combining, say, path length and errors. This paper describes in detail the computation of a specific SUF for a mobile robot equipped with a classical line-striping camera/laser range sensor. It presents an implemented SUF-based motion planner for this robot and shows paths generated by this planner. Navigation experiments were conducted with mobile robots using paths generated by the SUF-based planner and other paths. The former paths were tracked with greater precision than the others. The final section of the paper discusses additional research issues related to SUF-based planning  相似文献   

8.
This paper presents a nonholonomic path planning method, aiming at taking into considerations of curvature constraint, length minimization, and computational demand, for car-like mobile robot based on cubic spirals. The generated path is made up of at most five segments: at most two maximal-curvature cubic spiral segments with zero curvature at both ends in connection with up to three straight line segments. A numerically efficient process is presented to generate a Cartesian shortest path among the family of paths considered for a given pair of start and destination configurations. Our approach is resorted to minimization via linear programming over the sum of length of each path segment of paths synthesized based on minimal locomotion cubic spirals linking start and destination orientations through a selected intermediate orientation. The potential intermediate configurations are not necessarily selected from the symmetric mean circle for non-parallel start and destination orientations. The novelty of the presented path generation method based on cubic spirals is: (i) Practical: the implementation is straightforward so that the generation of feasible paths in an environment free of obstacles is efficient in a few milliseconds; (ii) Flexible: it lends itself to various generalizations: readily applicable to mobile robots capable of forward and backward motion and Dubins’ car (i.e. car with only forward driving capability); well adapted to the incorporation of other constraints like wall-collision avoidance encountered in robot soccer games; straightforward extension to planning a path connecting an ordered sequence of target configurations in simple obstructed environment.  相似文献   

9.
Reinforcement learning (RL) is a popular method for solving the path planning problem of autonomous mobile robots in unknown environments. However, the primary difficulty faced by learning robots using the RL method is that they learn too slowly in obstacle-dense environments. To more efficiently solve the path planning problem of autonomous mobile robots in such environments, this paper presents a novel approach in which the robot’s learning process is divided into two phases. The first one is to accelerate the learning process for obtaining an optimal policy by developing the well-known Dyna-Q algorithm that trains the robot in learning actions for avoiding obstacles when following the vector direction. In this phase, the robot’s position is represented as a uniform grid. At each time step, the robot performs an action to move to one of its eight adjacent cells, so the path obtained from the optimal policy may be longer than the true shortest path. The second one is to train the robot in learning a collision-free smooth path for decreasing the number of the heading changes of the robot. The simulation results show that the proposed approach is efficient for the path planning problem of autonomous mobile robots in unknown environments with dense obstacles.  相似文献   

10.
针对目前局部路径规划算法只适用于单车体机器人的问题,提出了一种针对拖车式移动机器人的动态窗口法。首先,利用多车体结构的路径跟踪方程实现对拖车式移动机器人的运动控制;然后,利用评价函数同时对牵引车和拖车进行评价并根据权重相加;最后,针对拖车结构特性,添加了运动过程中牵引车与拖车的夹角约束,保证运动轨迹的稳定性。仿真实验表明:拖车式移动机器人的运动控制可满足收敛性,同时所提算法实现了拖车式移动机器人局部路径规划的任务,且在运动过程中夹角变化均未超出限制。该研究对拖车式移动机器人的自主导航有极大的参考价值。  相似文献   

11.
针对多移动机器人聚集的路径规划与控制问题,本文提出了基于改进快速行进平方法的路径规划策略.首先,运用分段函数改进了速度图,实现了更安全、更高效的路径规划,可以将快速行进网格地图上的速度映射到真实机器人速度上,并且减少传统快速行进平方法在回溯路径过程中产生的冗余路径;接着,针对多移动机器人聚集过程总能耗最小、聚集点附近空间最大、聚集队形约束下的聚集过程总能耗最小三种任务需求,分析设计不同的目标函数,给出多移动机器人的聚集点和对应规划路径,展示本文方法的有效性以及在不同场景下的适用性.最后,在车辆动力学模型基础上,使用模型预测控制以改进后的快速行进网格地图上的速度作为机器人参考速度进行了轨迹跟踪仿真实验,实现结果显示跟踪误差减小,验证了本文改进速度场的有效性,可适用于真实环境下多移动机器人聚集路径规划与控制.  相似文献   

12.
A Cellular Automaton-based technique suitable for solving the path planning problem in a distributed robot team is outlined. Real-time path planning is a challenging task that has many applications in the fields of artificial intelligence, moving robots, virtual reality, and agent behavior simulation. The problem refers to finding a collision-free path for autonomous robots between two specified positions in a configuration area. The complexity of the problem increases in systems of multiple robots. More specifically, some distance should be covered by each robot in an unknown environment, avoiding obstacles found on its route to the destination. On the other hand, all robots must adjust their actions in order to keep their initial team formation immutable. Two different formations were tested in order to study the efficiency and the flexibility of the proposed method. Using different formations, the proposed technique could find applications to image processing tasks, swarm intelligence, etc. Furthermore, the presented Cellular Automaton (CA) method was implemented and tested in a real system using three autonomous mobile minirobots called E-pucks. Experimental results indicate that accurate collision-free paths could be created with low computational cost. Additionally, cooperation tasks could be achieved using minimal hardware resources, even in systems with low-cost robots.  相似文献   

13.
This paper addresses the path planning problem for autonomous mobile robots operating in an unknown environment with obstacles. Paths are formed based on third-order Bezier splines and, then, are corrected on the move as a robot detects obstacles with its onboard sensors. During this correction, the initial path between two reference points is divided into two segments (described by Bezier splines) in such a way as to allow the robot to move at a safe distance from a detected obstacle along a smooth resultant trajectory. In this case, the use of smooth paths ensures a high levels of accuracy and velocity of mobile robots during their operation.  相似文献   

14.
This paper presents a hybrid path planning algorithm for the design of autonomous vehicles such as mobile robots. The hybrid planner is based on Potential Field method and Voronoi Diagram approach and is represented with the ability of concurrent navigation and map building. The system controller (Look-ahead Control) with the Potential Field method guarantees the robot generate a smooth and safe path to an expected position. The Voronoi Diagram approach is adopted for the purpose of helping the mobile robot to avoid being trapped by concave environment while exploring a route to a target. This approach allows the mobile robot to accomplish an autonomous navigation task with only an essential exploration between a start and goal position. Based on the existing topological map the mobile robot is able to construct sub-goals between predefined start and goal, and follows a smooth and safe trajectory in a flexible manner when stationary and moving obstacles co-exist.  相似文献   

15.
In this paper, we study the problem of finding a collision-free path for a mobile robot which possesses manipulators. The task of the robot is to carry a polygonal object from a starting point to a destination point in a possibly culttered environment. In most of the existing research on robot path planning, a mobile robot is approximated by a fixed shape, i.e., a circle or a polygon. In our task planner, the robot is allowed to change configurations for avoiding collision. This path planner operates using two algorithms: the collision-free feasible configuration finding algorithm and the collision-free path finding algorithm. The collision-free feasible configuration finding algorithm finds all collision-free feasible configurations for the robot when the position of the carried object is given. The collision-free path finding algorithm generates some candidate paths first and then uses a graph search method to find a collision-free path from all the collision-free feasible configurations along the candidate paths. The proposed algorithms can deal with a cluttered environment and is guaranteed to find a solution if one exists.  相似文献   

16.
Humans have a remarkable ability to navigate using only vision, but mobile robots have not been nearly as successful. We propose a new approach to vision-guided local navigation, based upon a model of human navigation. Our approach uses the relative headings to the goal and to obstacles, the distance to the goal, and the angular width of obstacles, to compute a potential field over the robot heading. This potential field controls the angular acceleration of the robot, steering it towards the goal and away from obstacles. Because the steering is controlled directly, this approach is well suited to local navigation for nonholonomic robots. The resulting paths are smooth and have continuous curvature. This approach is designed to be used with single-camera vision without depth information but can also be used with other kinds of sensors. We have implemented and tested our method on a differential-drive robot and present our experimental results.  相似文献   

17.
室外智能移动机器人的发展及其关键技术研究   总被引:24,自引:5,他引:19  
欧青立  何克忠 《机器人》2000,22(6):519-526
室外智能移动机器人有着广泛的应用前景,是机器人研究中的热点之一.本文分析 了在室外移动机器人发展中有着代表意义的几个典型系统,进而论述了室外移动机器人研究 中的若干关键技术的研究现状及发展水平.这些关键技术包括移动机器人的控制体系结构、 机器人视觉信息的实时处理技术、车体的定位系统、多传感器信息的集成与融合技术以及路 径规划技术与车体控制技术等.  相似文献   

18.
《Advanced Robotics》2013,27(8-9):989-1012
Abstract

This paper proposes a method to efficiently abstract the traversable regions of a bounded two-dimensional environment using the probabilistic roadmap (PRM) to plan the path for a mobile robot. The proposed method uses centroidal Voronoi tessellation to autonomously rearrange the positions of initially randomly generated nodes. The PRM using the rearranged nodes covers most of the traversable regions in the environment and regularly divides them. The rearranged roadmap reduces the search space of a graph search algorithm and helps to promptly answer arbitrary queries in the environment. The mobile robot path planner using the proposed rearranged roadmap was integrated with a local planner that considers the kinematic properties of a mobile robot, and the efficiency and the safety of the paths were verified by simulation.  相似文献   

19.
We introduce a novel strategy of designing a chaotic coverage path planner for the mobile robot based on the Chebyshev map for achieving special missions. The designed chaotic path planner consists of a two-dimensional Chebyshev map which is constructed by two one-dimensional Chebyshev maps. The performance of the time sequences which are generated by the planner is improved by arcsine transformation to enhance the chaotic characteristics and uniform distribution. Then the coverage rate and randomness for achieving the special missions of the robot are enhanced. The chaotic Chebyshev system is mapped into the feasible region of the robot workplace by affine transformation. Then a universal algorithm of coverage path planning is designed for environments with obstacles. Simulation results show that the constructed chaotic path planner can avoid detection of the obstacles and the workplace boundaries, and runs safely in the feasible areas. The designed strategy is able to satisfy the requirements of randomness, coverage, and high efficiency for special missions.  相似文献   

20.
基于KQML语言的多自主移动机器人仿真系统   总被引:4,自引:0,他引:4  
刘淑华  田彦涛 《机器人》2005,27(4):350-353
用JAVA语言开发了栅格环境下的多自主移动机器人仿真系统,通过KQML语言通信模拟了多个自主的移动机器人,机器人的自主性主要体现在自主感知环境和自主进行路径规划、任务执行和安全导航等工作.该仿真系统具有平台无关性、地图无关性、算法无关性以及机器人配置的无关性,为多自主机器人系统的研究提供了一个可借鉴的平台.  相似文献   

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

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

京公网安备 11010802026262号