期刊文献+
共找到974篇文章
< 1 2 49 >
每页显示 20 50 100
Real-Time Dynamic Multiobjective Path Planning:A Case Study
1
作者 Hongle Li SeongKi Kim 《Computers, Materials & Continua》 2025年第12期5571-5594,共24页
Path planning is a fundamental component in robotics and game artificial intelligence that considerably influences the motion efficiency of robots and unmanned aerial vehicles,as well as the realism and immersion of v... Path planning is a fundamental component in robotics and game artificial intelligence that considerably influences the motion efficiency of robots and unmanned aerial vehicles,as well as the realism and immersion of virtual environments.However,traditional algorithms are often limited to single-objective optimization and lack real-time adaptability to dynamic environments.This study addresses these limitations through a proposed realtime dynamic multiobjective(RDMO)path-planning algorithm based on an enhanced A^(*) framework.The proposed algorithm employs a queue-based structure and composite multiheuristic functions to dynamically manage game tasks and compute optimal paths under changing-map-connectivity conditions in real time.Simulation experiments are conducted using real-world road network data and benchmarked against mainstream hybrid approaches based on genetic algorithms(GAs)and simulated annealing(SA).The results show that the computational speed of the RDMO algorithm is 88 and 73 times faster than that of the GA-and SA-based solutions,respectively,while the total planned path length is reduced by 58%and 33%,respectively.In addition,the RDMO algorithm also shows excellent responsiveness to dynamic changes in map connectivity and can achieve real-time replanning with a minimal computational overhead.The research results prove that the RDMO algorithm provides a robust and efficient solution for multiobjective path planning in games and robotics applications and has a great application potential in improving system performance and user experience in related fields in the future. 展开更多
关键词 Multiobjective optimization path planning real-time system dynamic environments A*algorithm game artificial intelligence
在线阅读 下载PDF
Dynamic Scheduling and Path Planning of Automated Guided Vehicles in Automatic Container Terminal 被引量:16
2
作者 Lijun Yue Houming Fan 《IEEE/CAA Journal of Automatica Sinica》 SCIE EI CSCD 2022年第11期2005-2019,共15页
The uninterrupted operation of the quay crane(QC)ensures that the large container ship can depart port within laytime,which effectively reduces the handling cost for the container terminal and ship owners.The QC waiti... The uninterrupted operation of the quay crane(QC)ensures that the large container ship can depart port within laytime,which effectively reduces the handling cost for the container terminal and ship owners.The QC waiting caused by automated guided vehicles(AGVs)delay in the uncertain environment can be alleviated by dynamic scheduling optimization.A dynamic scheduling process is introduced in this paper to solve the AGV scheduling and path planning problems,in which the scheduling scheme determines the starting and ending nodes of paths,and the choice of paths between nodes affects the scheduling of subsequent AGVs.This work proposes a two-stage mixed integer optimization model to minimize the transportation cost of AGVs under the constraint of laytime.A dynamic optimization algorithm,including the improved rule-based heuristic algorithm and the integration of the Dijkstra algorithm and the Q-Learning algorithm,is designed to solve the optimal AGV scheduling and path schemes.A new conflict avoidance strategy based on graph theory is also proposed to reduce the probability of path conflicts between AGVs.Numerical experiments are conducted to demonstrate the effectiveness of the proposed model and algorithm over existing methods. 展开更多
关键词 Automated container terminal dynamic scheduling path planning Q-Learning algorithm rule-based heuristic algorithm
在线阅读 下载PDF
Weighted Time-Based Global Hierarchical Path Planning in Dynamic Environment 被引量:2
3
作者 邢薇薇 魏翔 卢苇 《Transactions of Tianjin University》 EI CAS 2014年第3期223-231,共9页
A weighted time-based global hierarchical path planning method is proposed to obtain the global optimal path from the starting point to the destination with time optimal control. First, the grid-or graph-based modelin... A weighted time-based global hierarchical path planning method is proposed to obtain the global optimal path from the starting point to the destination with time optimal control. First, the grid-or graph-based modeling is performed and the environment is divided into a set of grids or nodes. Then two time-based features of time interval and time cost are presented. The time intervals for each grid are built, during each interval the condition of the grid remains stable, and a time cost of passing through the grid is defined and assigned to each interval. Furthermore, the weight is introduced for taking both time and distance into consideration, and thus a sequence of multiscale paths with total time cost can be achieved. Experimental results show that the proposed method can handle the complex dynamic environment, obtain the global time optimal path and has the potential to be applied to the autonomous robot navigation and traffic environment. 展开更多
关键词 path planning dynamic environment time optimal control time cost
在线阅读 下载PDF
On-line real-time path planning of mobile robots in dynamic uncertain environment 被引量:2
4
作者 ZHUANG Hui-zhong DU Shu-xin WU Tie-jun 《Journal of Zhejiang University-Science A(Applied Physics & Engineering)》 SCIE EI CAS CSCD 2006年第4期516-524,共9页
A new path planning method for mobile robots in globally unknown environment with moving obstacles is pre- sented. With an autoregressive (AR) model to predict the future positions of moving obstacles, and the predict... A new path planning method for mobile robots in globally unknown environment with moving obstacles is pre- sented. With an autoregressive (AR) model to predict the future positions of moving obstacles, and the predicted position taken as the next position of moving obstacles, a motion path in dynamic uncertain environment is planned by means of an on-line real-time path planning technique based on polar coordinates in which the desirable direction angle is taken into consideration as an optimization index. The effectiveness, feasibility, high stability, perfect performance of obstacle avoidance, real-time and optimization capability are demonstrated by simulation examples. 展开更多
关键词 Mobile robot dynamic obstacle Autoregressive (AR) prediction On-line real-time path planning Desirable direction angle
在线阅读 下载PDF
Dynamic path planning strategy based on improved RRT^(*)algorithm 被引量:2
5
作者 SUO Chao HE Lile 《Journal of Measurement Science and Instrumentation》 CAS CSCD 2022年第2期198-208,共11页
In order to solve the problem of path planning of mobile robots in a dynamic environment,an improved rapidly-exploring random tree^(*)(RRT^(*))algorithm is proposed in this paper.First,the target bias sampling is intr... In order to solve the problem of path planning of mobile robots in a dynamic environment,an improved rapidly-exploring random tree^(*)(RRT^(*))algorithm is proposed in this paper.First,the target bias sampling is introduced to reduce the randomness of the RRT^(*)algorithm,and then the initial path planning is carried out in a static environment.Secondly,apply the path in a dynamic environment,and use the initially planned path as the path cache.When a new obstacle appears in the path,the invalid path is clipped and the path is replanned.At this time,there is a certain probability to select the point in the path cache as the new node,so that the new path maintains the trend of the original path to a greater extent.Finally,MATLAB is used to carry out simulation experiments for the initial planning and replanning algorithms,respectively.More specifically,compared with the original RRT^(*)algorithm,the simulation results show that the number of nodes used by the new improved algorithm is reduced by 43.19%on average. 展开更多
关键词 mobile robot path planning rapidly-exploring random tree^(*)(RRT^(*))algorithm dynamic environment target bias sampling
在线阅读 下载PDF
Path Planning of UAV by Combing Improved Ant Colony System and Dynamic Window Algorithm 被引量:2
6
作者 徐海芹 邢浩翔 刘洋 《Journal of Donghua University(English Edition)》 CAS 2023年第6期676-683,共8页
A fusion algorithm is proposed to enhance the search speed of an ant colony system(ACS)for the global path planning and overcome the challenges of the local path planning in an unmanned aerial vehicle(UAV).The ACS sea... A fusion algorithm is proposed to enhance the search speed of an ant colony system(ACS)for the global path planning and overcome the challenges of the local path planning in an unmanned aerial vehicle(UAV).The ACS search efficiency is enhanced by adopting a 16-direction 24-neighborhood search way,a safety grid search way,and an elite hybrid strategy to accelerate global convergence.Quadratic planning is performed using the moving average(MA)method.The fusion algorithm incorporates a dynamic window approach(DWA)to deal with the local path planning,sets a retracement mechanism,and adjusts the evaluation function accordingly.Experimental results in two environments demonstrate that the improved ant colony system(IACS)achieves superior planning efficiency.Additionally,the optimized dynamic window approach(ODWA)demonstrates its ability to handle multiple dynamic situations.Overall,the fusion optimization algorithm can accomplish the mixed path planning effectively. 展开更多
关键词 ant colony system(ACS) dynamic window approach(DWA) path planning dynamic obstacle
在线阅读 下载PDF
Path Planning Based on A-Star and Dynamic Window Approach Algorithm for Wild Environment 被引量:1
7
作者 DONG Dejin DONG Shiyin +1 位作者 ZHANG Lulu CAI Yunze 《Journal of Shanghai Jiaotong university(Science)》 EI 2024年第4期725-736,共12页
The path planning problem of complex wild environment with multiple elements still poses challenges.This paper designs an algorithm that integrates global and local planning to apply to the wild environmental path pla... The path planning problem of complex wild environment with multiple elements still poses challenges.This paper designs an algorithm that integrates global and local planning to apply to the wild environmental path planning.The modeling process of wild environment map is designed.Three optimization strategies are designed to improve the A-Star in overcoming the problems of touching the edge of obstacles,redundant nodes and twisting paths.A new weighted cost function is designed to achieve different planning modes.Furthermore,the improved dynamic window approach(DWA)is designed to avoid local optimality and improve time efficiency compared to traditional DWA.For the necessary path re-planning of wild environment,the improved A-Star is integrated with the improved DWA to solve re-planning problem of unknown and moving obstacles in wild environment with multiple elements.The improved fusion algorithm effectively solves problems and consumes less time,and the simulation results verify the effectiveness of improved algorithms above. 展开更多
关键词 path planning path re-planning wild environment A-Star algorithm dynamic window approach
原文传递
Cooperative Path Dynamic Planning Model of UCAV Team Based on Global Optimization Method
8
作者 Xiao-Cheng Zhou Jian-Gang Yan Rong Chen 《Journal of Electronic Science and Technology》 CAS 2012年第4期363-367,共5页
Cooperative path dynamic planning of a UCAV (unmanned combat air vehicle) team not only considers the capability of task requirement of single UCAV, but also considers the cooperative dynamic connection among member... Cooperative path dynamic planning of a UCAV (unmanned combat air vehicle) team not only considers the capability of task requirement of single UCAV, but also considers the cooperative dynamic connection among members of the UCAV team. A cooperative path dynamic planning model of the UCAV team by applying a global optimization method is discussed in this paper and the corresponding model is built and analyzed. By the example simulation, the reasonable result acquired indicates that the model could meet dynamic planning demand under the circumstance of membership functions. The model is easy to be realized and has good practicability. 展开更多
关键词 Cooperative path dynamic planning global optimization unmanned combat air vehicle team.
在线阅读 下载PDF
Path Planning of Quadrotors in a Dynamic Environment Using a Multicriteria Multi-Verse Optimizer
9
作者 Raja Jarray Mujahed Al-Dhaifallah +1 位作者 Hegazy Rezk Soufiene Bouallègue 《Computers, Materials & Continua》 SCIE EI 2021年第11期2159-2180,共22页
Paths planning of Unmanned Aerial Vehicles(UAVs)in a dynamic environment is considered a challenging task in autonomous flight control design.In this work,an efficient method based on a Multi-Objective MultiVerse Opti... Paths planning of Unmanned Aerial Vehicles(UAVs)in a dynamic environment is considered a challenging task in autonomous flight control design.In this work,an efficient method based on a Multi-Objective MultiVerse Optimization(MOMVO)algorithm is proposed and successfully applied to solve the path planning problem of quadrotors with moving obstacles.Such a path planning task is formulated as a multicriteria optimization problem under operational constraints.The proposed MOMVO-based planning approach aims to lead the drone to traverse the shortest path from the starting point and the target without collision with moving obstacles.The vehicle moves to the next position from its current one such that the line joining minimizes the total path length and allows aligning its direction towards the goal.To choose the best compromise solution among all the non-dominated Pareto ones obtained for compromise objectives,the modified Technique for Order Preference by Similarity to Ideal Solution(TOPSIS)is investigated.A set of homologous metaheuristics such as Multiobjective Salp Swarm Algorithm(MSSA),Multi-Objective Grey Wolf Optimizer(MOGWO),Multi-Objective Particle Swarm Optimization(MOPSO),and Non-Dominated Genetic Algorithm II(NSGAII)is used as a basis for the performance comparison.Demonstrative results and statistical analyses show the superiority and effectiveness of the proposed MOMVO-based planning method.The obtained results are satisfactory and encouraging for future practical implementation of the path planning strategy. 展开更多
关键词 Quadrotors path planning dynamic obstacles multi-objective optimization global metaheuristics TOPSIS decision-making Friedman statistical tests
在线阅读 下载PDF
Interactive Heuristic D* Path Planning Solution Based on PSO for Two-Link Robotic Arm in Dynamic Environment
10
作者 Firas A. Raheem Umniah I. Hameed 《World Journal of Engineering and Technology》 2019年第1期80-99,共20页
This paper is devoted to find an intelligent and safe path for two-link robotic arm in dynamic environment. This paper focuses on computational part of motion planning in completely changing dynamic environment at eve... This paper is devoted to find an intelligent and safe path for two-link robotic arm in dynamic environment. This paper focuses on computational part of motion planning in completely changing dynamic environment at every motion sample domains,?since the local minima and sharp edges are the most common problems in all path planning algorithms. In addition, finding a path solution in a dynamic environment represents a challenge for the robotics researchers,?so in this paper, a proposed mixing approach was suggested to overcome all these obstructions. The proposed approach methodology?for obtaining robot interactive path planning solution in known dynamic environment utilizes?the use of modified heuristic D-star (D*) algorithm based on the full free Cartesian space analysis at each motion sample with the Particle Swarm Optimization (PSO) technique.?Also, a modification on the?D* algorithm has been done to match the dynamic environment requirements by adding stop and return backward cases which is not included in the original D* algorithm theory. The resultant interactive path solution was computed by taking into consideration the time and position changes of the moving obstacles. Furthermore, to insure the enhancement of the?final path length optimality, the PSO technique was used.?The simulation results are given to show the effectiveness of the proposed method. 展开更多
关键词 D* Algorithm Particle SWARM Optimization (PSO) path planning TWO-LINK Arm KNOWN dynamic Environment
在线阅读 下载PDF
Improved Bidirectional JPS Algorithm for Mobile Robot Path Planning in Complex Environments
11
作者 Zhaohui An Changyong Li +1 位作者 Yong Han Mengru Niu 《Computers, Materials & Continua》 2025年第4期1347-1366,共20页
This paper introduces an Improved Bidirectional Jump Point Search(I-BJPS)algorithm to address the challenges of the traditional Jump Point Search(JPS)in mobile robot path planning.These challenges include excessive no... This paper introduces an Improved Bidirectional Jump Point Search(I-BJPS)algorithm to address the challenges of the traditional Jump Point Search(JPS)in mobile robot path planning.These challenges include excessive node expansions,frequent path inflexion points,slower search times,and a high number of jump points in complex environments with large areas and dense obstacles.Firstly,we improve the heuristic functions in both forward and reverse directions to minimize expansion nodes and search time.We also introduce a node optimization strategy to reduce non-essential nodes so that the path length is optimized.Secondly,we employ a second-order Bezier Curve to smooth turning points,making generated paths more suitable for mobile robot motion requirements.Then,we integrate the Dynamic Window Approach(DWA)to improve path planning safety.Finally,the simulation results demonstrate that the I-BJPS algorithm significantly outperforms both the original unidirectional JPS algorithm and the bidirectional JPS algorithm in terms of search time,the number of path inflexion points,and overall path length,the advantages of the I-BJPS algorithm are particularly pronounced in complex environments.Experimental results from real-world scenarios indicate that the proposed algorithm can efficiently and rapidly generate an optimal path that is safe,collision-free,and well-suited to the robot’s locomotion requirements. 展开更多
关键词 Bidirectional jump search heuristic function bezier curve dynamic window method path planning
在线阅读 下载PDF
Multiple fixed-wing UAVs collaborative coverage 3D path planning method for complex areas
12
作者 Mengyang Wang Dong Zhang +1 位作者 Chaoyue Li Zhaohua Zhang 《Defence Technology(防务技术)》 2025年第5期197-215,共19页
Complex multi-area collaborative coverage path planning in dynamic environments poses a significant challenge for multi-fixed-wing UAVs(multi-UAV).This study establishes a comprehensive framework that incorporates UAV... Complex multi-area collaborative coverage path planning in dynamic environments poses a significant challenge for multi-fixed-wing UAVs(multi-UAV).This study establishes a comprehensive framework that incorporates UAV capabilities,terrain,complex areas,and mission dynamics.A novel dynamic collaborative path planning algorithm is introduced,designed to ensure complete coverage of designated areas.This algorithm meticulously optimizes the operation,entry,and transition paths for each UAV,while also establishing evaluation metrics to refine coverage sequences for each area.Additionally,a three-dimensional path is computed utilizing an altitude descent method,effectively integrating twodimensional coverage paths with altitude constraints.The efficacy of the proposed approach is validated through digital simulations and mixed-reality semi-physical experiments across a variety of dynamic scenarios,including both single-area and multi-area coverage by multi-UAV.Results show that the coverage paths generated by this method significantly reduce both computation time and path length,providing a reliable solution for dynamic multi-UAV mission planning in semi-physical environments. 展开更多
关键词 Multi-fixed-wing UAVs(multi-UAV) Minimum time cooperative coverage dynamic complete coverage path planning(DCCPP) Dubins curves Improved dynamic programming algorithm(IDP)
在线阅读 下载PDF
Local Path Planning and Tracking Control of Vehicle Collision Avoidance System 被引量:6
13
作者 Xu Zhijiang Zhao Wanzhong +1 位作者 Wang Chunyan Dai Yifan 《Transactions of Nanjing University of Aeronautics and Astronautics》 EI CSCD 2018年第4期729-738,共10页
Automotive collision avoidance technology can effectively avoid the accidents caused by dangerous traffic conditions or driver's manipulation errors.Moreover,it can promote the development of autonomous driving fo... Automotive collision avoidance technology can effectively avoid the accidents caused by dangerous traffic conditions or driver's manipulation errors.Moreover,it can promote the development of autonomous driving for intelligent vehicle in intelligent transportation.We present a collision avoidance system,which is composed of an evasive trajectory planner and a path following controller.Considering the stability of the vehicle in the conflict-free process,the evasive trajectory planner is designed by polynomial parametric method and optimized by genetic algorithm.The path following controller is proposed to make the car drive along the designed path by controlling the vehicle's lateral movement.Simulation results show that the vehicle with the proposed controller has good stability in the collision process,and it can ensure the vehicle driving in accordance with the planned trajectory at different speeds.The research results can provide a certain basis for the research and development of automotive collision avoidance technology. 展开更多
关键词 VEHICLE collision avoidance dynamic model path planning tracking control
在线阅读 下载PDF
Cooperative path planning for multi-AUV in time-varying ocean flows 被引量:9
14
作者 Mingyong Liu Baogui Xu Xingguang Peng 《Journal of Systems Engineering and Electronics》 SCIE EI CSCD 2016年第3期612-618,共7页
For low-speed underwater vehicles, the ocean currents has a great influence on them, and the changes in ocean currents is complex and continuous, thus whose impact must be taken into consideration in the path planning... For low-speed underwater vehicles, the ocean currents has a great influence on them, and the changes in ocean currents is complex and continuous, thus whose impact must be taken into consideration in the path planning. There are still lack of authoritative indicator and method for the cooperating path planning. The calculation of the voyage time is a difficult problem in the time-varying ocean, for the existing methods of the cooperating path planning, the computation time will increase exponentially as the autonomous underwater vehicle(AUV) counts increase, rendering them unfeasible. A collaborative path planning method is presehted for multi-AUV under the influence of time-varying ocean currents based on the dynamic programming algorithm. Each AUV cooperates with the one who has the longest estimated time of sailing, enabling the arrays of AUV to get their common goal in the shortest time with minimum timedifference. At the same time, they could avoid the obstacles along the way to the target. Simulation results show that the proposed method has a promising applicability. 展开更多
关键词 dynamic programming time-varying cooperate path planning autonomous underwater vehicle(AUV)
在线阅读 下载PDF
Collision-Free Path Planning with Kinematic Constraints in Urban Scenarios 被引量:2
15
作者 WANG Liang WANG Bing WANG Chunxiang 《Journal of Shanghai Jiaotong university(Science)》 EI 2021年第5期731-738,共8页
In urban driving scenarios,owing to the presence of multiple static obstacles such as parked cars and roadblocks,planning a collision-free and smooth path remains a challenging problem.In addition,the path-planning pr... In urban driving scenarios,owing to the presence of multiple static obstacles such as parked cars and roadblocks,planning a collision-free and smooth path remains a challenging problem.In addition,the path-planning problem is mostly non-convex,and contains multiple local minima.Therefore,a method for combining a sampling-based method and an optimization-based method is proposed in this paper to generate a collision-free path with kinematic constraints for urban scenarios.The sampling-based method constructs a search graph to search for a seeding path for exploring a safe driving corridor,and the optimization-based method constructs a quadratic programming problem considering the desired state constraints,continuity constraints,driving corridor constraints,and kinematic constraints to perform path optimization.The experimental results show that the proposed method is able to plan a collision-free and smooth path in real time when managing typical urban scenarios. 展开更多
关键词 autonomous vehicle path planning dynamic searching quadratic programming
原文传递
Effective Virtual Reality Based Building Navigation Using Dynamic Loading and Path Optimization 被引量:1
16
作者 Qing-Jin Peng Xiu-Mei Kang Ting-Ting Zhao 《International Journal of Automation and computing》 EI 2009年第4期335-343,共9页
Although computer capabilities have been improved significantly, a large-scale virtual reality (VR) system demands much more in terms of memory and computation than the current computer systems can offer. This paper... Although computer capabilities have been improved significantly, a large-scale virtual reality (VR) system demands much more in terms of memory and computation than the current computer systems can offer. This paper discusses two important issues related to VR performance and applications in building navigation. These are dynamic loading of models based on cell segmentation for the optimal VR operation, and the route optimization based on path planning for easy navigation. The VR model of engineering and information technology complex (EITC) building at the University of Manitoba is built as an example to show the feasibility of the proposed methods. The reality, enhanced by three-dimensional (3D) real-time interactivity and visualization, leads navigators into a state of the virtual building immersion. 展开更多
关键词 Virtual reality (VR) virtual environments (VEs) building navigation dynamic loading cell segmentation path planning
在线阅读 下载PDF
Path Planning of Multi-Axis Robotic Arm Based on Improved RRT* 被引量:1
17
作者 Juanling Liang Wenguang Luo Yongxin Qin 《Computers, Materials & Continua》 SCIE EI 2024年第10期1009-1027,共19页
An improved RRT∗algorithm,referred to as the AGP-RRT∗algorithm,is proposed to address the problems of poor directionality,long generated paths,and slow convergence speed in multi-axis robotic arm path planning.First,a... An improved RRT∗algorithm,referred to as the AGP-RRT∗algorithm,is proposed to address the problems of poor directionality,long generated paths,and slow convergence speed in multi-axis robotic arm path planning.First,an adaptive biased probabilistic sampling strategy is adopted to dynamically adjust the target deviation threshold and optimize the selection of random sampling points and the direction of generating new nodes in order to reduce the search space and improve the search efficiency.Second,a gravitationally adjustable step size strategy is used to guide the search process and dynamically adjust the step-size to accelerate the search speed of the algorithm.Finally,the planning path is processed by pruning,removing redundant points and path smoothing fitting using cubic B-spline curves to improve the flexibility of the robotic arm.Through the six-axis robotic arm path planning simulation experiments on the MATLAB platform,the results show that the AGP-RRT∗algorithm reduces 87.34%in terms of the average running time and 40.39%in terms of the average path cost;Meanwhile,under two sets of complex environments A and B,the average running time of the AGP-RRT∗algorithm is shortened by 94.56%vs.95.37%,and the average path cost is reduced by 55.28%vs.47.82%,which proves the effectiveness of the AGP-RRT∗algorithm in improving the efficiency of multi-axis robotic arm path planning. 展开更多
关键词 Multi-axis robotic arm path planning improved RRT∗algorithm dynamic target deviation threshold dynamic step size path optimization
在线阅读 下载PDF
Variable dimensional state space based global path planning for mobile robot 被引量:1
18
作者 张浩杰 陈慧岩 +2 位作者 姜岩 龚建伟 熊光明 《Journal of Beijing Institute of Technology》 EI CAS 2012年第3期328-335,共8页
A variable dimensional state space(VDSS) has been proposed to improve the re-planning time when the robotic systems operate in large unknown environments.VDSS is constructed by uniforming lattice state space and grid ... A variable dimensional state space(VDSS) has been proposed to improve the re-planning time when the robotic systems operate in large unknown environments.VDSS is constructed by uniforming lattice state space and grid state space.In VDSS,the lattice state space is only used to construct search space in the local area which is a small circle area near the robot,and grid state space elsewhere.We have tested VDSS with up to 80 indoor and outdoor maps in simulation and on segbot robot platform.Through the simulation and segbot robot experiments,it shows that exploring on VDSS is significantly faster than exploring on lattice state space by Anytime Dynamic A*(AD*) planner and VDSS is feasible to be used on robotic systems. 展开更多
关键词 variable dimensional state space lattice state space Anytime dynamic A*(AD*)path planning
在线阅读 下载PDF
Parallel Evaluation of a Spatial Traversability Cost Function on GPU for Efficient Path Planning
19
作者 Stephen Cossell Jose Guivant 《Journal of Intelligent Learning Systems and Applications》 2011年第4期191-200,共10页
A parallel version of the traditional grid based cost-to-go function generation algorithm used in robot path planning is introduced. The process takes advantage of the spatial layout of an occupancy grid by concurrent... A parallel version of the traditional grid based cost-to-go function generation algorithm used in robot path planning is introduced. The process takes advantage of the spatial layout of an occupancy grid by concurrently calculating the next wave front of grid cells usually evaluated sequentially in traditional dynamic programming algorithms. The algorithm offers an order of magnitude increase in run time for highly obstacle dense worst-case environments. Efficient path planning of real world agents can greatly increase their accuracy and responsiveness. The process and theoretical analysis are covered before the results of practical testing are discussed. 展开更多
关键词 GPGPU dynamic PROGRAMMING CONCURRENT PROGRAMMING path planning
暂未订购
Dynamic collision avoidance for cooperative fixed-wing UAV swarm based on normalized artificial potential field optimization 被引量:12
20
作者 LIU Wei-heng ZHENG Xin DENG Zhi-hong 《Journal of Central South University》 SCIE EI CAS CSCD 2021年第10期3159-3172,共14页
Cooperative path planning is an important area in fixed-wing UAV swarm.However,avoiding multiple timevarying obstacles and avoiding local optimum are two challenges for existing approaches in a dynamic environment.Fir... Cooperative path planning is an important area in fixed-wing UAV swarm.However,avoiding multiple timevarying obstacles and avoiding local optimum are two challenges for existing approaches in a dynamic environment.Firstly,a normalized artificial potential field optimization is proposed by reconstructing a novel function with anisotropy in each dimension,which can make the flight speed of a fixed UAV swarm independent of the repulsive/attractive gain coefficient and avoid trapping into local optimization and local oscillation.Then,taking into account minimum velocity and turning angular velocity of fixed-wing UAV swarm,a strategy of decomposing target vector to avoid moving obstacles and pop-up threats is proposed.Finally,several simulations are carried out to illustrate superiority and effectiveness. 展开更多
关键词 fixed-wing UAV swarm cooperative path planning normalized artificial potential field dynamic obstacle avoidance local optimization
在线阅读 下载PDF
上一页 1 2 49 下一页 到第
使用帮助 返回顶部