Sign in to use this feature.

Years

Between: -

Subjects

remove_circle_outline
remove_circle_outline
remove_circle_outline
remove_circle_outline
remove_circle_outline
remove_circle_outline
remove_circle_outline
remove_circle_outline

Journals

Article Types

Countries / Regions

Search Results (68)

Search Parameters:
Keywords = A-Star algorithm (AS)

Order results
Result details
Results per page
Select all
Export citation of selected articles as:
19 pages, 6362 KB  
Article
Micro-Platform Verification for LiDAR SLAM-Based Navigation of Mecanum-Wheeled Robot in Warehouse Environment
by Yue Wang, Ying Yu Ye, Wei Zhong, Bo Lin Gao, Chong Zhang Mu and Ning Zhao
World Electr. Veh. J. 2025, 16(10), 571; https://doi.org/10.3390/wevj16100571 - 8 Oct 2025
Viewed by 357
Abstract
Path navigation for mobile robots critically determines the operational efficiency of warehouse logistics systems. However, the current QR (Quick Response) code path navigation for warehouses suffers from low operational efficiency and poor dynamic adaptability in complex dynamic environments. This paper introduces a deep [...] Read more.
Path navigation for mobile robots critically determines the operational efficiency of warehouse logistics systems. However, the current QR (Quick Response) code path navigation for warehouses suffers from low operational efficiency and poor dynamic adaptability in complex dynamic environments. This paper introduces a deep reinforcement learning and hybrid-algorithm SLAM (Simultaneous Localization and Mapping) path navigation method for Mecanum-wheeled robots, validated with an emphasis on dynamic adaptability and real-time performance. Based on the Gazebo warehouse simulation environment, the TD3 (Twin Deep Deterministic Policy Gradient) path planning method was established for offline training. Then, the Astar-Time Elastic Band (TEB) hybrid path planning algorithm was used to conduct experimental verification in static and dynamic real-world scenarios. Finally, experiments show that the TD3-based path planning for mobile robots makes effective decisions during offline training in the simulation environment, while Astar-TEB accurately completes path planning and navigates around both static and dynamic obstacles in real-world scenarios. Therefore, this verifies the feasibility and effectiveness of the proposed SLAM path navigation for Mecanum-wheeled mobile robots on a miniature warehouse platform. Full article
(This article belongs to the Special Issue Research on Intelligent Vehicle Path Planning Algorithm)
Show Figures

Figure 1

32 pages, 6588 KB  
Article
Path Planning for Unmanned Aerial Vehicle: A-Star-Guided Potential Field Method
by Jaewan Choi and Younghoon Choi
Drones 2025, 9(8), 545; https://doi.org/10.3390/drones9080545 - 1 Aug 2025
Viewed by 972
Abstract
The utilization of Unmanned Aerial Vehicles (UAVs) in missions such as reconnaissance and surveillance has grown rapidly, underscoring the need for efficient path planning algorithms that ensure both optimality and collision avoidance. The A-star algorithm is widely used for global path planning due [...] Read more.
The utilization of Unmanned Aerial Vehicles (UAVs) in missions such as reconnaissance and surveillance has grown rapidly, underscoring the need for efficient path planning algorithms that ensure both optimality and collision avoidance. The A-star algorithm is widely used for global path planning due to its ability to generate optimal routes; however, its high computational cost makes it unsuitable for real-time applications, particularly in unknown or dynamic environments. For local path planning, the Artificial Potential Field (APF) algorithm enables real-time navigation by attracting the UAV toward the target while repelling it from obstacles. Despite its efficiency, APF suffers from local minima and limited performance in dynamic settings. To address these challenges, this paper proposes the A-star-Guided Potential Field (AGPF) algorithm, which integrates the strengths of A-star and APF to achieve robust performance in both global and local path planning. The AGPF algorithm was validated through simulations conducted in the Robot Operating System (ROS) environment. Simulation results demonstrate that AGPF produces smoother and more optimal paths than A-star, while avoiding the local minima issues inherent in APF. Furthermore, AGPF effectively handles moving and previously unknown obstacles by generating real-time avoidance trajectories, demonstrating strong adaptability in dynamic and uncertain environments. Full article
Show Figures

Figure 1

40 pages, 7941 KB  
Article
Synergistic Hierarchical AI Framework for USV Navigation: Closing the Loop Between Swin-Transformer Perception, T-ASTAR Planning, and Energy-Aware TD3 Control
by Haonan Ye, Hongjun Tian, Qingyun Wu, Yihong Xue, Jiayu Xiao, Guijie Liu and Yang Xiong
Sensors 2025, 25(15), 4699; https://doi.org/10.3390/s25154699 - 30 Jul 2025
Cited by 1 | Viewed by 829
Abstract
Autonomous Unmanned Surface Vehicle (USV) operations in complex ocean engineering scenarios necessitate robust navigation, guidance, and control technologies. These systems require reliable sensor-based object detection and efficient, safe, and energy-aware path planning. To address these multifaceted challenges, this paper proposes a novel synergistic [...] Read more.
Autonomous Unmanned Surface Vehicle (USV) operations in complex ocean engineering scenarios necessitate robust navigation, guidance, and control technologies. These systems require reliable sensor-based object detection and efficient, safe, and energy-aware path planning. To address these multifaceted challenges, this paper proposes a novel synergistic AI framework. The framework integrates (1) a novel adaptation of the Swin-Transformer to generate a dense, semantic risk map from raw visual data, enabling the system to interpret ambiguous marine conditions like sun glare and choppy water, enabling real-time environmental understanding crucial for guidance; (2) a Transformer-enhanced A-star (T-ASTAR) algorithm with spatio-temporal attentional guidance to generate globally near-optimal and energy-aware static paths; (3) a domain-adapted TD3 agent featuring a novel energy-aware reward function that optimizes for USV hydrodynamic constraints, making it suitable for long-endurance missions tailored for USVs to perform dynamic local path optimization and real-time obstacle avoidance, forming a key control element; and (4) CUDA acceleration to meet the computational demands of real-time ocean engineering applications. Simulations and real-world data verify the framework’s superiority over benchmarks like A* and RRT, achieving 30% shorter routes, 70% fewer turns, 64.7% fewer dynamic collisions, and a 215-fold speed improvement in map generation via CUDA acceleration. This research underscores the importance of integrating powerful AI components within a hierarchical synergy, encompassing AI-based perception, hierarchical decision planning for guidance, and multi-stage optimal search algorithms for control. The proposed solution significantly advances USV autonomy, addressing critical ocean engineering challenges such as navigation in dynamic environments, object avoidance, and energy-constrained operations for unmanned maritime systems. Full article
Show Figures

Figure 1

25 pages, 5449 KB  
Article
A Contribution of Shortest Paths Algorithms to the NetworkX Python Library
by Miguel Cruz, Rui Carvalho, André Costa, Luis Pinto, Luis Dias, Paulino Cerqueira, Rodrigo Machado, Tiago Batista, Pedro Castro and Jorge Ribeiro
Appl. Sci. 2025, 15(15), 8273; https://doi.org/10.3390/app15158273 - 25 Jul 2025
Viewed by 2192
Abstract
NetworkX is a free Python library for graphs and networks and is used in many applications and projects to find the shortest path in path planning scenarios. For dense graphs, the library provides the Floyd–Warshall algorithm for shortest paths and the A* (“A-Star”) [...] Read more.
NetworkX is a free Python library for graphs and networks and is used in many applications and projects to find the shortest path in path planning scenarios. For dense graphs, the library provides the Floyd–Warshall algorithm for shortest paths and the A* (“A-Star”) algorithm for shortest paths and path lengths. However, several extensions have been proposed to improve the A*, but they are not included in the library. In this context, this paper presents a set of implementations improving the A*, such as the IDA*, D* Lite, SMA*, Bidirectional A* and RTA*. The goal or challenge is to address the limitations of the A* in specific scenarios, such as searching for an optimal path repeatedly or when confronted with memory limitations, as exemplified by the NetworkX library. To do this, we first review the literature of the usage and general application of NetworkX in different domains of applicability and then explore their usage in a shortest path context. By reviewing and validating the usage of A* and extensions in Python using the NetworkX framework, the implementations were submitted to the network environment validation and passed the tests. We have also done the benchmarking of the A*, comparing it with the new ones, and concluded the better efficiency of the A* extensions in tri-objective scenario parameters (length, cost and toll). Despite the extensive utilisation of A* and its notable efficacy in identifying optimal paths, its performance is suboptimal in specific scenarios, such as when confronted with memory constraints and dynamic environments. Almost every algorithm outperformed or matched the A* in the fields that were developed to have an advantage, demonstrating the quality and robustness of the implemented algorithms. As a contribution and to foster further research in this shortest path specific context field, the dataset and Python code of the algorithms are available in a GitHub opensource repository. Full article
Show Figures

Figure 1

14 pages, 1776 KB  
Article
Dynamic Obstacle Avoidance Approach Based on Integration of A-Star and APF Algorithms for Vehicles in Complex Mountainous Environments
by Changlong Chen, Yuejin Lin, Lulin Zhan, Yuling He, Yi Zhang, Xiqiang Chi and Menghu Chen
Vehicles 2025, 7(3), 65; https://doi.org/10.3390/vehicles7030065 - 29 Jun 2025
Viewed by 596
Abstract
Complex mountainous environments pose significant challenges for dynamic path planning and obstacle avoidance of transport vehicles. In response, this paper presents an innovative path planning approach that combines an enhanced A* algorithm with the artificial potential field (APF) method. Firstly, the heuristic function [...] Read more.
Complex mountainous environments pose significant challenges for dynamic path planning and obstacle avoidance of transport vehicles. In response, this paper presents an innovative path planning approach that combines an enhanced A* algorithm with the artificial potential field (APF) method. Firstly, the heuristic function of the A* algorithm was improved, and path inflection points were optimized to enhance global path-planning efficiency and smoothness. Secondly, a target distance factor was introduced to modify the APF algorithm’s repulsive field function, solving the traditional APF’s target-unreachable problem. The integrated algorithm uses the A*-optimized inflection points as sub-target points for the APF, meeting real-time obstacle avoidance requirements in dynamic environments and conducting secondary path planning to avoid local minima. Impressively, static environment simulations demonstrated the integrated algorithm’s outstanding path-planning capabilities in complex terrains. Moreover, dynamic obstacle avoidance experiments revealed its remarkable ability to not only detect and evade dynamic obstacles but also maintain a safe distance from static ones. The findings highlight that this method significantly boosts path-planning efficiency while ensuring safety and global optimality in dynamic settings. This breakthrough offers crucial theoretical support for enhancing the navigation of mountain transport vehicles in complex, real-world scenarios, potentially improving their operation. Full article
(This article belongs to the Special Issue Design and Control of Autonomous Driving Systems)
Show Figures

Figure 1

25 pages, 3631 KB  
Article
Hybrid Path Planning Method for USV Based on Improved A-Star and DWA
by Yan Liu, Zeqiang Sun, Junhe Wan, Hui Li, Delong Yang, Yanping Li, Wei Fu, Zhen Yu and Jichang Sun
J. Mar. Sci. Eng. 2025, 13(5), 934; https://doi.org/10.3390/jmse13050934 - 9 May 2025
Cited by 1 | Viewed by 1222
Abstract
This paper presents a hybrid path planning method that integrates an enhanced A-Star algorithm with the Dynamic Window Approach (DWA). The proposed approach addresses the limitations of conventional A-Star algorithms in global path planning, particularly their inability to adaptively avoid obstacles in real-time. [...] Read more.
This paper presents a hybrid path planning method that integrates an enhanced A-Star algorithm with the Dynamic Window Approach (DWA). The proposed approach addresses the limitations of conventional A-Star algorithms in global path planning, particularly their inability to adaptively avoid obstacles in real-time. To improve navigation safety, the A-Star search strategy is enhanced by avoiding paths that intersect with obstacle vertices or pass through narrow channels. Additionally, a node optimization technique is introduced to remove redundant nodes by checking for collinearity in consecutive nodes. This optimization reduces the path length and ensures that the path maintains a safe distance from obstacles using parallel lines. An advanced Bézier curve smoothing method is also proposed, which adaptively selects control points to improve path smoothness and driving stability. By incorporating these improvements, the enhanced A-Star algorithm is combined with DWA to facilitate dynamic obstacle avoidance while generating global paths. The method accounts for the kinematic characteristics of the USV, as well as physical constraints such as linear and angular velocities, enabling effective handling of obstacles in dynamic environments and ensuring safe navigation. Simulation results demonstrate that the proposed algorithm generates secure global paths, significantly optimizing node count, path length, and smoothness, while effectively avoiding dynamic obstacles, thus ensuring safe navigation of the USV. Full article
(This article belongs to the Section Ocean Engineering)
Show Figures

Figure 1

21 pages, 5686 KB  
Article
Path Planning for Agricultural UAVs Based on Deep Reinforcement Learning and Energy Consumption Constraints
by Haitao Fu, Zheng Li, Weijian Zhang, Yuxuan Feng, Li Zhu, Yunze Long and Jian Li
Agriculture 2025, 15(9), 943; https://doi.org/10.3390/agriculture15090943 - 26 Apr 2025
Viewed by 1092
Abstract
Traditional pesticide application methods pose systemic threats to sustainable agriculture due to inefficient spraying practices and ecological contamination. Although agricultural drones demonstrate potential to address these challenges, they face critical limitations in energy-constrained complete coverage path planning for field operations. This study proposes [...] Read more.
Traditional pesticide application methods pose systemic threats to sustainable agriculture due to inefficient spraying practices and ecological contamination. Although agricultural drones demonstrate potential to address these challenges, they face critical limitations in energy-constrained complete coverage path planning for field operations. This study proposes a novel BiLG-D3QN algorithm by integrating deep reinforcement learning with Bi-LSTM and Bi-GRU architectures, specifically designed to optimize segmented coverage path planning under payload-dependent energy consumption constraints. The methodology encompasses four components: payload-energy consumption modeling, soybean cultivation area identification using Google Earth Engine-derived spatial distribution data, raster map construction, and enhanced segmented coverage path planning implementation. Through simulation experiments, the BiLG-D3QN algorithm demonstrated superior coverage efficiency, outperforming DDQN by 13.45%, D3QN by 12.27%, Dueling DQN by 14.62%, A-Star by 15.59%, and PPO by 22.15%. Additionally, the algorithm achieved an average redundancy rate of only 2.45%, which is significantly lower than that of DDQN (18.89%), D3QN (17.59%), Dueling DQN (17.59%), A-Star (21.54%), and PPO (25.12%). These results highlight the notable advantages of the BiLG-D3QN algorithm in addressing the challenges of pesticide spraying tasks in agricultural UAV applications. Full article
(This article belongs to the Section Artificial Intelligence and Digital Agriculture)
Show Figures

Figure 1

20 pages, 4731 KB  
Article
Research on Path and Sequence Planning for Multi-Cabin Onboard Transportation of Large Cruise Ships
by Liyang Ju, Xiaoyuan Wu, Yixi Zhao, Jianfeng Liu and Kun Liu
Appl. Sci. 2025, 15(8), 4406; https://doi.org/10.3390/app15084406 - 16 Apr 2025
Cited by 1 | Viewed by 568
Abstract
The utilization of PMCUs (Prefabricated Modular Cabin Units) is a key strategy for enhancing the efficiency and reducing the costs of large cruise ship construction. Effective transportation planning for multiple PMCU cabins, including the paths and sequence, is vital to ensure smooth and [...] Read more.
The utilization of PMCUs (Prefabricated Modular Cabin Units) is a key strategy for enhancing the efficiency and reducing the costs of large cruise ship construction. Effective transportation planning for multiple PMCU cabins, including the paths and sequence, is vital to ensure smooth and timely installation. However, traditional A-Star algorithms for path planning face limitations when it comes to accounting for boundary obstacles, and existing routine sequence planning methods can hardly tackle multi-cabin coupled blocking effects. To address these challenges, an enhanced A-Star algorithm is introduced and designed to handle both grid-based and boundary obstacles in the path planning process for cabin transportation onboard. Additionally, a novel reverse planning strategy is further proposed that addresses the coupling effects arising from inter-cabin mutual blocking by determining the optimal collision-free installation sequence. Integrated with the enhanced A-Star algorithm, this reverse planning strategy effectively eliminates interference between cabin transportation sequences and transportation paths, significantly improving operational efficiency. A comparative analysis across various scenarios further substantiates the practicality and effectiveness of the proposed method, highlighting its potential for real-world application in large-scale cruise ship construction. Full article
(This article belongs to the Section Civil Engineering)
Show Figures

Figure 1

16 pages, 8761 KB  
Article
Study on A-Star Algorithm-Based 3D Path Optimization Method Considering Density of Obstacles
by Yong-Deok Yoo and Jung-Ho Moon
Aerospace 2025, 12(2), 85; https://doi.org/10.3390/aerospace12020085 - 24 Jan 2025
Cited by 4 | Viewed by 1712
Abstract
Collision avoidance and path planning are essential for ensuring safe and efficient UAV operations, particularly in applications like drone delivery and Advanced Air Mobility (AAM). This study introduces an improved algorithm for three-dimensional path planning in obstacle-rich environments, such as urban and industrial [...] Read more.
Collision avoidance and path planning are essential for ensuring safe and efficient UAV operations, particularly in applications like drone delivery and Advanced Air Mobility (AAM). This study introduces an improved algorithm for three-dimensional path planning in obstacle-rich environments, such as urban and industrial areas. The proposed approach integrates the A* search algorithm with a customized heuristic function which incorporates local obstacle density. This modification not only guides the search towards more efficient paths but also minimizes altitude variations and steers the UAV away from high-density obstacle regions. To achieve this, the A* algorithm was adapted to output obstacle density information at each path node, enabling a subsequent refinement process. The path refinement applies a truncation algorithm that considers both path angles and obstacle density, and the refined waypoints serve as control points for Non-Uniform Rational B-Splines (NURBS) interpolation. This process ensures smooth and dynamically feasible trajectories. Numerical simulations were performed using a quadrotor model with integrated PID controllers in environments with varying obstacle densities. The results demonstrate the algorithm’s ability to effectively balance path efficiency and feasibility. Compared to traditional methods, the proposed approach exhibits superior performance in high-obstacle-density environments, validating its effectiveness and practical applicability. Full article
(This article belongs to the Special Issue Challenges and Innovations in Aircraft Flight Control)
Show Figures

Figure 1

24 pages, 3939 KB  
Article
Research on the Decision-Making and Control System Architecture for Autonomous Berthing of MASS
by Haoze Zhang, Yingjun Zhang, Hongrui Lu and Yihan Niu
J. Mar. Sci. Eng. 2024, 12(12), 2293; https://doi.org/10.3390/jmse12122293 - 13 Dec 2024
Viewed by 1175
Abstract
Autonomous berthing is a critical phase in the fully autonomous navigation process of MASS (Maritime Autonomous Surface Ship). However, the autonomous berthing stage of MASS is significantly influenced by environmental factors and involves a wide range of technical fields, making the technology not [...] Read more.
Autonomous berthing is a critical phase in the fully autonomous navigation process of MASS (Maritime Autonomous Surface Ship). However, the autonomous berthing stage of MASS is significantly influenced by environmental factors and involves a wide range of technical fields, making the technology not yet fully mature. Therefore, this paper addresses three key technological challenges related to ship path planning, guidance and motion control, as well as position and state perception. Additionally, it explores the decision-making and control system architecture for autonomous berthing of MASS. An effective autonomous berthing solution for MASS is proposed. Based on vessel berthing maneuvering, a decision-making algorithm for autonomous berthing is designed. The A-star algorithm is optimized, and an expected path for unmanned boat experiments is designed offline using this algorithm. Subsequently, an indirect ship guidance and motion control program is proposed based on a CFDL-MFAC (Compact Form Dynamic Linearization based Model-Free Adaptive Control) algorithm. Experimental results show that the proposed autonomous berthing decision-making and control system architecture can effectively assist the unmanned boat in achieving autonomous berthing and help it to berth in a stable and desirable state. Full article
(This article belongs to the Section Ocean Engineering)
Show Figures

Figure 1

19 pages, 12795 KB  
Article
Dual-Metric-Based Assessment and Topology Generation of Urban Airspace with Quadrant Analysis and Pareto Ranking
by Weizheng Zhang, Hua Wu, Yang Liu, Suyu Zhou, Hailong Dong and Huayu Liu
Aerospace 2024, 11(12), 978; https://doi.org/10.3390/aerospace11120978 - 27 Nov 2024
Viewed by 1230
Abstract
In this study, an urban airspace assessment mechanism is proposed and validated using the actual urban building data, offering a systematic approach to airspace selection for unmanned aerial vehicle (UAV) operations. Two metrics are involved to assess the urban airspace accurately, which are [...] Read more.
In this study, an urban airspace assessment mechanism is proposed and validated using the actual urban building data, offering a systematic approach to airspace selection for unmanned aerial vehicle (UAV) operations. Two metrics are involved to assess the urban airspace accurately, which are the airspace availability and risk to ground population. The former is measured by analyzing the connectivity of the urban airspace which particularly emphasizes the impact of urban features like buildings and obstacles. The latter is quantized by using a previously proposed risk estimation model, with which an urban risk map can be generated. Quadrant analysis and Pareto ranking are then employed to evaluate the available airspace for UAVs. Quadrant analysis maps the urban airspace availability and risk to ground population onto a two-dimensional space. Additionally, Pareto ranking determines a set of Pareto-optimal solutions wherein no objective can be improved without compromising at least one other objective. The topology of urban airspace could be constructed by using the top 50% of grids ranked by Pareto ranking based on the actual building data. A case study is conducted in a densely populated urban area in Changqing District, Jinan, Shandong Province, China. The connectivity of the airspace topology is verified by employing the A-star algorithm to generate a feasible path for UAVs. Full article
(This article belongs to the Section Air Traffic and Transportation)
Show Figures

Figure 1

24 pages, 51328 KB  
Article
A Shortest Distance Priority UAV Path Planning Algorithm for Precision Agriculture
by Guoqing Zhang, Jiandong Liu, Wei Luo, Yongxiang Zhao, Ruiyin Tang, Keyu Mei and Penggang Wang
Sensors 2024, 24(23), 7514; https://doi.org/10.3390/s24237514 - 25 Nov 2024
Cited by 5 | Viewed by 2238
Abstract
Unmanned aerial vehicles (UAVs) have made significant advances in autonomous sensing, particularly in the field of precision agriculture. Effective path planning is critical for autonomous navigation in large orchards to ensure that UAVs are able to recognize the optimal route between the start [...] Read more.
Unmanned aerial vehicles (UAVs) have made significant advances in autonomous sensing, particularly in the field of precision agriculture. Effective path planning is critical for autonomous navigation in large orchards to ensure that UAVs are able to recognize the optimal route between the start and end points. When UAVs perform tasks such as crop protection, monitoring, and data collection in orchard environments, they must be able to adapt to dynamic conditions. To address these challenges, this study proposes an enhanced Q-learning algorithm designed to optimize UAV path planning by combining static and dynamic obstacle avoidance features. A shortest distance priority (SDP) strategy is integrated into the learning process to minimize the distance the UAV must travel to reach the target. In addition, the root mean square propagation (RMSP) method is used to dynamically adjust the learning rate according to gradient changes, which accelerates the learning process and improves path planning efficiency. In this study, firstly, the proposed method was compared with state-of-the-art path planning techniques (including A-star, Dijkstra, and traditional Q-learning) in terms of learning time and path length through a grid-based 2D simulation environment. The results showed that the proposed method significantly improved performance compared to existing methods. In addition, 3D simulation experiments were conducted in the AirSim virtual environment. Due to the complexity of the 3D state, a deep neural network was used to calculate the Q-value based on the proposed algorithm. The results indicate that the proposed method can achieve the shortest path planning and obstacle avoidance operations in an orchard 3D simulation environment. Therefore, drones equipped with this algorithm are expected to make outstanding contributions to the development of precision agriculture through intelligent navigation and obstacle avoidance. Full article
(This article belongs to the Special Issue Application of UAV and Sensing in Precision Agriculture)
Show Figures

Figure 1

18 pages, 5037 KB  
Article
Improved A-STAR Algorithm for Power Line Inspection UAV Path Planning
by Yanchu Li, Xinzhou Dong, Qingqing Ding, Yinlong Xiong, Huilian Liao and Tao Wang
Energies 2024, 17(21), 5364; https://doi.org/10.3390/en17215364 - 28 Oct 2024
Cited by 8 | Viewed by 2066
Abstract
The operational areas for unmanned aerial vehicles (UAVs) used in power line inspection are highly complex; thus, the best path planning under known obstacles is of significant research value for UAVs. This paper establishes a three-dimensional spatial environment based on the gridding and [...] Read more.
The operational areas for unmanned aerial vehicles (UAVs) used in power line inspection are highly complex; thus, the best path planning under known obstacles is of significant research value for UAVs. This paper establishes a three-dimensional spatial environment based on the gridding and filling of two-dimensional maps, simulates a variety of obstacles, and proposes a new optimization algorithm based on the A-STAR algorithm, considering the unique dynamics and control characteristics of quadcopter UAVs. By utilizing a novel heuristic evaluation function and uniformly applied quadratic B-spline curve smoothing, the planned path is optimized to better suit UAV inspection scenarios. Compared to the traditional A-STAR algorithm, this method offers improved real-time performance and global optimal solution-solving capabilities and is capable of planning safer and more realistic flight paths based on the operational characteristics of quadcopter UAVs in mountainous environments for power line inspection. Full article
(This article belongs to the Section F3: Power Electronics)
Show Figures

Figure 1

24 pages, 14060 KB  
Article
Multi-Objective Route Planning Model for Ocean-Going Ships Based on Bidirectional A-Star Algorithm Considering Meteorological Risk and IMO Guidelines
by Yingying Wang, Longxia Qian, Mei Hong, Yaoshuai Luo and Dongyv Li
Appl. Sci. 2024, 14(17), 8029; https://doi.org/10.3390/app14178029 - 8 Sep 2024
Cited by 6 | Viewed by 2071
Abstract
In this study, a new route planning model is proposed to help ocean-going ships avoid dangerous weather conditions and ensure safe ship navigation. First, we integrate ocean-going ship vulnerability into the study of the influence of meteorological and oceanic factors on navigational risk. [...] Read more.
In this study, a new route planning model is proposed to help ocean-going ships avoid dangerous weather conditions and ensure safe ship navigation. First, we integrate ocean-going ship vulnerability into the study of the influence of meteorological and oceanic factors on navigational risk. A multi-layer fuzzy comprehensive evaluation model for weather risk assessment is established. A multi-objective nonlinear route planning model is then constructed by comprehensively considering the challenges of fuel consumption, risk, and time during ship navigation. The International Maritime Organization (IMO) guidelines are highlighted as constraints in the calculations, and wind, wave, and calm water resistance to ships in the latest ITTC method is added to the fuel consumption and sailing time in the objective function. Finally, considering the large amount of data required for ocean voyages, the bidirectional A* algorithm is applied to solve the model and reduce the planning time. Furthermore, our model is applied to the case of an accident reported in the Singapore Maritime Investigation Report, and the results show that the model-planned route is very close to the original planned route using the Towing Manual, with an average fit of 98.22%, and the overall meteorological risk of the model-planned route is 11.19% smaller than the original route; our model can therefore be used to plan a safer route for the vessel. In addition, the importance of risk assessments and the IMO guidelines as well as the efficiency of the bidirectional A* algorithm were analyzed and discussed. The results show that the model effectively lowers the meteorological risk, is more efficient than the traditional route planning algorithm, and is 86.82% faster than the Dijkstra algorithm and 49.16% faster than the A* algorithm. Full article
(This article belongs to the Section Marine Science and Engineering)
Show Figures

Figure 1

25 pages, 7064 KB  
Article
Research on Trajectory Planning of Autonomous Vehicles in Constrained Spaces
by Yunlong Li, Gang Li and Xizheng Wang
Sensors 2024, 24(17), 5746; https://doi.org/10.3390/s24175746 - 4 Sep 2024
Cited by 7 | Viewed by 2232
Abstract
This paper addresses the challenge of trajectory planning for autonomous vehicles operating in complex, constrained environments. The proposed method enhances the hybrid A-star algorithm through back-end optimization. An adaptive node expansion strategy is introduced to handle varying environmental complexities. By integrating Dijkstra’s shortest [...] Read more.
This paper addresses the challenge of trajectory planning for autonomous vehicles operating in complex, constrained environments. The proposed method enhances the hybrid A-star algorithm through back-end optimization. An adaptive node expansion strategy is introduced to handle varying environmental complexities. By integrating Dijkstra’s shortest path search, the method improves direction selection and refines the estimated cost function. Utilizing the characteristics of hybrid A-star path planning, a quadratic programming approach with designed constraints smooths discrete path points. This results in a smoothed trajectory that supports speed planning using S-curve profiles. Both simulation and experimental results demonstrate that the improved hybrid A-star search significantly boosts efficiency. The trajectory shows continuous and smooth transitions in heading angle and speed, leading to notable improvements in trajectory planning efficiency and overall comfort for autonomous vehicles in challenging environments. Full article
(This article belongs to the Section Navigation and Positioning)
Show Figures

Figure 1

Back to TopTop