首页 | 官方网站   微博 | 高级检索  
相似文献
 共查询到20条相似文献,搜索用时 310 毫秒
1.
A neural network approach to complete coverage path planning.   总被引:10,自引:0,他引:10  
Complete coverage path planning requires the robot path to cover every part of the workspace, which is an essential issue in cleaning robots and many other robotic applications such as vacuum robots, painter robots, land mine detectors, lawn mowers, automated harvesters, and window cleaners. In this paper, a novel neural network approach is proposed for complete coverage path planning with obstacle avoidance of cleaning robots in nonstationary environments. The dynamics of each neuron in the topologically organized neural network is characterized by a shunting equation derived from Hodgkin and Huxley's (1952) membrane equation. There are only local lateral connections among neurons. The robot path is autonomously generated from the dynamic activity landscape of the neural network and the previous robot location. The proposed model algorithm is computationally simple. Simulation results show that the proposed model is capable of planning collision-free complete coverage robot paths.  相似文献   

2.
Neural network approaches to dynamic collision-free trajectorygeneration   总被引:9,自引:0,他引:9  
In this paper, dynamic collision-free trajectory generation in a nonstationary environment is studied using biologically inspired neural network approaches. The proposed neural network is topologically organized, where the dynamics of each neuron is characterized by a shunting equation or an additive equation. The state space of the neural network can be either the Cartesian workspace or the joint space of multi-joint robot manipulators. There are only local lateral connections among neurons. The real-time optimal trajectory is generated through the dynamic activity landscape of the neural network without explicitly searching over the free space nor the collision paths, without explicitly optimizing any global cost functions, without any prior knowledge of the dynamic environment, and without any learning procedures. Therefore the model algorithm is computationally efficient. The stability of the neural network system is guaranteed by the existence of a Lyapunov function candidate. In addition, this model is not very sensitive to the model parameters. Several model variations are presented and the differences are discussed. As examples, the proposed models are applied to generate collision-free trajectories for a mobile robot to solve a maze-type of problem, to avoid concave U-shaped obstacles, to track a moving target and at the same to avoid varying obstacles, and to generate a trajectory for a two-link planar robot with two targets. The effectiveness and efficiency of the proposed approaches are demonstrated through simulation and comparison studies.  相似文献   

3.
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.  相似文献   

4.
A neural dynamics based approach is proposed for real-time motion planning with obstacle avoidance of a mobile robot in a nonstationary environment. The dynamics of each neuron in the topologically organized neural network is characterized by a shunting equation or an additive equation. The real-time collision-free robot motion is planned through the dynamic neural activity landscape of the neural network without any learning procedures and without any local collision-checking procedures at each step of the robot movement. Therefore the model algorithm is computationally simple. There are only local connections among neurons. The computational complexity linearly depends on the neural network size. The stability of the proposed neural network system is proved by qualitative analysis and a Lyapunov stability theory. The effectiveness and efficiency of the proposed approach are demonstrated through simulation studies.  相似文献   

5.
Shortest path tree (SPT) computation is a critical issue in many real world problems, such as routing in networks. It is also a constrained optimization problem, which has been studied by many authors in recent years. Typically, it is solved by heuristic algorithms, such as the famous Dijkstra's algorithm, which can quickly provide a good solution in most instances. However, with the scale of problem increasing, these methods are inefficient and may consume a considerable amount of CPU time. Neural networks, which are massively parallel models, can solve this question easily. This paper presents an efficient modified continued pulse coupled neural network (MCPCNN) model for SPT computation in a large scale instance. The proposed model is topologically organized with only local lateral connections among neurons. The start neuron fires first, and then the firing event spreads out through the lateral connections among the neurons, like the propagation of a wave. Each neuron records its parent, that is, the neighbor which caused it to fire. It proves that the generated wave in the network spreads outward with travel times proportional to the connection weight between neurons. Thus, the generated path is always the global optimal shortest path from the source to all destinations. The proposed model is also applied to generate SPTs for a real given graph step by step. The effectiveness and efficiency of the proposed approach is demonstrated through simulation and comparison studies.  相似文献   

6.
This study proposes a new approach for solving the problem of autonomous movement of robots in environments that contain both static and dynamic obstacles. The purpose of this research is to provide mobile robots a collision-free trajectory within an uncertain workspace which contains both stationary and moving entities. The developed solution uses Q-learning and a neural network planner to solve path planning problems. The algorithm presented proves to be effective in navigation scenarios where global information is available. The speed of the robot can be set prior to the computation of the trajectory, which provides a great advantage in time-constrained applications. The solution is deployed in both Virtual Reality (VR) for easier visualization and safer testing activities, and on a real mobile robot for experimental validation. The algorithm is compared with Powerbot's ARNL proprietary navigation algorithm. Results show that the proposed solution has a good conversion rate computed at a satisfying speed.  相似文献   

7.
Complete coverage navigation (CCN) requires a special type of robot path planning, where the robots should pass every part of the workspace. CCN is an essential issue for cleaning robots and many other robotic applications. When robots work in unknown environments, map building is required for the robots to effectively cover the complete workspace. Real-time concurrent map building and complete coverage robot navigation are desirable for efficient performance in many applications. In this paper, a novel neural-dynamics-based approach is proposed for real-time map building and CCN of autoxnomous mobile robots in a completely unknown environment. The proposed model is compared with a triangular-cell-map-based complete coverage path planning method (Oh , 2004) that combines distance transform path planning, wall-following algorithm, and template-based technique. The proposed method does not need any templates, even in unknown environments. A local map composed of square or rectangular cells is created through the neural dynamics during the CCN with limited sensory information. From the measured sensory information, a map of the robot's immediate limited surroundings is dynamically built for the robot navigation. In addition, square and rectangular cell map representations are proposed for real-time map building and CCN. Comparison studies of the proposed approach with the triangular-cell-map-based complete coverage path planning approach show that the proposed method is capable of planning more reasonable and shorter collision-free complete coverage paths in unknown environments.   相似文献   

8.
This paper presents a novel and generic approach of path optimization for nonholonomic systems. The approach is applied to the problem of reactive navigation for nonholonomic mobile robots in highly cluttered environments. This is a collision-free initial path being given for a robot, and obstacles detected while following this path can make it in collision. The current path is iteratively deformed in order to get away from obstacles and satisfy the nonholonomic constraints. The core idea of the approach is to perturb the input functions of the system along the current path in order to modify this path, making an optimization criterion decrease.  相似文献   

9.
A modified pulse coupled neural network for shortest-path problem   总被引:1,自引:0,他引:1  
Xiaobin  Hong  Zhang 《Neurocomputing》2009,72(13-15):3028
Shortest-path problem is well-known optimization problem and has been studied by many authors in recent years. Typically it is solved by using the famous Dijkstra's algorithm, which would quickly provide a global optimization solution in most instances. However, as the problem scale increases, this method is inefficient and may consume a considerable amount of CPU time. Neural networks, which are massively parallel models, can solve this question easily. This paper presents a novel biological neural network based algorithm for the finding of the shortest path in large scale systems. The start neuron fires first, and then the firing event spreads out through the lateral connections among the neurons, like the propagation of a wave. Then the generated spiking wave spreads at a constant speed so that the time of travel between two neurons is proportional to the path length between them. The computational complexity of the algorithm is only related to the length of the shortest path, and independent of the number of existing paths in the graph. Simulation results show that the proposed method is more efficient than Dijkstra's in the larger scale systems.  相似文献   

10.
This paper presents a new sensor-based online method for generating collision-free paths for differential-drive wheeled mobile robots pursuing a moving target amidst dynamic and static obstacles. At each iteration, the set of all collision-free directions are calculated using velocity vectors of the robot relative to each obstacle, forming the Directive Circle (DC), which is the fundamental concept of our proposed method. Then, the best feasible direction close to the optimal direction to the target is selected from the DC, which prevents the robot from being trapped in local minima. Local movements of the robot are governed by the exponential stabilizing control scheme that provides a smooth motion at each step, while considering the robot’s kinematic constraints. The robot is able to catch the target at a desired orientation. Extensive simulations demonstrated the efficiency of the proposed method and its success in coping with complex and highly dynamic environments with arbitrary obstacle shapes.  相似文献   

11.
Collision-free path planning for an industrial robot in configuration space requires mapping obstacles from robot‘s workspace into its configuration space.In this paper,an approach to real-time collision-free path planning for robots in configuration space is presented.Obstacle mapping is carried out by fundamental obstacles defined in the workspace and their images in the configuration space.In order to avoid dealing with unimportant parts of the configuration space that do not affect searching a collision-free path between starting and goal configurations,we construct a free subspace by slice configuration obstacles.In this free subspace,the collision-free path is determined by the A^* algorithm.Finally,graphical simulations show the effectiveness of the proposed approach.  相似文献   

12.
Dual-arm reconfigurable robot is a new type of robot. It can adapt to different tasks by changing its different end-effector modules which have standard connectors. Especially, in fast and flexible assembly, it is very important to research the collision-free planning of dual-arm reconfigurable robots. It is to find a continuous, collision-free path in an environment containing obstacles. A new approach to the real-time collision-free motion planning of dual-arm reconfigurable robots is used in the paper. This method is based on configuration space (C-Space). The method of configuration space and the concepts reachable manifold and contact manifold are successfully applied to the collision-free motion planning of dual-arm robot. The complexity of dual-arm robots’ collision-free planning will reduce to a search in a dispersed C-Space. With this algorithm, a real-time optimum path is found. And when the start point and the end point of the dual-arm robot are specified, the algorithm will successfully get the collision-free path real time. A verification of this algorithm is made in the dual-arm horizontal articulated robot SCARATES, and the simulation and experiment ascertain that the algorithm is feasible and effective.  相似文献   

13.
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.  相似文献   

14.
移动机器人的动态路径规划及控制   总被引:2,自引:0,他引:2  
金小平  何克忠 《机器人》1990,12(6):10-17
本文阐述了两类机器人的导航方法:第一类方法是,先生成整个路径,然后进行路径跟踪控制;第二类方法是所谓的势场方法,即利用人工势场直接进行运动控制.在此基础上,我们提出了用于移动机器人系统导航的动态路径规划-控制方法.系统根据环境信息对路径进行动态的生成与控制,从而与实际环境实现了闭环,增加了对系统的稳定性和对环境的适应能力.  相似文献   

15.
The paper deals with simultaneous optimization of path planning of mobile robots and flow shop scheduling problem. The goal of the path planning problem is to determine an optimal collision-free path between a start and a target point for a mobile robot in an environment surrounded by obstacles. The objective is to minimize the path length without colliding with an obstacle. On the other hand, shop scheduling problems deal with processing a given set of jobs on a given number of machines. Each operation has an associated machine on which it has to be processed for a given length of time. The problem is to minimize the overall time demand of the whole process. In this paper, we deal with two robots carrying items between the machines. Bacterial memetic algorithm is proposed for solving this combined problem. The algorithm is verified by experimental simulations and compared to classical techniques.  相似文献   

16.
基于ACS算法的移动机器人实时全局最优路径规划   总被引:1,自引:0,他引:1  
以Ant Colony System(ACS)算法为基础提出了一种新的移动机器人实时全局最优路径规划方法.这种方法包括三个步骤:第一步是采用链接图理论建立移动机器人的自由空间模型,第二步是采用Dijkstra算法搜索出一条无碰撞次优路径,第三步是采用ACS算法对这条次优路径的位置进行优化,从而得到移动机器人的全局最优路径.计算机仿真实验的结果表明所提出的方法是有效的,可用于对移动机器人进行实时路径规划.仿真结果也证实了所提出的方法在收敛速度、解的波动性、动态收敛特征以及计算效率等方面都具有比采用精英保留遗传算法的移动机器人路径规划方法更好的性能.  相似文献   

17.
A new fuzzy-based potential field method is presented in this paper for autonomous mobile robot motion planning with dynamic environments including static or moving target and obstacles. Two fuzzy Mamdani and TSK models have been used to develop the total attractive and repulsive forces acting on the mobile robot. The attractive and repulsive forces were estimated using four inputs representing the relative position and velocity between the target and the robot in the x and y directions, in one hand, and between the obstacle and the robot, on the other hand. The proposed fuzzy potential field motion planning was investigated based on several conducted MATLAB simulation scenarios for robot motion planning within realistic dynamic environments. As it was noticed from these simulations that the proposed approach was able to provide the robot with collision-free path to softly land on the moving target and solve the local minimum problem within any stationary or dynamic environment compared to other potential field-based approaches.  相似文献   

18.
A collision-free motion planning method for mobile robots moving in 3-dimensional workspace is proposed in this article. To simplify the mathematical representation and reduce the computation complexity for collision detection, objects in the workspace are modeled as ellipsoids. By means of applying a series of coordinate and scaling transformations between the robot and the obstacles in the workspace, intersection check is reduced to test whether the point representing the robot falls outside or inside the transformed ellipsoids representing the obstacles. Therefore, the requirement of the computation time for collision detection is reduced drastically in comparison with the computational geometry method, which computes a distance function of the robot segments and the obstacles. As a measurement of the possible occurrence of collision, the collision index, which is defined by projecting conceptually an ellipsoid onto a 3-dimensional Gaussian distribution contour, plays a significant role in planning the collision-free path. The method based on reinforcement learning search using the defined collision index for collision-free motion is proposed. A simulation example is given in this article to demonstrate the efficiency of the proposed method. The result shows that the mobile robot can pass through the blocking obstacles and reach the desired final position successfully after several trials.  相似文献   

19.
邹强  丛明  刘冬  杜宇  崔瑛雪 《机器人》2018,40(6):894-902
针对移动机器人在非结构环境下的导航任务,受哺乳动物空间认知方式的启发,提出一种基于生物认知进行移动机器人路径规划的方法.结合认知地图特性,模拟海马体的情景记忆形成机理,构建封装了场景感知、状态神经元及位姿感知相关信息的情景认知地图,实现了机器人对环境的认知.基于情景认知地图,以最小事件距离为准则,提出事件序列规划算法用于实时导航过程.实验结果表明,该控制算法能使机器人根据不同任务选择最佳规划路径.  相似文献   

20.
基于改进模糊算法的移动机器人避障   总被引:1,自引:0,他引:1  
彭玉青  李木  张媛媛 《计算机应用》2015,35(8):2256-2260
为了提高移动机器人在连续障碍物环境下的避障性能,提出了一种具有速度反馈的模糊避障算法。移动机器人利用超声传感器感知周围环境,在模糊控制的基础上通过障碍物分布情况调整自身速度,进而引入优雅降级并把改进的模糊避障融入其中,增强了移动机器人的鲁棒性。实验结果表明,该方法能通过与环境交互调整机器人移动速度,控制机器人成功避障并优化避障路径,具有良好的有效性。  相似文献   

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

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

京公网安备 11010802026262号