Adaptive genetic algorithm A SA GA, a novel algorithm, which can dynamically modify the parameters of Genetic Algorithms in terms of simulated annealing mechanism, is proposed for path planning of loosely coordinated ...Adaptive genetic algorithm A SA GA, a novel algorithm, which can dynamically modify the parameters of Genetic Algorithms in terms of simulated annealing mechanism, is proposed for path planning of loosely coordinated multi robot manipulators. Over the task space of a multi robot, a strategy of decoupled planning is also applied to the evolutionary process, which enables a multi robot to avoid falling into deadlock and calculating of composite C space. Finally, two representative tests are given to validate A SA GA and the strategy of decoupled planning.展开更多
A novel approach for collision-free path planning of a multiple degree-of-freedom (DOF) articulated robot in a complex environment is proposed. Firstly, based on visual neighbor point (VNP), a numerical artificial...A novel approach for collision-free path planning of a multiple degree-of-freedom (DOF) articulated robot in a complex environment is proposed. Firstly, based on visual neighbor point (VNP), a numerical artificial potential field is constructed in Cartesian space, which provides the heuristic information, effective distance to the goal and the motion direction for the motion of the robot joints. Secondly, a genetic algorithm, combined with the heuristic rules, is used in joint space to determine a series of contiguous configurations piecewise from initial configuration until the goal configuration is attained. A simulation shows that the method can not only handle issues on path planning of the articulated robots in environment with complex obstacles, but also improve the efficiency and quality of path planning.展开更多
Mobile robot global path planning in a static environment is an important problem. The paper proposes a method of global path planning based on neural network and genetic algorithm. We constructed the neural network m...Mobile robot global path planning in a static environment is an important problem. The paper proposes a method of global path planning based on neural network and genetic algorithm. We constructed the neural network model of environmental information in the workspace for a robot and used this model to establish the relationship between a collision avoidance path and the output of the model. Then the two-dimensional coding for the path via-points was converted to one-dimensional one and the fitness of both the collision avoidance path and the shortest distance are integrated into a fitness function. The simulation results showed that the proposed method is correct and effective.展开更多
Presents a strategy for soccer robot path planning using genetic algorithms for which, real number coding method is used, to overcome the defects of binary coding method, and the double crossover operation adopted, to...Presents a strategy for soccer robot path planning using genetic algorithms for which, real number coding method is used, to overcome the defects of binary coding method, and the double crossover operation adopted, to avoid the common defect of early convergence and converge faster than the standard genetic algorithms concludes from simulation results that the method is effective for robot path planning.展开更多
A novel method of global optimal path planning for mobile robot was proposed based on the improved Dijkstra algorithm and ant system algorithm. This method includes three steps: the first step is adopting the MAKLINK ...A novel method of global optimal path planning for mobile robot was proposed based on the improved Dijkstra algorithm and ant system algorithm. This method includes three steps: the first step is adopting the MAKLINK graph theory to establish the free space model of the mobile robot, the second step is adopting the improved Dijkstra algorithm to find out a sub-optimal collision-free path, and the third step is using the ant system algorithm to adjust and optimize the location of the sub-optimal path so as to generate the global optimal path for the mobile robot. The computer simulation experiment was carried out and the results show that this method is correct and effective. The comparison of the results confirms that the proposed method is better than the hybrid genetic algorithm in the global optimal path planning.展开更多
In this paper, an underwater vehicle was modeled with six dimensional nonlinear equations of motion, controlled by DC motors in all degrees of freedom. Near-optimal trajectories in an energetic environment for underwa...In this paper, an underwater vehicle was modeled with six dimensional nonlinear equations of motion, controlled by DC motors in all degrees of freedom. Near-optimal trajectories in an energetic environment for underwater vehicles were computed using a nnmerical solution of a nonlinear optimal control problem (NOCP). An energy performance index as a cost function, which should be minimized, was defmed. The resulting problem was a two-point boundary value problem (TPBVP). A genetic algorithm (GA), particle swarm optimization (PSO), and ant colony optimization (ACO) algorithms were applied to solve the resulting TPBVP. Applying an Euler-Lagrange equation to the NOCP, a conjugate gradient penalty method was also adopted to solve the TPBVP. The problem of energetic environments, involving some energy sources, was discussed. Some near-optimal paths were found using a GA, PSO, and ACO algorithms. Finally, the problem of collision avoidance in an energetic environment was also taken into account.展开更多
Based on the modeling of robot working environment, the shortest distance matrix between points is solved by Floyd algorithm. With the objective of minimizing the sum of the fixed cost of robot and the cost of robot o...Based on the modeling of robot working environment, the shortest distance matrix between points is solved by Floyd algorithm. With the objective of minimizing the sum of the fixed cost of robot and the cost of robot operation, an integer programming model is established and a genetic algorithm for solving the model is designed. In order to make coordination to accomplish their respective tasks for each robot with high efficiency, this paper uses natural number encoding way. The objective function is based on penalty term constructed with the total number of collisions in the running path of robots. The fitness function is constructed by using the objective function with penalty term. Based on elitist retention strategy, a genetic algorithm with collision detection is designed. Using this algorithm for task allocation and path planning of multi-robot, it can effectively avoid or reduce the number of collisions in the process of multi-robot performing tasks. Finally, an example is used to validate the method.展开更多
In this paper, a hybrid method based on rough sets and genetic algorithms, is proposed to improve the speed of robot path planning. Decision rules are obtained using rough set theory. A series of available paths are p...In this paper, a hybrid method based on rough sets and genetic algorithms, is proposed to improve the speed of robot path planning. Decision rules are obtained using rough set theory. A series of available paths are produced by training obtained minimal decision rules. Path populations are optimised by using genetic algorithms until the best path is obtained. Experiment results show that this hybrid method is capable of improving robot path planning speed.展开更多
An Approximate Voronoi Boundary Network is constructed as the environmental model by way of enlar-ging the obstacle raster. The connectivity of the path network under complex environment is ensured through build-ing t...An Approximate Voronoi Boundary Network is constructed as the environmental model by way of enlar-ging the obstacle raster. The connectivity of the path network under complex environment is ensured through build-ing the second order Approximate Voronoi Boundary Network after adding virtual obstacles at joint-close grids. Thismethod embodies the network structure of the free area of environment with less nodes, so the complexity of pathplanning problem is reduced largely. An optimized path for mobile robot under complex environment is obtainedthrough the Genetic Algorithm based on the elitist rule and re-optimized by using the path-tightening method. Sincethe elitist one has the only authority of crossover, the management of one group becomes simple, which makes forobtaining the optimized path quickly. The Approximate Voronoi Boundary Network has a good tolerance to the im-precise a priori information and the noises of sensors under complex environment. Especially it is robust in dealingwith the local or partial changes, so a small quantity of dynamic obstacles is difficult to alter the overall character ofits connectivity, which means that it can also be adopted in dynamic environment by fusing the local path planning.展开更多
Disassembly sequence planning (DSP) plays a significant role in maintenance planning of the aircraft. It is used during the design stage for the analysis of maintainability of the aircraft. To solve product disassem...Disassembly sequence planning (DSP) plays a significant role in maintenance planning of the aircraft. It is used during the design stage for the analysis of maintainability of the aircraft. To solve product disassembly sequence planning problems efficiently, a product disassembly hybrid graph model, which describes the connection, non-connection and precedence relationships between the product parts, is established based on the characteristic of disassembly. Farther, the optimization model is provided to optimize disassembly sequence. And the solution methodology based on the genetic/simulated annealing algorithm with binaxy-tree algorithm is given. Finally, an example is analyzed in detail, and the result shows that the model is correct and efficient.展开更多
In recent years,the crop protection unmanned aerial vehicle(UAV)has been raised great attention around the world due to the advantages of more efficient operation and lower requirement of special landing airport.Howev...In recent years,the crop protection unmanned aerial vehicle(UAV)has been raised great attention around the world due to the advantages of more efficient operation and lower requirement of special landing airport.However,there are few researches on obstacle-avoiding path planning for crop protection UAV.In this study,an improved Dubins curve algorithm was proposed for path planning with multiple obstacle constraints.First,according to the flight parameters of UAV and the types of obstacles in the field,the obstacle circle model and the small obstacle model were established.Second,after selecting the appropriate Dubins curve to generate the obstacle-avoiding path for multiple obstacles,the genetic algorithm(GA)was used to search the optimal obstacle-avoiding path.Third,for turning in the path planning,a strategy considering the size of the spray width and the UAV’s minimum turning radius was presented,which could decrease the speed change times.The results showed that the proposed algorithm can decrease the area of overlap and skip to 205.1%,while the path length increased by only 1.6%in comparison with the traditional Dubins obstacle-avoiding algorithm under the same conditions.With the increase of obstacle radius,the area of overlap and skip reduced effectively with no significant increase in path length.Therefore,the algorithm can efficiently improve the validity of path planning with multiple obstacle constraints and ensure the safety of flight.展开更多
蚁群算法拥有良好的全局性、自组织性、鲁棒性,但传统蚁群算法存在许多不足之处。为此,针对算法在路径规划问题中的缺陷,在传统蚁群算法的状态转移公式中,引入目标点距离因素和引导素,加快算法收敛性和改善局部最优缺陷。在带时间窗的...蚁群算法拥有良好的全局性、自组织性、鲁棒性,但传统蚁群算法存在许多不足之处。为此,针对算法在路径规划问题中的缺陷,在传统蚁群算法的状态转移公式中,引入目标点距离因素和引导素,加快算法收敛性和改善局部最优缺陷。在带时间窗的车辆路径问题(vehicle routing problem with time windows,VRPTW)上,融合蚁群算法和遗传算法,并将顾客时间窗宽度以及机器人等待时间加入蚁群算法状态转移公式中,以及将蚁群算法的解作为遗传算法的初始种群,提高遗传算法的初始解质量,然后进行编码,设置违反时间窗约束和载重量的惩罚函数和适应度函数,在传统遗传算法的交叉、变异操作后加入了破坏-修复基因的操作来优化每一代新解的质量,在Solomon Benchmark算例上进行仿真,对比算法改进前后的最优解,验证算法可行性。最后在餐厅送餐问题中把带有障碍物的仿真环境路径规划问题和VRPTW问题结合,使用改进后的算法解决餐厅环境下送餐机器人对顾客服务配送问题。展开更多
文摘Adaptive genetic algorithm A SA GA, a novel algorithm, which can dynamically modify the parameters of Genetic Algorithms in terms of simulated annealing mechanism, is proposed for path planning of loosely coordinated multi robot manipulators. Over the task space of a multi robot, a strategy of decoupled planning is also applied to the evolutionary process, which enables a multi robot to avoid falling into deadlock and calculating of composite C space. Finally, two representative tests are given to validate A SA GA and the strategy of decoupled planning.
文摘A novel approach for collision-free path planning of a multiple degree-of-freedom (DOF) articulated robot in a complex environment is proposed. Firstly, based on visual neighbor point (VNP), a numerical artificial potential field is constructed in Cartesian space, which provides the heuristic information, effective distance to the goal and the motion direction for the motion of the robot joints. Secondly, a genetic algorithm, combined with the heuristic rules, is used in joint space to determine a series of contiguous configurations piecewise from initial configuration until the goal configuration is attained. A simulation shows that the method can not only handle issues on path planning of the articulated robots in environment with complex obstacles, but also improve the efficiency and quality of path planning.
基金Project supported by the National Natural Science Foundation of China (No. 60105003) and the Natural Science Foundation of Zhejiang Province (No. 600025), China
文摘Mobile robot global path planning in a static environment is an important problem. The paper proposes a method of global path planning based on neural network and genetic algorithm. We constructed the neural network model of environmental information in the workspace for a robot and used this model to establish the relationship between a collision avoidance path and the output of the model. Then the two-dimensional coding for the path via-points was converted to one-dimensional one and the fitness of both the collision avoidance path and the shortest distance are integrated into a fitness function. The simulation results showed that the proposed method is correct and effective.
文摘Presents a strategy for soccer robot path planning using genetic algorithms for which, real number coding method is used, to overcome the defects of binary coding method, and the double crossover operation adopted, to avoid the common defect of early convergence and converge faster than the standard genetic algorithms concludes from simulation results that the method is effective for robot path planning.
文摘A novel method of global optimal path planning for mobile robot was proposed based on the improved Dijkstra algorithm and ant system algorithm. This method includes three steps: the first step is adopting the MAKLINK graph theory to establish the free space model of the mobile robot, the second step is adopting the improved Dijkstra algorithm to find out a sub-optimal collision-free path, and the third step is using the ant system algorithm to adjust and optimize the location of the sub-optimal path so as to generate the global optimal path for the mobile robot. The computer simulation experiment was carried out and the results show that this method is correct and effective. The comparison of the results confirms that the proposed method is better than the hybrid genetic algorithm in the global optimal path planning.
文摘In this paper, an underwater vehicle was modeled with six dimensional nonlinear equations of motion, controlled by DC motors in all degrees of freedom. Near-optimal trajectories in an energetic environment for underwater vehicles were computed using a nnmerical solution of a nonlinear optimal control problem (NOCP). An energy performance index as a cost function, which should be minimized, was defmed. The resulting problem was a two-point boundary value problem (TPBVP). A genetic algorithm (GA), particle swarm optimization (PSO), and ant colony optimization (ACO) algorithms were applied to solve the resulting TPBVP. Applying an Euler-Lagrange equation to the NOCP, a conjugate gradient penalty method was also adopted to solve the TPBVP. The problem of energetic environments, involving some energy sources, was discussed. Some near-optimal paths were found using a GA, PSO, and ACO algorithms. Finally, the problem of collision avoidance in an energetic environment was also taken into account.
基金Supported by National Natural Science Foundation of P.R.China(50275150)National Research Foundation for the Doctoral Program of Higher Education of P.R.China(20040533035)
文摘Based on the modeling of robot working environment, the shortest distance matrix between points is solved by Floyd algorithm. With the objective of minimizing the sum of the fixed cost of robot and the cost of robot operation, an integer programming model is established and a genetic algorithm for solving the model is designed. In order to make coordination to accomplish their respective tasks for each robot with high efficiency, this paper uses natural number encoding way. The objective function is based on penalty term constructed with the total number of collisions in the running path of robots. The fitness function is constructed by using the objective function with penalty term. Based on elitist retention strategy, a genetic algorithm with collision detection is designed. Using this algorithm for task allocation and path planning of multi-robot, it can effectively avoid or reduce the number of collisions in the process of multi-robot performing tasks. Finally, an example is used to validate the method.
基金This project is partially supported by Science Research Funding from the Education Department of Liaoning Province, China (No.J9906065).
文摘In this paper, a hybrid method based on rough sets and genetic algorithms, is proposed to improve the speed of robot path planning. Decision rules are obtained using rough set theory. A series of available paths are produced by training obtained minimal decision rules. Path populations are optimised by using genetic algorithms until the best path is obtained. Experiment results show that this hybrid method is capable of improving robot path planning speed.
基金Project (60234030) supported by the National Natural Science Foundation of China
文摘An Approximate Voronoi Boundary Network is constructed as the environmental model by way of enlar-ging the obstacle raster. The connectivity of the path network under complex environment is ensured through build-ing the second order Approximate Voronoi Boundary Network after adding virtual obstacles at joint-close grids. Thismethod embodies the network structure of the free area of environment with less nodes, so the complexity of pathplanning problem is reduced largely. An optimized path for mobile robot under complex environment is obtainedthrough the Genetic Algorithm based on the elitist rule and re-optimized by using the path-tightening method. Sincethe elitist one has the only authority of crossover, the management of one group becomes simple, which makes forobtaining the optimized path quickly. The Approximate Voronoi Boundary Network has a good tolerance to the im-precise a priori information and the noises of sensors under complex environment. Especially it is robust in dealingwith the local or partial changes, so a small quantity of dynamic obstacles is difficult to alter the overall character ofits connectivity, which means that it can also be adopted in dynamic environment by fusing the local path planning.
基金supported by the National High Technology Research and Development Program of China(2006AA04Z427).
文摘Disassembly sequence planning (DSP) plays a significant role in maintenance planning of the aircraft. It is used during the design stage for the analysis of maintainability of the aircraft. To solve product disassembly sequence planning problems efficiently, a product disassembly hybrid graph model, which describes the connection, non-connection and precedence relationships between the product parts, is established based on the characteristic of disassembly. Farther, the optimization model is provided to optimize disassembly sequence. And the solution methodology based on the genetic/simulated annealing algorithm with binaxy-tree algorithm is given. Finally, an example is analyzed in detail, and the result shows that the model is correct and efficient.
基金This research was supported by Natural Science Foundation of Heilongjiang Province of China(No.C2018023)China Postdoctoral Science Foundation(No.2015M580254,No.2017T100221)+1 种基金Heilongjiang Postdoctoral Science Foundation(No.LBH-Z15011)The authors would like to thank the anonymous reviewers for their helpful suggestions,which greatly improved the paper.
文摘In recent years,the crop protection unmanned aerial vehicle(UAV)has been raised great attention around the world due to the advantages of more efficient operation and lower requirement of special landing airport.However,there are few researches on obstacle-avoiding path planning for crop protection UAV.In this study,an improved Dubins curve algorithm was proposed for path planning with multiple obstacle constraints.First,according to the flight parameters of UAV and the types of obstacles in the field,the obstacle circle model and the small obstacle model were established.Second,after selecting the appropriate Dubins curve to generate the obstacle-avoiding path for multiple obstacles,the genetic algorithm(GA)was used to search the optimal obstacle-avoiding path.Third,for turning in the path planning,a strategy considering the size of the spray width and the UAV’s minimum turning radius was presented,which could decrease the speed change times.The results showed that the proposed algorithm can decrease the area of overlap and skip to 205.1%,while the path length increased by only 1.6%in comparison with the traditional Dubins obstacle-avoiding algorithm under the same conditions.With the increase of obstacle radius,the area of overlap and skip reduced effectively with no significant increase in path length.Therefore,the algorithm can efficiently improve the validity of path planning with multiple obstacle constraints and ensure the safety of flight.
文摘蚁群算法拥有良好的全局性、自组织性、鲁棒性,但传统蚁群算法存在许多不足之处。为此,针对算法在路径规划问题中的缺陷,在传统蚁群算法的状态转移公式中,引入目标点距离因素和引导素,加快算法收敛性和改善局部最优缺陷。在带时间窗的车辆路径问题(vehicle routing problem with time windows,VRPTW)上,融合蚁群算法和遗传算法,并将顾客时间窗宽度以及机器人等待时间加入蚁群算法状态转移公式中,以及将蚁群算法的解作为遗传算法的初始种群,提高遗传算法的初始解质量,然后进行编码,设置违反时间窗约束和载重量的惩罚函数和适应度函数,在传统遗传算法的交叉、变异操作后加入了破坏-修复基因的操作来优化每一代新解的质量,在Solomon Benchmark算例上进行仿真,对比算法改进前后的最优解,验证算法可行性。最后在餐厅送餐问题中把带有障碍物的仿真环境路径规划问题和VRPTW问题结合,使用改进后的算法解决餐厅环境下送餐机器人对顾客服务配送问题。