Aiming at the practical application of Unmanned Underwater Vehicle(UUV)in underwater combat,this paper proposes a battlefield ambush scene with UUV considering ocean current.Firstly,by establishing these mathematical ...Aiming at the practical application of Unmanned Underwater Vehicle(UUV)in underwater combat,this paper proposes a battlefield ambush scene with UUV considering ocean current.Firstly,by establishing these mathematical models of ocean current environment,target movement,and sonar detection,the probability calculation methods of single UUV searching target and multiple UUV cooperatively searching target are given respectively.Then,based on the Hybrid Quantum-behaved Particle Swarm Optimization(HQPSO)algorithm,the path with the highest target search probability is found.Finally,through simulation calculations,the influence of different UUV parameters and target parameters on the target search probability is analyzed,and the minimum number of UUVs that need to be deployed to complete the ambush task is demonstrated,and the optimal search path scheme is obtained.The method proposed in this paper provides a theoretical basis for the practical application of UUV in the future combat.展开更多
Existing mobile robots mostly use graph search algorithms for path planning,which suffer from relatively low planning efficiency owing to high redundancy and large computational complexity.Due to the limitations of th...Existing mobile robots mostly use graph search algorithms for path planning,which suffer from relatively low planning efficiency owing to high redundancy and large computational complexity.Due to the limitations of the neighborhood search strategy,the robots could hardly obtain the most optimal global path.A global path planning algorithm,denoted as EDG*,is proposed by expanding nodes using a well-designed expanding disconnected graph operator(EDG)in this paper.Firstly,all obstacles are marked and their corners are located through the map pre-processing.Then,the EDG operator is designed to find points in non-obstruction areas to complete the rapid expansion of disconnected nodes.Finally,the EDG*heuristic iterative algorithm is proposed.It selects the candidate node through a specific valuation function and realizes the node expansion while avoiding collision with a minimum offset.Path planning experiments were conducted in a typical indoor environment and on the public dataset CSM.The result shows that the proposed EDG*reduced the planning time by more than 90%and total length of paths reduced by more than 4.6%.Compared to A*,Dijkstra and JPS,EDG*does not show an exponential explosion effect in map size.The EDG*showed better performance in terms of path smoothness,and collision avoidance.This shows that the EDG*algorithm proposed in this paper can improve the efficiency of path planning and enhance path quality.展开更多
Unmanned autonomous helicopter(UAH)path planning problem is an important component of the UAH mission planning system.Aiming to reduce the influence of non-complete ground threat information on UAH path planning,a gro...Unmanned autonomous helicopter(UAH)path planning problem is an important component of the UAH mission planning system.Aiming to reduce the influence of non-complete ground threat information on UAH path planning,a ground threat prediction-based path planning method is proposed based on artificial bee colony(ABC)algorithm by collaborative thinking strategy.Firstly,a dynamic threat distribution probability model is developed based on the characteristics of typical ground threats.The dynamic no-fly zone of the UAH is simulated and established by calculating the distribution probability of ground threats in real time.Then,a dynamic path planning method for UAH is designed in complex environment based on the real-time prediction of ground threats.By adding the collision warning mechanism to the path planning model,the flight path could be dynamically adjusted according to changing no-fly zones.Furthermore,a hybrid enhanced ABC algorithm is proposed based on collaborative thinking strategy.The proposed algorithm applies the leader-member thinking mechanism to guide the direction of population evolution,and reduces the negative impact of local optimal solutions caused by collaborative learning update strategy,which makes the optimization performance of ABC algorithm more controllable and efficient.Finally,simulation results verify the feasibility and effectiveness of the proposed ground threat prediction path planning method.展开更多
In the domain of autonomous industrial manipulators,precise positioning and appropriate posture selection in path planning are pivotal for tasks involving obstacle avoidance,such as handling,heat sealing,and stacking....In the domain of autonomous industrial manipulators,precise positioning and appropriate posture selection in path planning are pivotal for tasks involving obstacle avoidance,such as handling,heat sealing,and stacking.While Multi-Degree-of-Freedom(MDOF)manipulators offer kinematic redundancy,aiding in the derivation of optimal inverse kinematic solutions to meet position and posture requisites,their path planning entails intricate multiobjective optimization,encompassing path,posture,and joint motion optimization.Achieving satisfactory results in practical scenarios remains challenging.In response,this study introduces a novel Reverse Path Planning(RPP)methodology tailored for industrial manipulators.The approach commences by conceptualizing the manipulator’s end-effector as an agent within a reinforcement learning(RL)framework,wherein the state space,action set,and reward function are precisely defined to expedite the search for an initial collision-free path.To enhance convergence speed,the Q-learning algorithm in RL is augmented with Dyna-Q.Additionally,we formulate the cylindrical bounding box of the manipulator based on its Denavit-Hartenberg(DH)parameters and propose a swift collision detection technique.Furthermore,the motion performance of the end-effector is refined through a bidirectional search,and joint weighting coefficients are introduced to mitigate motion in high-power joints.The efficacy of the proposed RPP methodology is rigorously examined through extensive simulations conducted on a six-degree-of-freedom(6-DOF)manipulator encountering two distinct obstacle configurations and target positions.Experimental results substantiate that the RPP method adeptly orchestrates the computation of the shortest collision-free path while adhering to specific posture constraints at the target point.Moreover,itminimizes both posture angle deviations and joint motion,showcasing its prowess in enhancing the operational performance of MDOF industrial manipulators.展开更多
The Autonomous Underwater Glider(AUG)is a kind of prevailing underwater intelligent internet vehicle and occupies a dominant position in industrial applications,in which path planning is an essential problem.Due to th...The Autonomous Underwater Glider(AUG)is a kind of prevailing underwater intelligent internet vehicle and occupies a dominant position in industrial applications,in which path planning is an essential problem.Due to the complexity and variability of the ocean,accurate environment modeling and flexible path planning algorithms are pivotal challenges.The traditional models mainly utilize mathematical functions,which are not complete and reliable.Most existing path planning algorithms depend on the environment and lack flexibility.To overcome these challenges,we propose a path planning system for underwater intelligent internet vehicles.It applies digital twins and sensor data to map the real ocean environment to a virtual digital space,which provides a comprehensive and reliable environment for path simulation.We design a value-based reinforcement learning path planning algorithm and explore the optimal network structure parameters.The path simulation is controlled by a closed-loop model integrated into the terminal vehicle through edge computing.The integration of state input enriches the learning of neural networks and helps to improve generalization and flexibility.The task-related reward function promotes the rapid convergence of the training.The experimental results prove that our reinforcement learning based path planning algorithm has great flexibility and can effectively adapt to a variety of different ocean conditions.展开更多
For the problem of slow search and tortuous paths in the Rapidly Exploring Random Tree(RRT)algorithm,a feedback-biased sampling RRT,called FS-RRT,is proposedbasedon RRT.Firstly,toimprove the samplingefficiency of RRT ...For the problem of slow search and tortuous paths in the Rapidly Exploring Random Tree(RRT)algorithm,a feedback-biased sampling RRT,called FS-RRT,is proposedbasedon RRT.Firstly,toimprove the samplingefficiency of RRT to shorten the search time,the search area of the randomtree is restricted to improve the sampling efficiency.Secondly,to obtain better information about obstacles to shorten the path length,a feedback-biased sampling strategy is used instead of the traditional random sampling,the collision of the expanding node with an obstacle generates feedback information so that the next expanding node avoids expanding within a specific angle range.Thirdly,this paper proposes using the inverse optimization strategy to remove redundancy points from the initial path,making the path shorter and more accurate.Finally,to satisfy the smooth operation of the robot in practice,auxiliary points are used to optimize the cubic Bezier curve to avoid path-crossing obstacles when using the Bezier curve optimization.The experimental results demonstrate that,compared to the traditional RRT algorithm,the proposed FS-RRT algorithm performs favorably against mainstream algorithms regarding running time,number of search iterations,and path length.Moreover,the improved algorithm also performs well in a narrow obstacle environment,and its effectiveness is further confirmed by experimental verification.展开更多
Intelligent penetration testing is of great significance for the improvement of the security of information systems,and the critical issue is the planning of penetration test paths.In view of the difficulty for attack...Intelligent penetration testing is of great significance for the improvement of the security of information systems,and the critical issue is the planning of penetration test paths.In view of the difficulty for attackers to obtain complete network information in realistic network scenarios,Reinforcement Learning(RL)is a promising solution to discover the optimal penetration path under incomplete information about the target network.Existing RL-based methods are challenged by the sizeable discrete action space,which leads to difficulties in the convergence.Moreover,most methods still rely on experts’knowledge.To address these issues,this paper proposes a penetration path planning method based on reinforcement learning with episodic memory.First,the penetration testing problem is formally described in terms of reinforcement learning.To speed up the training process without specific prior knowledge,the proposed algorithm introduces episodic memory to store experienced advantageous strategies for the first time.Furthermore,the method offers an exploration strategy based on episodic memory to guide the agents in learning.The design makes full use of historical experience to achieve the purpose of reducing blind exploration and improving planning efficiency.Ultimately,comparison experiments are carried out with the existing RL-based methods.The results reveal that the proposed method has better convergence performance.The running time is reduced by more than 20%.展开更多
Due to its flexibility and complementarity, the multiUAVs system is well adapted to complex and cramped workspaces, with great application potential in the search and rescue(SAR) and indoor goods delivery fields. Howe...Due to its flexibility and complementarity, the multiUAVs system is well adapted to complex and cramped workspaces, with great application potential in the search and rescue(SAR) and indoor goods delivery fields. However, safe and effective path planning of multiple unmanned aerial vehicles(UAVs)in the cramped environment is always challenging: conflicts with each other are frequent because of high-density flight paths, collision probability increases because of space constraints, and the search space increases significantly, including time scale, 3D scale and model scale. Thus, this paper proposes a hierarchical collaborative planning framework with a conflict avoidance module at the high level and a path generation module at the low level. The enhanced conflict-base search(ECBS) in our framework is improved to handle the conflicts in the global path planning and avoid the occurrence of local deadlock. And both the collision and kinematic models of UAVs are considered to improve path smoothness and flight safety. Moreover, we specifically designed and published the cramped environment test set containing various unique obstacles to evaluating our framework performance thoroughly. Experiments are carried out relying on Rviz, with multiple flight missions: random, opposite, and staggered, which showed that the proposed method can generate smooth cooperative paths without conflict for at least 60 UAVs in a few minutes.The benchmark and source code are released in https://github.com/inin-xingtian/multi-UAVs-path-planner.展开更多
Effective path planning is crucial for mobile robots to quickly reach rescue destination and complete rescue tasks in a post-disaster scenario.In this study,we investigated the post-disaster rescue path planning probl...Effective path planning is crucial for mobile robots to quickly reach rescue destination and complete rescue tasks in a post-disaster scenario.In this study,we investigated the post-disaster rescue path planning problem and modeled this problem as a variant of the travel salesman problem(TSP)with life-strength constraints.To address this problem,we proposed an improved iterated greedy(IIG)algorithm.First,a push-forward insertion heuristic(PFIH)strategy was employed to generate a high-quality initial solution.Second,a greedy-based insertion strategy was designed and used in the destruction-construction stage to increase the algorithm’s exploration ability.Furthermore,three problem-specific swap operators were developed to improve the algorithm’s exploitation ability.Additionally,an improved simulated annealing(SA)strategy was used as an acceptance criterion to effectively prevent the algorithm from falling into local optima.To verify the effectiveness of the proposed algorithm,the Solomon dataset was extended to generate 27 instances for simulation.Finally,the proposed IIG was compared with five state-of-the-art algorithms.The parameter analysiswas conducted using the design of experiments(DOE)Taguchi method,and the effectiveness analysis of each component has been verified one by one.Simulation results indicate that IIGoutperforms the compared algorithms in terms of the number of rescue survivors and convergence speed,proving the effectiveness of the proposed algorithm.展开更多
Reducing casualties and property losses through effective evacuation route planning has been a key focus for researchers in recent years.As part of this effort,an enhanced sparrow search algorithm(MSSA)was proposed.Fi...Reducing casualties and property losses through effective evacuation route planning has been a key focus for researchers in recent years.As part of this effort,an enhanced sparrow search algorithm(MSSA)was proposed.Firstly,the Golden Sine algorithm and a nonlinear weight factor optimization strategy were added in the discoverer position update stage of the SSA algorithm.Secondly,the Cauchy-Gaussian perturbation was applied to the optimal position of the SSA algorithm to improve its ability to jump out of local optima.Finally,the local search mechanism based on the mountain climbing method was incorporated into the local search stage of the SSA algorithm,improving its local search ability.To evaluate the effectiveness of the proposed algorithm,the Whale Algorithm,Gray Wolf Algorithm,Improved Gray Wolf Algorithm,Sparrow Search Algorithm,and MSSA Algorithm were employed to solve various test functions.The accuracy and convergence speed of each algorithm were then compared and analyzed.The results indicate that the MSSA algorithm has superior solving ability and stability compared to other algorithms.To further validate the enhanced algorithm’s capabilities for path planning,evacuation experiments were conducted using different maps featuring various obstacle types.Additionally,a multi-exit evacuation scenario was constructed according to the actual building environment of a teaching building.Both the sparrow search algorithm and MSSA algorithm were employed in the simulation experiment for multiexit evacuation path planning.The findings demonstrate that the MSSA algorithm outperforms the comparison algorithm,showcasing its greater advantages and higher application potential.展开更多
To address the shortcomings of single-step decision making in the existing deep reinforcement learning based unmanned aerial vehicle(UAV)real-time path planning problem,a real-time UAV path planning algorithm based on...To address the shortcomings of single-step decision making in the existing deep reinforcement learning based unmanned aerial vehicle(UAV)real-time path planning problem,a real-time UAV path planning algorithm based on long shortterm memory(RPP-LSTM)network is proposed,which combines the memory characteristics of recurrent neural network(RNN)and the deep reinforcement learning algorithm.LSTM networks are used in this algorithm as Q-value networks for the deep Q network(DQN)algorithm,which makes the decision of the Q-value network has some memory.Thanks to LSTM network,the Q-value network can use the previous environmental information and action information which effectively avoids the problem of single-step decision considering only the current environment.Besides,the algorithm proposes a hierarchical reward and punishment function for the specific problem of UAV real-time path planning,so that the UAV can more reasonably perform path planning.Simulation verification shows that compared with the traditional feed-forward neural network(FNN)based UAV autonomous path planning algorithm,the RPP-LSTM proposed in this paper can adapt to more complex environments and has significantly improved robustness and accuracy when performing UAV real-time path planning.展开更多
This study focuses on the improvement of path planning efficiency for underwater gravity-aided navigation.Firstly,a Depth Sorting Fast Search(DSFS)algorithm was proposed to improve the planning speed of the Quick Rapi...This study focuses on the improvement of path planning efficiency for underwater gravity-aided navigation.Firstly,a Depth Sorting Fast Search(DSFS)algorithm was proposed to improve the planning speed of the Quick Rapidly-exploring Random Trees*(Q-RRT*)algorithm.A cost inequality relationship between an ancestor and its descendants was derived,and the ancestors were filtered accordingly.Secondly,the underwater gravity-aided navigation path planning system was designed based on the DSFS algorithm,taking into account the fitness,safety,and asymptotic optimality of the routes,according to the gravity suitability distribution of the navigation space.Finally,experimental comparisons of the computing performance of the ChooseParent procedure,the Rewire procedure,and the combination of the two procedures for Q-RRT*and DSFS were conducted under the same planning environment and parameter conditions,respectively.The results showed that the computational efficiency of the DSFS algorithm was improved by about 1.2 times compared with the Q-RRT*algorithm while ensuring correct computational results.展开更多
Collaborative coverage path planning(CCPP) refers to obtaining the shortest paths passing over all places except obstacles in a certain area or space. A multi-unmanned aerial vehicle(UAV) collaborative CCPP algorithm ...Collaborative coverage path planning(CCPP) refers to obtaining the shortest paths passing over all places except obstacles in a certain area or space. A multi-unmanned aerial vehicle(UAV) collaborative CCPP algorithm is proposed for the urban rescue search or military search in outdoor environment.Due to flexible control of small UAVs, it can be considered that all UAVs fly at the same altitude, that is, they perform search tasks on a two-dimensional plane. Based on the agents’ motion characteristics and environmental information, a mathematical model of CCPP problem is established. The minimum time for UAVs to complete the CCPP is the objective function, and complete coverage constraint, no-fly constraint, collision avoidance constraint, and communication constraint are considered. Four motion strategies and two communication strategies are designed. Then a distributed CCPP algorithm is designed based on hybrid strategies. Simulation results compared with patternbased genetic algorithm(PBGA) and random search method show that the proposed method has stronger real-time performance and better scalability and can complete the complete CCPP task more efficiently and stably.展开更多
Safety patrol inspection in chemical industrial parks is a complex multi-objective task with multiple degrees of freedom.Traditional pointer instruments with advantages like high reliability and strong adaptability to...Safety patrol inspection in chemical industrial parks is a complex multi-objective task with multiple degrees of freedom.Traditional pointer instruments with advantages like high reliability and strong adaptability to harsh environment,are widely applied in such parks.However,they rely on manual readings which have problems like heavy patrol workload,high labor cost,high false positives/negatives and poor timeliness.To address the above problems,this study proposes a path planning method for robot patrol in chemical industrial parks,where a path optimization model based on improved iterated local search and random variable neighborhood descent(ILS-RVND)algorithm is established by integrating the actual requirements of patrol tasks in chemical industrial parks.Further,the effectiveness of the model and algorithm is verified by taking real park data as an example.The results show that compared with GA and ILS-RVND,the improved algorithm reduces quantification cost by about 24%and saves patrol time by about 36%.Apart from shortening the patrol time of robots,optimizing their patrol path and reducing their maintenance loss,the proposed algorithm also avoids the untimely patrol of robots and enhances the safety factor of equipment.展开更多
The burgeoning robotics industry has catalyzed significant strides in the development and deployment of industrial and service robotic arms, positioning path planning as a pivotal facet for augmenting their operationa...The burgeoning robotics industry has catalyzed significant strides in the development and deployment of industrial and service robotic arms, positioning path planning as a pivotal facet for augmenting their operational safety and efficiency. Existing path planning algorithms, while capable of delineating feasible trajectories, often fall short of achieving optimality, particularly concerning path length, search duration, and success likelihood. This study introduces an enhanced Rapidly-Exploring Random Tree (RRT) algorithm, meticulously designed to rectify the issues of node redundancy and the compromised path quality endemic to conventional RRT approaches. Through the integration of an adaptive pruning mechanism and a dynamic elliptical search strategy within the Informed RRT* framework, our algorithm efficiently refines the search tree by discarding branches that surpass the cost of the optimal path, thereby refining the search space and significantly boosting efficiency. Extensive comparative analysis across both two-dimensional and three-dimensional simulation settings underscores the algorithm’s proficiency in markedly improving path precision and search velocity, signifying a breakthrough in the domain of robotic arm path planning.展开更多
Unmanned aerial vehicles(UAVs),commonly known as drones,have drawn significant consideration thanks to their agility,mobility,and flexibility features.They play a crucial role in modern reconnaissance,inspection,intel...Unmanned aerial vehicles(UAVs),commonly known as drones,have drawn significant consideration thanks to their agility,mobility,and flexibility features.They play a crucial role in modern reconnaissance,inspection,intelligence,and surveillance missions.Coverage path planning(CPP)which is one of the crucial aspects that determines an intelligent system’s quality seeks an optimal trajectory to fully cover the region of interest(ROI).However,the flight time of the UAV is limited due to a battery limitation and may not cover the whole region,especially in large region.Therefore,energy consumption is one of the most challenging issues that need to be optimized.In this paper,we propose an energy-efficient coverage path planning algorithm to solve the CPP problem.The objective is to generate a collision-free coverage path that minimizes the overall energy consumption and guarantees covering the whole region.To do so,the flight path is optimized and the number of turns is reduced to minimize the energy consumption.The proposed approach first decomposes the ROI into a set of cells depending on a UAV camera footprint.Then,the coverage path planning problem is formulated,where the exact solution is determined using the CPLEX solver.For small-scale problems,the CPLEX shows a better solution in a reasonable time.However,the CPLEX solver fails to generate the solution within a reasonable time for large-scale problems.Thus,to solve the model for large-scale problems,simulated annealing forCPP is developed.The results show that heuristic approaches yield a better solution for large-scale problems within amuch shorter execution time than the CPLEX solver.Finally,we compare the simulated annealing against the greedy algorithm.The results show that simulated annealing outperforms the greedy algorithm in generating better solution quality.展开更多
A new and improved RRT∗algorithm has been developed to address the low efficiency of obstacle avoidance planning and long path distances in the electric vehicle automatic charging robot arm.This algorithm enables the ...A new and improved RRT∗algorithm has been developed to address the low efficiency of obstacle avoidance planning and long path distances in the electric vehicle automatic charging robot arm.This algorithm enables the robot to avoid obstacles,find the optimal path,and complete automatic charging docking.It maintains the global completeness and path optimality of the RRT algorithmwhile also improving the iteration speed and quality of generated paths in both 2D and 3D path planning.After finding the optimal path,the B-sample curve is used to optimize the rough path to create a smoother and more optimal path.In comparison experiments,the new algorithmyielded reductions of 35.5%,29.2%,and 11.7%in search time and 22.8%,19.2%,and 9%in path length for the 3D environment.Finally,experimental validation of the automatic charging of electric vehicles was conducted to further verify the effectiveness of the algorithm.The simulation experimental validation was carried out by kinematic modeling and building an experimental platform.The error between the experimental results and the simulation results is within 10%.The experimental results show the effectiveness and practicality of the algorithm.展开更多
Unknown closed spaces are a big challenge for the navigation of robots since there are no global and pre-defined positioning options in the area.One of the simplest and most efficient algorithms,the artificial potenti...Unknown closed spaces are a big challenge for the navigation of robots since there are no global and pre-defined positioning options in the area.One of the simplest and most efficient algorithms,the artificial potential field algorithm(APF),may provide real-time navigation in those places but fall into local mini-mum in some cases.To overcome this problem and to present alternative escape routes for a robot,possible crossing points in buildings may be detected by using object detection and included in the path planning algorithm.This study utilized a proposed sensor fusion method and an improved object classification method for detecting windows,doors,and stairs in buildings and these objects were classified as valid or invalid for the path planning algorithm.The performance of the approach was evaluated in a simulated environment with a quadrotor that was equipped with camera and laser imaging detection and ranging(LIDAR)sensors to navigate through an unknown closed space and reach a desired goal point.Inclusion of crossing points allows the robot to escape from areas where it is con-gested.The navigation of the robot has been tested in different scenarios based on the proposed path planning algorithm and compared with other improved APF methods.The results showed that the improved APF methods and the methods rein-forced with other path planning algorithms were similar in performance with the proposed method for the same goals in the same room.For the goals outside the current room,traditional APF methods were quite unsuccessful in reaching the goals.Even though improved methods were able to reach some outside targets,the proposed method gave approximately 17%better results than the most success-ful example in achieving targets outside the current room.The proposed method can also work in real-time to discover a building and navigate between rooms.展开更多
Background Automatic guided vehicles(AGVs)have developed rapidly in recent years and have been used in several fields,including intelligent transportation,cargo assembly,military testing,and others.A key issue in thes...Background Automatic guided vehicles(AGVs)have developed rapidly in recent years and have been used in several fields,including intelligent transportation,cargo assembly,military testing,and others.A key issue in these applications is path planning.Global path planning results based on known environmental information are used as the ideal path for AGVs combined with local path planning to achieve safe and rapid arrival at the destination.Using the global planning method,the ideal path should meet the requirements of as few turns as possible,a short planning time,and continuous path curvature.Methods We propose a global path-planning method based on an improved A^(*)algorithm.The robustness of the algorithm was verified by simulation experiments in typical multiobstacle and indoor scenarios.To improve the efficiency of the path-finding time,we increase the heuristic information weight of the target location and avoid invalid cost calculations of the obstacle areas in the dynamic programming process.Subsequently,the optimality of the number of turns in the path is ensured based on the turning node backtracking optimization method.Because the final global path needs to satisfy the AGV kinematic constraints and curvature continuity condition,we adopt a curve smoothing scheme and select the optimal result that meets the constraints.Conclusions Simulation results show that the improved algorithm proposed in this study outperforms the traditional method and can help AGVs improve the efficiency of task execution by planning a path with low complexity and smoothness.Additionally,this scheme provides a new solution for global path planning of unmanned vehicles.展开更多
Workers who conduct regular facility inspections in radioactive environments will inevitably be affected by radiation.Therefore,it is important to optimize the inspection path to ensure that workers are exposed to the...Workers who conduct regular facility inspections in radioactive environments will inevitably be affected by radiation.Therefore,it is important to optimize the inspection path to ensure that workers are exposed to the least amount of radiation.This study proposes a discrete Rao-combined artificial bee colony(ABC)algorithm for planning inspection paths with minimum exposure doses in radioactive environments with obstacles.In this algorithm,retaining the framework of the traditional ABC algorithm,we applied the directional solution update rules of Rao algorithms at the employed bee stage and onlooker bee stage to increase the exploitation ability of the algorithm and implement discretion using the swap operator and swap sequence.To increase the randomness of solution generation,the chaos algorithm was used at the initialization stage.The K-opt operation technique was introduced at the scout bee stage to increase the exploration ability of the algorithm.For path planning in an environment with complex structural obstacles,an obstacle detour technique using a recursive algorithm was applied.To evaluate the performance of the proposed algorithm,we performed experimental simulations in three hypothetical environments and compared the results with those of improved particle swarm optimization,chaos particle swarm optimization,improved ant colony optimization,and discrete Rao’s algorithms.The experimental results show the high performance of the proposed discrete Rao-combined ABC algorithm and its obstacle detour capability.展开更多
文摘Aiming at the practical application of Unmanned Underwater Vehicle(UUV)in underwater combat,this paper proposes a battlefield ambush scene with UUV considering ocean current.Firstly,by establishing these mathematical models of ocean current environment,target movement,and sonar detection,the probability calculation methods of single UUV searching target and multiple UUV cooperatively searching target are given respectively.Then,based on the Hybrid Quantum-behaved Particle Swarm Optimization(HQPSO)algorithm,the path with the highest target search probability is found.Finally,through simulation calculations,the influence of different UUV parameters and target parameters on the target search probability is analyzed,and the minimum number of UUVs that need to be deployed to complete the ambush task is demonstrated,and the optimal search path scheme is obtained.The method proposed in this paper provides a theoretical basis for the practical application of UUV in the future combat.
基金Supported by National Key Research and Development Program of China(Grant No.2022YFB4700402).
文摘Existing mobile robots mostly use graph search algorithms for path planning,which suffer from relatively low planning efficiency owing to high redundancy and large computational complexity.Due to the limitations of the neighborhood search strategy,the robots could hardly obtain the most optimal global path.A global path planning algorithm,denoted as EDG*,is proposed by expanding nodes using a well-designed expanding disconnected graph operator(EDG)in this paper.Firstly,all obstacles are marked and their corners are located through the map pre-processing.Then,the EDG operator is designed to find points in non-obstruction areas to complete the rapid expansion of disconnected nodes.Finally,the EDG*heuristic iterative algorithm is proposed.It selects the candidate node through a specific valuation function and realizes the node expansion while avoiding collision with a minimum offset.Path planning experiments were conducted in a typical indoor environment and on the public dataset CSM.The result shows that the proposed EDG*reduced the planning time by more than 90%and total length of paths reduced by more than 4.6%.Compared to A*,Dijkstra and JPS,EDG*does not show an exponential explosion effect in map size.The EDG*showed better performance in terms of path smoothness,and collision avoidance.This shows that the EDG*algorithm proposed in this paper can improve the efficiency of path planning and enhance path quality.
文摘Unmanned autonomous helicopter(UAH)path planning problem is an important component of the UAH mission planning system.Aiming to reduce the influence of non-complete ground threat information on UAH path planning,a ground threat prediction-based path planning method is proposed based on artificial bee colony(ABC)algorithm by collaborative thinking strategy.Firstly,a dynamic threat distribution probability model is developed based on the characteristics of typical ground threats.The dynamic no-fly zone of the UAH is simulated and established by calculating the distribution probability of ground threats in real time.Then,a dynamic path planning method for UAH is designed in complex environment based on the real-time prediction of ground threats.By adding the collision warning mechanism to the path planning model,the flight path could be dynamically adjusted according to changing no-fly zones.Furthermore,a hybrid enhanced ABC algorithm is proposed based on collaborative thinking strategy.The proposed algorithm applies the leader-member thinking mechanism to guide the direction of population evolution,and reduces the negative impact of local optimal solutions caused by collaborative learning update strategy,which makes the optimization performance of ABC algorithm more controllable and efficient.Finally,simulation results verify the feasibility and effectiveness of the proposed ground threat prediction path planning method.
基金supported by the National Natural Science Foundation of China under Grant No.62001199Fujian Province Nature Science Foundation under Grant No.2023J01925.
文摘In the domain of autonomous industrial manipulators,precise positioning and appropriate posture selection in path planning are pivotal for tasks involving obstacle avoidance,such as handling,heat sealing,and stacking.While Multi-Degree-of-Freedom(MDOF)manipulators offer kinematic redundancy,aiding in the derivation of optimal inverse kinematic solutions to meet position and posture requisites,their path planning entails intricate multiobjective optimization,encompassing path,posture,and joint motion optimization.Achieving satisfactory results in practical scenarios remains challenging.In response,this study introduces a novel Reverse Path Planning(RPP)methodology tailored for industrial manipulators.The approach commences by conceptualizing the manipulator’s end-effector as an agent within a reinforcement learning(RL)framework,wherein the state space,action set,and reward function are precisely defined to expedite the search for an initial collision-free path.To enhance convergence speed,the Q-learning algorithm in RL is augmented with Dyna-Q.Additionally,we formulate the cylindrical bounding box of the manipulator based on its Denavit-Hartenberg(DH)parameters and propose a swift collision detection technique.Furthermore,the motion performance of the end-effector is refined through a bidirectional search,and joint weighting coefficients are introduced to mitigate motion in high-power joints.The efficacy of the proposed RPP methodology is rigorously examined through extensive simulations conducted on a six-degree-of-freedom(6-DOF)manipulator encountering two distinct obstacle configurations and target positions.Experimental results substantiate that the RPP method adeptly orchestrates the computation of the shortest collision-free path while adhering to specific posture constraints at the target point.Moreover,itminimizes both posture angle deviations and joint motion,showcasing its prowess in enhancing the operational performance of MDOF industrial manipulators.
基金supported by the National Natural Science Foundation of China(No.61871283).
文摘The Autonomous Underwater Glider(AUG)is a kind of prevailing underwater intelligent internet vehicle and occupies a dominant position in industrial applications,in which path planning is an essential problem.Due to the complexity and variability of the ocean,accurate environment modeling and flexible path planning algorithms are pivotal challenges.The traditional models mainly utilize mathematical functions,which are not complete and reliable.Most existing path planning algorithms depend on the environment and lack flexibility.To overcome these challenges,we propose a path planning system for underwater intelligent internet vehicles.It applies digital twins and sensor data to map the real ocean environment to a virtual digital space,which provides a comprehensive and reliable environment for path simulation.We design a value-based reinforcement learning path planning algorithm and explore the optimal network structure parameters.The path simulation is controlled by a closed-loop model integrated into the terminal vehicle through edge computing.The integration of state input enriches the learning of neural networks and helps to improve generalization and flexibility.The task-related reward function promotes the rapid convergence of the training.The experimental results prove that our reinforcement learning based path planning algorithm has great flexibility and can effectively adapt to a variety of different ocean conditions.
基金provided by Shaanxi Province’s Key Research and Development Plan(No.2022NY-087).
文摘For the problem of slow search and tortuous paths in the Rapidly Exploring Random Tree(RRT)algorithm,a feedback-biased sampling RRT,called FS-RRT,is proposedbasedon RRT.Firstly,toimprove the samplingefficiency of RRT to shorten the search time,the search area of the randomtree is restricted to improve the sampling efficiency.Secondly,to obtain better information about obstacles to shorten the path length,a feedback-biased sampling strategy is used instead of the traditional random sampling,the collision of the expanding node with an obstacle generates feedback information so that the next expanding node avoids expanding within a specific angle range.Thirdly,this paper proposes using the inverse optimization strategy to remove redundancy points from the initial path,making the path shorter and more accurate.Finally,to satisfy the smooth operation of the robot in practice,auxiliary points are used to optimize the cubic Bezier curve to avoid path-crossing obstacles when using the Bezier curve optimization.The experimental results demonstrate that,compared to the traditional RRT algorithm,the proposed FS-RRT algorithm performs favorably against mainstream algorithms regarding running time,number of search iterations,and path length.Moreover,the improved algorithm also performs well in a narrow obstacle environment,and its effectiveness is further confirmed by experimental verification.
文摘Intelligent penetration testing is of great significance for the improvement of the security of information systems,and the critical issue is the planning of penetration test paths.In view of the difficulty for attackers to obtain complete network information in realistic network scenarios,Reinforcement Learning(RL)is a promising solution to discover the optimal penetration path under incomplete information about the target network.Existing RL-based methods are challenged by the sizeable discrete action space,which leads to difficulties in the convergence.Moreover,most methods still rely on experts’knowledge.To address these issues,this paper proposes a penetration path planning method based on reinforcement learning with episodic memory.First,the penetration testing problem is formally described in terms of reinforcement learning.To speed up the training process without specific prior knowledge,the proposed algorithm introduces episodic memory to store experienced advantageous strategies for the first time.Furthermore,the method offers an exploration strategy based on episodic memory to guide the agents in learning.The design makes full use of historical experience to achieve the purpose of reducing blind exploration and improving planning efficiency.Ultimately,comparison experiments are carried out with the existing RL-based methods.The results reveal that the proposed method has better convergence performance.The running time is reduced by more than 20%.
基金partly supported by Program for the National Natural Science Foundation of China (62373052, U1913203, 61903034)Youth Talent Promotion Project of China Association for Science and TechnologyBeijing Institute of Technology Research Fund Program for Young Scholars。
文摘Due to its flexibility and complementarity, the multiUAVs system is well adapted to complex and cramped workspaces, with great application potential in the search and rescue(SAR) and indoor goods delivery fields. However, safe and effective path planning of multiple unmanned aerial vehicles(UAVs)in the cramped environment is always challenging: conflicts with each other are frequent because of high-density flight paths, collision probability increases because of space constraints, and the search space increases significantly, including time scale, 3D scale and model scale. Thus, this paper proposes a hierarchical collaborative planning framework with a conflict avoidance module at the high level and a path generation module at the low level. The enhanced conflict-base search(ECBS) in our framework is improved to handle the conflicts in the global path planning and avoid the occurrence of local deadlock. And both the collision and kinematic models of UAVs are considered to improve path smoothness and flight safety. Moreover, we specifically designed and published the cramped environment test set containing various unique obstacles to evaluating our framework performance thoroughly. Experiments are carried out relying on Rviz, with multiple flight missions: random, opposite, and staggered, which showed that the proposed method can generate smooth cooperative paths without conflict for at least 60 UAVs in a few minutes.The benchmark and source code are released in https://github.com/inin-xingtian/multi-UAVs-path-planner.
基金supported by the Opening Fund of Shandong Provincial Key Laboratory of Network based Intelligent Computing,the National Natural Science Foundation of China(52205529,61803192)the Natural Science Foundation of Shandong Province(ZR2021QE195)+1 种基金the Youth Innovation Team Program of Shandong Higher Education Institution(2023KJ206)the Guangyue Youth Scholar Innovation Talent Program support received from Liaocheng University(LCUGYTD2022-03).
文摘Effective path planning is crucial for mobile robots to quickly reach rescue destination and complete rescue tasks in a post-disaster scenario.In this study,we investigated the post-disaster rescue path planning problem and modeled this problem as a variant of the travel salesman problem(TSP)with life-strength constraints.To address this problem,we proposed an improved iterated greedy(IIG)algorithm.First,a push-forward insertion heuristic(PFIH)strategy was employed to generate a high-quality initial solution.Second,a greedy-based insertion strategy was designed and used in the destruction-construction stage to increase the algorithm’s exploration ability.Furthermore,three problem-specific swap operators were developed to improve the algorithm’s exploitation ability.Additionally,an improved simulated annealing(SA)strategy was used as an acceptance criterion to effectively prevent the algorithm from falling into local optima.To verify the effectiveness of the proposed algorithm,the Solomon dataset was extended to generate 27 instances for simulation.Finally,the proposed IIG was compared with five state-of-the-art algorithms.The parameter analysiswas conducted using the design of experiments(DOE)Taguchi method,and the effectiveness analysis of each component has been verified one by one.Simulation results indicate that IIGoutperforms the compared algorithms in terms of the number of rescue survivors and convergence speed,proving the effectiveness of the proposed algorithm.
基金supported by National Natural Science Foundation of China(71904006)Henan Province Key R&D Special Project(231111322200)+1 种基金the Science and Technology Research Plan of Henan Province(232102320043,232102320232,232102320046)the Natural Science Foundation of Henan(232300420317,232300420314).
文摘Reducing casualties and property losses through effective evacuation route planning has been a key focus for researchers in recent years.As part of this effort,an enhanced sparrow search algorithm(MSSA)was proposed.Firstly,the Golden Sine algorithm and a nonlinear weight factor optimization strategy were added in the discoverer position update stage of the SSA algorithm.Secondly,the Cauchy-Gaussian perturbation was applied to the optimal position of the SSA algorithm to improve its ability to jump out of local optima.Finally,the local search mechanism based on the mountain climbing method was incorporated into the local search stage of the SSA algorithm,improving its local search ability.To evaluate the effectiveness of the proposed algorithm,the Whale Algorithm,Gray Wolf Algorithm,Improved Gray Wolf Algorithm,Sparrow Search Algorithm,and MSSA Algorithm were employed to solve various test functions.The accuracy and convergence speed of each algorithm were then compared and analyzed.The results indicate that the MSSA algorithm has superior solving ability and stability compared to other algorithms.To further validate the enhanced algorithm’s capabilities for path planning,evacuation experiments were conducted using different maps featuring various obstacle types.Additionally,a multi-exit evacuation scenario was constructed according to the actual building environment of a teaching building.Both the sparrow search algorithm and MSSA algorithm were employed in the simulation experiment for multiexit evacuation path planning.The findings demonstrate that the MSSA algorithm outperforms the comparison algorithm,showcasing its greater advantages and higher application potential.
基金supported by the Natural Science Basic Research Prog ram of Shaanxi(2022JQ-593)。
文摘To address the shortcomings of single-step decision making in the existing deep reinforcement learning based unmanned aerial vehicle(UAV)real-time path planning problem,a real-time UAV path planning algorithm based on long shortterm memory(RPP-LSTM)network is proposed,which combines the memory characteristics of recurrent neural network(RNN)and the deep reinforcement learning algorithm.LSTM networks are used in this algorithm as Q-value networks for the deep Q network(DQN)algorithm,which makes the decision of the Q-value network has some memory.Thanks to LSTM network,the Q-value network can use the previous environmental information and action information which effectively avoids the problem of single-step decision considering only the current environment.Besides,the algorithm proposes a hierarchical reward and punishment function for the specific problem of UAV real-time path planning,so that the UAV can more reasonably perform path planning.Simulation verification shows that compared with the traditional feed-forward neural network(FNN)based UAV autonomous path planning algorithm,the RPP-LSTM proposed in this paper can adapt to more complex environments and has significantly improved robustness and accuracy when performing UAV real-time path planning.
基金the National Natural Science Foundation of China(Grant No.42274119)the Liaoning Revitalization Talents Program(Grant No.XLYC2002082)+1 种基金National Key Research and Development Plan Key Special Projects of Science and Technology Military Civil Integration(Grant No.2022YFF1400500)the Key Project of Science and Technology Commission of the Central Military Commission.
文摘This study focuses on the improvement of path planning efficiency for underwater gravity-aided navigation.Firstly,a Depth Sorting Fast Search(DSFS)algorithm was proposed to improve the planning speed of the Quick Rapidly-exploring Random Trees*(Q-RRT*)algorithm.A cost inequality relationship between an ancestor and its descendants was derived,and the ancestors were filtered accordingly.Secondly,the underwater gravity-aided navigation path planning system was designed based on the DSFS algorithm,taking into account the fitness,safety,and asymptotic optimality of the routes,according to the gravity suitability distribution of the navigation space.Finally,experimental comparisons of the computing performance of the ChooseParent procedure,the Rewire procedure,and the combination of the two procedures for Q-RRT*and DSFS were conducted under the same planning environment and parameter conditions,respectively.The results showed that the computational efficiency of the DSFS algorithm was improved by about 1.2 times compared with the Q-RRT*algorithm while ensuring correct computational results.
基金supported by the National Natural Science Foundation of China (61903036, 61822304)Shanghai Municipal Science and Technology Major Project (2021SHZDZX0100)。
文摘Collaborative coverage path planning(CCPP) refers to obtaining the shortest paths passing over all places except obstacles in a certain area or space. A multi-unmanned aerial vehicle(UAV) collaborative CCPP algorithm is proposed for the urban rescue search or military search in outdoor environment.Due to flexible control of small UAVs, it can be considered that all UAVs fly at the same altitude, that is, they perform search tasks on a two-dimensional plane. Based on the agents’ motion characteristics and environmental information, a mathematical model of CCPP problem is established. The minimum time for UAVs to complete the CCPP is the objective function, and complete coverage constraint, no-fly constraint, collision avoidance constraint, and communication constraint are considered. Four motion strategies and two communication strategies are designed. Then a distributed CCPP algorithm is designed based on hybrid strategies. Simulation results compared with patternbased genetic algorithm(PBGA) and random search method show that the proposed method has stronger real-time performance and better scalability and can complete the complete CCPP task more efficiently and stably.
基金the National Key R&D Plan of China(No.2021YFE0105000)the National Natural Science Foundation of China(No.52074213)+1 种基金the Shaanxi Key R&D Plan Project(No.2021SF-472)the Yulin Science and Technology Plan Project(No.CXY-2020-036).
文摘Safety patrol inspection in chemical industrial parks is a complex multi-objective task with multiple degrees of freedom.Traditional pointer instruments with advantages like high reliability and strong adaptability to harsh environment,are widely applied in such parks.However,they rely on manual readings which have problems like heavy patrol workload,high labor cost,high false positives/negatives and poor timeliness.To address the above problems,this study proposes a path planning method for robot patrol in chemical industrial parks,where a path optimization model based on improved iterated local search and random variable neighborhood descent(ILS-RVND)algorithm is established by integrating the actual requirements of patrol tasks in chemical industrial parks.Further,the effectiveness of the model and algorithm is verified by taking real park data as an example.The results show that compared with GA and ILS-RVND,the improved algorithm reduces quantification cost by about 24%and saves patrol time by about 36%.Apart from shortening the patrol time of robots,optimizing their patrol path and reducing their maintenance loss,the proposed algorithm also avoids the untimely patrol of robots and enhances the safety factor of equipment.
文摘The burgeoning robotics industry has catalyzed significant strides in the development and deployment of industrial and service robotic arms, positioning path planning as a pivotal facet for augmenting their operational safety and efficiency. Existing path planning algorithms, while capable of delineating feasible trajectories, often fall short of achieving optimality, particularly concerning path length, search duration, and success likelihood. This study introduces an enhanced Rapidly-Exploring Random Tree (RRT) algorithm, meticulously designed to rectify the issues of node redundancy and the compromised path quality endemic to conventional RRT approaches. Through the integration of an adaptive pruning mechanism and a dynamic elliptical search strategy within the Informed RRT* framework, our algorithm efficiently refines the search tree by discarding branches that surpass the cost of the optimal path, thereby refining the search space and significantly boosting efficiency. Extensive comparative analysis across both two-dimensional and three-dimensional simulation settings underscores the algorithm’s proficiency in markedly improving path precision and search velocity, signifying a breakthrough in the domain of robotic arm path planning.
基金funded by Project Number INML2104 under the Interdisci-Plinary Center of Smart Mobility and Logistics,KFUPM.
文摘Unmanned aerial vehicles(UAVs),commonly known as drones,have drawn significant consideration thanks to their agility,mobility,and flexibility features.They play a crucial role in modern reconnaissance,inspection,intelligence,and surveillance missions.Coverage path planning(CPP)which is one of the crucial aspects that determines an intelligent system’s quality seeks an optimal trajectory to fully cover the region of interest(ROI).However,the flight time of the UAV is limited due to a battery limitation and may not cover the whole region,especially in large region.Therefore,energy consumption is one of the most challenging issues that need to be optimized.In this paper,we propose an energy-efficient coverage path planning algorithm to solve the CPP problem.The objective is to generate a collision-free coverage path that minimizes the overall energy consumption and guarantees covering the whole region.To do so,the flight path is optimized and the number of turns is reduced to minimize the energy consumption.The proposed approach first decomposes the ROI into a set of cells depending on a UAV camera footprint.Then,the coverage path planning problem is formulated,where the exact solution is determined using the CPLEX solver.For small-scale problems,the CPLEX shows a better solution in a reasonable time.However,the CPLEX solver fails to generate the solution within a reasonable time for large-scale problems.Thus,to solve the model for large-scale problems,simulated annealing forCPP is developed.The results show that heuristic approaches yield a better solution for large-scale problems within amuch shorter execution time than the CPLEX solver.Finally,we compare the simulated annealing against the greedy algorithm.The results show that simulated annealing outperforms the greedy algorithm in generating better solution quality.
基金This work was supported by National Natural Science Foundation of China(52175236).
文摘A new and improved RRT∗algorithm has been developed to address the low efficiency of obstacle avoidance planning and long path distances in the electric vehicle automatic charging robot arm.This algorithm enables the robot to avoid obstacles,find the optimal path,and complete automatic charging docking.It maintains the global completeness and path optimality of the RRT algorithmwhile also improving the iteration speed and quality of generated paths in both 2D and 3D path planning.After finding the optimal path,the B-sample curve is used to optimize the rough path to create a smoother and more optimal path.In comparison experiments,the new algorithmyielded reductions of 35.5%,29.2%,and 11.7%in search time and 22.8%,19.2%,and 9%in path length for the 3D environment.Finally,experimental validation of the automatic charging of electric vehicles was conducted to further verify the effectiveness of the algorithm.The simulation experimental validation was carried out by kinematic modeling and building an experimental platform.The error between the experimental results and the simulation results is within 10%.The experimental results show the effectiveness and practicality of the algorithm.
文摘Unknown closed spaces are a big challenge for the navigation of robots since there are no global and pre-defined positioning options in the area.One of the simplest and most efficient algorithms,the artificial potential field algorithm(APF),may provide real-time navigation in those places but fall into local mini-mum in some cases.To overcome this problem and to present alternative escape routes for a robot,possible crossing points in buildings may be detected by using object detection and included in the path planning algorithm.This study utilized a proposed sensor fusion method and an improved object classification method for detecting windows,doors,and stairs in buildings and these objects were classified as valid or invalid for the path planning algorithm.The performance of the approach was evaluated in a simulated environment with a quadrotor that was equipped with camera and laser imaging detection and ranging(LIDAR)sensors to navigate through an unknown closed space and reach a desired goal point.Inclusion of crossing points allows the robot to escape from areas where it is con-gested.The navigation of the robot has been tested in different scenarios based on the proposed path planning algorithm and compared with other improved APF methods.The results showed that the improved APF methods and the methods rein-forced with other path planning algorithms were similar in performance with the proposed method for the same goals in the same room.For the goals outside the current room,traditional APF methods were quite unsuccessful in reaching the goals.Even though improved methods were able to reach some outside targets,the proposed method gave approximately 17%better results than the most success-ful example in achieving targets outside the current room.The proposed method can also work in real-time to discover a building and navigate between rooms.
基金Supported by the Natural Science Foundation of Jiangsu Province (BK20211037)the Science and Technology Development Fund of Wuxi (N20201011)the Nanjing University of Information Science and Technology Wuxi Campus District graduate innovation Project。
文摘Background Automatic guided vehicles(AGVs)have developed rapidly in recent years and have been used in several fields,including intelligent transportation,cargo assembly,military testing,and others.A key issue in these applications is path planning.Global path planning results based on known environmental information are used as the ideal path for AGVs combined with local path planning to achieve safe and rapid arrival at the destination.Using the global planning method,the ideal path should meet the requirements of as few turns as possible,a short planning time,and continuous path curvature.Methods We propose a global path-planning method based on an improved A^(*)algorithm.The robustness of the algorithm was verified by simulation experiments in typical multiobstacle and indoor scenarios.To improve the efficiency of the path-finding time,we increase the heuristic information weight of the target location and avoid invalid cost calculations of the obstacle areas in the dynamic programming process.Subsequently,the optimality of the number of turns in the path is ensured based on the turning node backtracking optimization method.Because the final global path needs to satisfy the AGV kinematic constraints and curvature continuity condition,we adopt a curve smoothing scheme and select the optimal result that meets the constraints.Conclusions Simulation results show that the improved algorithm proposed in this study outperforms the traditional method and can help AGVs improve the efficiency of task execution by planning a path with low complexity and smoothness.Additionally,this scheme provides a new solution for global path planning of unmanned vehicles.
文摘Workers who conduct regular facility inspections in radioactive environments will inevitably be affected by radiation.Therefore,it is important to optimize the inspection path to ensure that workers are exposed to the least amount of radiation.This study proposes a discrete Rao-combined artificial bee colony(ABC)algorithm for planning inspection paths with minimum exposure doses in radioactive environments with obstacles.In this algorithm,retaining the framework of the traditional ABC algorithm,we applied the directional solution update rules of Rao algorithms at the employed bee stage and onlooker bee stage to increase the exploitation ability of the algorithm and implement discretion using the swap operator and swap sequence.To increase the randomness of solution generation,the chaos algorithm was used at the initialization stage.The K-opt operation technique was introduced at the scout bee stage to increase the exploration ability of the algorithm.For path planning in an environment with complex structural obstacles,an obstacle detour technique using a recursive algorithm was applied.To evaluate the performance of the proposed algorithm,we performed experimental simulations in three hypothetical environments and compared the results with those of improved particle swarm optimization,chaos particle swarm optimization,improved ant colony optimization,and discrete Rao’s algorithms.The experimental results show the high performance of the proposed discrete Rao-combined ABC algorithm and its obstacle detour capability.