Next Article in Journal
Continuous Estimation of Heart Rate Variability from Electrocardiogram and Photoplethysmogram Signals with Oscillatory Wavelet Pattern Method
Previous Article in Journal
CModel: An Informer-Based Model for Robust Molecular Communication Signal Detection
 
 
Font Type:
Arial Georgia Verdana
Font Size:
Aa Aa Aa
Line Spacing:
Column Width:
Background:
Article

Integration of Vehicle–Terrain Interaction and Fuzzy Cost Adaptation for Robust Path Planning

1
School of Mechanical Science and Engineering, Huazhong University of Science and Technology, Wuhan 430074, China
2
Northern Vehicle Research Institute, Beijing 100072, China
*
Author to whom correspondence should be addressed.
Sensors 2025, 25(17), 5454; https://doi.org/10.3390/s25175454
Submission received: 24 June 2025 / Revised: 15 August 2025 / Accepted: 21 August 2025 / Published: 3 September 2025
(This article belongs to the Section Vehicular Sensing)

Abstract

This paper proposes an adaptive path-planning algorithm for unmanned ground vehicles (UGVs) in three-dimensional terrain environments. The algorithm first constructs an interference model between the UGV chassis and the three-dimensional terrain, taking into account the impact of terrain undulations on vehicle driving stability. A dynamic cost-adjustment mechanism for multi-task modes was designed, which introduces a learning model to automatically identify task types and dynamically adjust the weights of various cost factors in path planning accordingly. This paper constructs simulation environments for sparse obstacle scenes and high-density obstacle scenes, respectively, to verify the effectiveness of the path-planning results of the algorithm in different task modes. The experimental results show that the proposed method can generate smoother, safer, and more task-matched trajectory paths while ensuring path feasibility, verifying the good adaptability and robustness of this algorithm for complex unstructured environments under multi-task driving conditions.

1. Introduction

In recent years, with the development of machine learning and autonomous driving technology, the application scenarios of unmanned equipment have become increasingly widespread. As a typical type of unmanned equipment, UGVs are also widely used in disaster relief, security patrols, mining transportation, logistics distribution, and other fields and have high research value. However, in some complex environments, how to enable a UGV to efficiently and safely avoid obstacles and dynamically change path-planning strategies according to the characteristics of the current task has also become one of the key technical challenges in the research of intelligent unmanned systems.
Currently, path-planning algorithms are mainly divided into three categories: sampling-based methods, trajectory-generation-based methods, and graph-search-based methods. Among these are sampling-based methods such as the Probabilistic Roadmap (PRM) and Rapidly Exploring Random Tree (RRT) algorithms. The PRM algorithm constructs a global graph through node sampling and connectivity detection within a predefined space and is suitable for global path searching in static environments [1,2]; The RRT algorithm has the advantage of fast searching by continuously expanding from the starting point to the target area, making it suitable for dynamic environments. However, the optimality and smoothness of the generated path cannot be guaranteed [3,4,5,6,7].
In contrast, path-planning methods based on a graph search, such as the Dijkstra algorithm and the A* algorithm, are still widely used in complex environments due to their clear structure and controllable search process. The A* algorithm combines heuristic search strategies with cost function and has become the core algorithm in many practical path-planning systems [8]. However, when constructing paths in grid maps, the traditional A* algorithm often results in paths composed of a large number of adjacent grid nodes, leading to issues such as excessive node expansion, redundant paths, and low search efficiency. This is particularly challenging in scenarios with significant terrain variations or dense threat zones [9,10,11,12,13,14].
To address this problem, Duan, C. proposed an evaluation function to optimize the hybrid A* algorithm, which makes the paths obtained by the algorithm smoother by introducing angular penalty coefficients, in addition to successfully improving the search efficiency of the optimal paths by introducing a node-expansion method for the optimal step size [15]. Sheng W proposed an automated parking trajectory-planning method for unstructured environments in narrow aisles, where the global path is searched and planned by a multilevel hybrid A* algorithm, and then the rough path is optimized by a numerical optimization layer with a time-optimized velocity profile to generate an accurate trajectory [16]. Meng T proposed an improved hybrid A* algorithm for the unfamiliar and complex scenarios of automated parking, integrating field potentials in the path-search phase to avoid obstacles and adopting a multi-stage dynamic optimization strategy, which divides the path planning into multiple phases, to effectively improve the path safety [17]. Chi Z proposed a non-omni-directionally constrained robot path-planning method and designed an improved hybrid A* algorithm to achieve high-precision global path planning and navigation. The algorithm combines the model predictive control (MPC) theory for local path planning and obstacle avoidance, which effectively improves the path-planning efficiency and navigational accuracy in complex environments [18]. Zhao Y proposed a hybrid A* path-planning algorithm based on multi-objective constraints. The method introduces a penalty mechanism for obstacles based on the traditional hybrid A* algorithm to avoid the path from getting too close to the obstacles while considering the smoothness and safety of the path through multi-objective optimization. In the path-fitting stage, a post-processing method is used to generate a drivable path with a continuously varying curvature using multi-objective constraints [19]. Zhao K proposed an improved hybrid A* path-planning algorithm for automated parking scenarios for cars, which searches for a path to reach the target point by using the circular spline curve as a reference path and the points on the reference path as the target point of the hybrid A* algorithm [20]. Sun Y proposed a hybrid path-planning method combining an improved A* algorithm with the Dynamic Window Approach (DWA), where a bidirectional search strategy and an adaptive heuristic function are introduced into global path planning, which effectively improves the search efficiency, reduces redundant search nodes, and improves the path smoothness by using cubic B-spline curves [21].
Although hybrid A* has produced many results in optimizing node search efficiency and path smoothness, there is still room for further research to verify its effectiveness in complex environments. Ren B proposed variable radius RS curves to improve the flexibility of the path search, while path optimization based on Bessel curves and the gradient-descent method was used to improve the path quality [22]. Chi X optimized the node expansion direction by increasing the resolution of the steering angle and combining a reverse search strategy with the A* algorithm’s cost map, which allows for generating shorter and smoother paths in parking scenarios [23]. Deng H designed a trajectory tracker based on a vehicle dynamics model, which integrally plans the path trajectory under obstacle-avoidance conditions by introducing an obstacle-avoidance function [24].
Fuzzy logic control is widely used in path planning in complex unknown environments due to its advantages in handling uncertain information [25,26,27,28]. Traditional fuzzy controllers have certain limitations in rule formulation and parameter adjustment, which can be effectively solved by combining fuzzy control with neural networks to form fuzzy neural networks [29,30,31,32,33]. This is because the neural network can effectively deal with the uncertainty of environmental information and improve the robustness of path planning. Secondly, the adaptive learning capability of neural networks enables the system to adjust the parameters online and adapt to the dynamically changing environment [34,35,36,37,38,39,40]. Therefore, optimizing the cost weights in the path-planning process by means of fuzzy neural networks can make the generated paths smoother, improve the feasibility and safety of the paths, and increase the efficiency of the path search.
Based on a comprehensive analysis of the limitations of existing path-planning algorithms, how to effectively integrate terrain elevation information with unmanned vehicle motion models in complex terrain environments, improve path-planning accuracy and feasibility, reduce overall path costs, and achieve planning responses to hazardous areas have become key technical issues that need to be addressed urgently. In response to the above challenges, this paper proposes an Adaptive Dynamic Path (ADP) planning algorithm for unstructured three-dimensional terrain environments to improve the path feature rationality and environmental adaptability of ground unmanned vehicles in complex environments. The algorithm makes full use of three-dimensional maps containing elevation information and combines the dynamic characteristics of the chassis suspension of unmanned vehicles to construct an interference detection mechanism between the vehicle model and the terrain, thereby achieving precise modeling and dynamic constraints on the terrain passability. At the same time, multiple cost items (such as terrain roughness, obstacle distance, and danger-zone risk) are introduced into the path cost-evaluation process. By introducing a neural network and combining it with the Euclidean distance constraint mechanism, the weight coefficients in the path cost function are dynamically adjusted to construct a cost function that can be dynamically adjusted according to the task requirements.

2. A Costly Hybrid A* Algorithm Incorporating Fuzzy Neural Networks

This paper proposes a dynamic cost factor hybrid A* path-planning algorithm that integrates fuzzy neural networks. By constructing a corresponding set of performance indicators and using multiple key indicators, a path-evaluation function is constructed using a weighted aggregation method.
First, based on the degrees of freedom of the autonomous vehicle, its steering angle is discretized. Then, combining the forward and reverse gears, a set of alternative trajectories is formed that extends to neighboring areas. Finally, the alternative trajectories are evaluated to determine the optimal option, as shown in Figure 1. The green area indicates the current location, and the orange area indicates the drivable area.
Determine whether the unmanned vehicle will collide with obstacles by calculating the minimum distance between the grid on the planned path and the obstacles, as shown in the following formula:
d ( n i , o ) = m i n n i o | | n i o j | | 2
where n i is the grid point on the path, O is the set of obstacles, and a collision is considered to have occurred if there exists d ( n i , O ) that is less than the safe-distance threshold.
When there are no obstacles within the pre-planned path, the optimal path from the starting point to the goal point is output. Save the steering angle with the forward direction as shown in the following equation:
p o = argmin i = 1 m 1 | | n i + 1 n i | |
θ i = a r c t a n ( y i + 1 y i x i + 1 x i )
where p o is the optimal path, m is the total number of nodes on the path, n i indicates the i path node on the path, and θ i is the steering angle from node n i to n i + 1 .
Unlike traditional hybrid A* path-planning serial algorithms, this algorithm treats the pitch angle, roll angle, and ground clearance of the UGVs at discrete nodes on the map as passable features of the three-dimensional terrain. By combining the current road environment with the task objectives of the unmanned vehicle, fuzzy neural networks are used to train the weight coefficients of various costs under different conditions. Finally, an evaluation function is used to obtain the optimal path.

2.1. Functional Framework of Fuzzy Neural Networks

First, collect external environmental information from the map and obtain the current vehicle motion status. Then, input the constraints from the current path-planning process into the fuzzy neural network to obtain the dynamic cost weighting coefficient for the optimal path evaluation index, thereby calculating the best path.
By inputting environmental status perception quantities, such as the type of task for the unmanned vehicle, obstacle density, ground unevenness, energy margin, and vehicle health status, the data in the input layer is normalized and input into the second layer. The input–output relationship of the nodes in this layer is as follows:
x i ( 1 ) = x i ( 0 )   i = 1,2 , 3,4 , 5
where x i ( 0 ) is the original output layer, and x i ( 1 ) is the first-layer input value.
The second layer of fuzzification converts the input environmental state perception parameters into fuzzy variables through corresponding membership functions., where x 1 is a preset value including four mission modes: conveying, reconnaissance, sweeping, and UGV take-off and landing. x 2 can be fuzzed as k 2 : no barriers, no access, and occupancy in general. x 3 can be blurred into k 3 : completely flat and undulating. x 4 can be blurred into k 4 : Lack of energy and sufficient energy. x 5 can be fuzzified as k 5 : vehicle failure and vehicle health. The fuzzified parameters are input into the fuzzy inference layer.
The third layer is the fuzzy inference layer, which is defined in this paper as the sensitivity of each input parameter to different output costs. For example, in conveying mode, fuzzy reasoning schemes include high sensitivity to terrain uncertainty, prioritizing avoidance of obstacles, sensitivity to gear changes and steering changes, prioritizing avoidance of danger points, and sensitivity to road bumpiness.
The fourth layer is the normalization layer, with the same number of nodes as the third layer, and it implements the normalization computation as follows:
x j ( 4 ) = x j 3 i = 1 324 x i 3   j = 1,2 , 3 , n
where x j 3 is the output of the j node, and x j ( 4 ) is the normalized result.
The fifth layer is the output layer that converts the inference results into specific cost weights and passes them to the path-planning module as shown in the following equation:
y i = j = 1 324 w i j x j ( 4 )   i = 1,2 , 3 , 8 ;   j = 1,2 , 3 , n
where y i corresponds to the weighting coefficients of the eight cost factors in path planning, including the terrain uncertainty cost, obstacle distance cost, road length cost, gear shift cost, cornering cost, steering change cost, hazardous point distance cost, and bumps cost.
By dividing the four input parameters into low, medium, and high language values, the weighted sum of each cost weight can be obtained as
J t o t a l = i = 1 8 w i f i
where w i is the weight coefficient of item i and f i is the path cost component of item i .
Different input parameters affect the output cost weighting strategies as shown below, and ten typical cases of them are listed, as shown in Table 1. In the learning process of a fuzzy neural network, the error function is used to measure the deviation between the network output and the desired output, as shown in the following equation:
E = 1 2 i = 2 r ( y d i y i ) 2
where E is the error cost function (the smaller its value, the closer the network output is to the desired value), y d i is the desired output of the i -th sample, and y i is the actual output calculated by the fuzzy neural network.
In order to reduce the error cost function, updates are performed by gradient descent so that the network is constantly adapted to different path-planning scenarios, as shown in the following equation:
w i j ( k + 1 ) = w i j ( k ) η E w i j ( k )
c i j ( k + 1 ) = c i j ( k ) η E c i j ( k )  
σ i j ( k + 1 ) = σ i j ( k ) η E σ i j ( k )
where k is denotes the current number of iterations and η is the learning rate, which is set between 0–1 in this chapter. w i j is the gradient descent update formula for neural network weights, c i j is the membership function, and σ i j is the membership function width; by constantly adjusting the size of w i j , c i j and σ i j , the path can be made to adjust dynamically with the environment. The training results are shown in Figure 2.
As can be seen in Figure 2, the predicted cost coefficients learned in the training set are able to fit the cost output weights given in the sample set well, reflecting good prediction performance.
To verify the adaptability of the neural network model in different environments, nine sets of combined scenarios were designed under different environmental conditions, corresponding to combinations of obstacle density (20, 50, 80) and ground roughness (20, 50, 80). In each set of scenarios, the eight-dimensional cost factor weight values of the neural network output were calculated for four task modes, as shown in Figure 3:
Figure 4 represents the loss curves of the training and validation sets, which shows that the training loss gradually decreases and tends to converge with the increase in the number of iterations, while the validation loss remains stable, indicating that the model is able to obtain a better generalization ability under different task modes. The fuzzy rules for different terrain environments are shown in Table 1.

2.2. Path-Planning Algorithm Flow

In this paper, the algorithm adds the kinematic constraints of the vehicle with respect to the traditional A* algorithm, i.e., the input data is extended to a 3-dimensional space [ x , y , θ ], where x , y are the 2D coordinates of the vehicle, and θ is the heading angle of the unmanned vehicle, which allows for the continuous planning of the unmanned vehicle’s position and orientation in a discretized grid [41].
The pseudocode for this article is given in Algorithm 1.
Algorithm 1 ADP Path-Planning Algorithm
Input:  n s t a r t ( s x , s y , θ s ) ,   n g o a l ( g x , g y , θ g ) ,   d o b s   ( o x , o y , o z ) ,   L a n d 3 d , uncertainty map unc, taskmode   ( T 1 T 4 )
Output: path P t
BEGIN:
1: Initialize:
2: reso ← resolution; step ← reso × 8
3: W ← Normalize(MLP(Fuzzify(TaskMode))) // task-aware cost weights
4:   KD     KDTree ( o x , o y , o z )
5:   h m a p     A   ×   ( g x , g y )
6:   d o b s (x,y) ← dist to nearest obstacle
7:   Open     { n s t a r t }; Closed ← ∅
8:   Q     PriorityQueue ( f   =   g   +   W . H c · h)
9:     while Open ≠ ∅:
10:         n c     argmin   Q ;   Open     Open \ { n c } ;   Close     Closs     { n c }
11:           if   n c n g o a l 2   <   R S t h r e s h :
12:             RS     CalcAllRS ( n c ,   n g o a l )
13:              for P ∈ cost(RS):
14:                 if NoCollision(P):
15:                    return   Reconstruct ( { n c ) + P
16:       for:
17:            x     x c ;   y     y c ;   θ     θ c
18:            valid True ;   φ 0 ,   ρ 0 ← ∇H(x,y)
19:            for
20:                x     x   +   d   ·   reso   ·   cos ( θ ) ;   y     y   +   d · reso · sin ( θ )
21:                θ     θ   +   d · reso · tan ( δ )/L
22:                if (x,y) ∉ bounds ∨ KD.collide(x,y): valid ← False; break
23:                    φ ,   ρ ← ∇H(x,y)
24:                      if   | φ |   >   φ m a x     | ρ | > ρ m a x     ( H m a x     H m i n )   >   h m a x :valid
25:                       False; break
26:                         if valid: continue
27:                      f     compute _ cost ( x ,   y ,     θ ,   δ ,   W ,   L a n d 3 d ,   map   unc ,   d o b s , fire, bump, steer)
28:            node     ( x ,   y ,     θ , g′, f′)
29:             if node ∉ Closed:
30:                 if   ( x , y )     ( g x , g y ) 2   <   ε     | θ     θ g |   <   ε :
31:                   P t ← Reconstruct(node)
32:                    return   P t
End
By discretizing the coordinates of the starting point and the target point and normalizing the angle to the range of ±π, the distance from each node to the target point, the shortest distance to the obstacle, and the steering angle and driving direction during the movement are recorded during the search process. The mixed cost value is calculated by superimposing the current node cost and the heuristic cost, and the expansion order is determined based on the distance between the current position of the unmanned vehicle and the target point. Take the target point as the starting point for backward expansion, gradually calculate the minimum cost to each node, each time selecting the node with the lowest cost from the open set. Retrieve all its possible ways of movement, generate a new node, and calculate the cost, and when the new node is not visited or there exists a better path, update its cost and add it to the open set and the priority queue, and, ultimately, form a heuristic cost map that contains all the nodes that have been visited. The specific steps are as follows:
(1)
Input the target node n , the coordinates of the obstacle E ( x , y ) , the resolution r e s o , and the turning radius rr to obtain the inspired map and the distance from the UGV to the obstacle.
(2)
The target node is discretized, and the discretization formula can be expressed as
E ( x , y ) = E ( x , y )   /   r e s o
(3)
Call the map parameters and output the information, such as the obstacle grid and map boundary; initialize the open and closed sets and add the target node to the open set; the closed set is set to empty. Also, initialize the priority queue and add the target node to the queue.
(4)
When a node exists in the open set, the node with the smallest cost is taken out and added to the closed set and removed from the open set. Subsequently, for each direction of motion, generate new nodes and calculate their coordinates, cost, and parent-node index. If the node is out of bounds or within an obstacle, it is skipped. Calculate the index of the node, and if it is not in the closing set, then consider the following two cases: 1. If it is already in the open set and the new cost is better, then update the cost with the parent-node index. 2. If it is not in the open set, then add the node to the open set and put it in the priority queue.
(5)
Initialize the cost map, traverse the closure set, and fill the final cost of each node into the corresponding position in the cost map.
(6)
Return the heuristic cost map and obstacle distance mapping.
Local dynamic obstacle avoidance is achieved through fuzzy neural network control combined with Euclidean distance constraints. A cost weight adaptation method based on fuzzy neural networks is used to dynamically adjust the weights of various costs based on factors such as obstacle density, vehicle stability requirements, and the current operating status of the unmanned vehicle. By inputting multi-dimensional environmental parameters such as obstacle distribution, path curvature, and speed limits and combining them with fuzzy rules for inference, the system outputs dynamically adjusted weights in real time.

3. Multi-Factor Conditional Weighting Function Model

In the path-planning process, the element evaluation function directly affects the robustness of the path-planning results. This paper constructs a multielement cost model f to obtain the optimal path, as shown in the following equation:
f = w u f u + w o f o + w l f l + w g f g + w s f s + w θ f θ + w f f f + w b f b
where f is an indicator of the integrated evaluation function; f u , f o , f l , f g , f s , f θ , f f , and f b are the terrain uncertainty cost, obstacle distance cost, road length cost, gear shift cost, cornering cost, steering change cost, hazardous point distance cost, and bumps cost; and w u , w o , w l , w g , w s , w θ , w f , and w b are their corresponding weights.
The terrain uncertainty cost f u is derived from the environmental sensing system, which rasterizes the ground and assigns values to each raster to represent the uncertainty risk.
With regard to the obstacle distance cost f o , here, each trajectory line is expanded into an arc band by combining the outer dimensions of the unmanned vehicle. To facilitate the calculation of the path-planning algorithm, the arc band is gridded, and the continuous path is represented as a series of discrete nodes, as shown in Equation (14):
E ( x , y ) = h ( x , y )
Through calculation (1), the minimum distance between the grid on the planned path and the obstacle is calculated to determine whether there is a collision risk for the unmanned vehicle. If d is less than the safety distance threshold l a , a collision is deemed to have occurred. When the minimum distance of the proposed trajectory point from the static obstacle is less than the parameter l b , the risk level is A. Beyond that, the risk decreases nonlinearly and rapidly. This is expressed in Equation (15):
f o = k ×           A                                                     d i s < l b 1 ( d i s l b ) 3 + 1 / A                           d i s l b
The road length cost f l corresponds to the length of the trajectory; the shift cost f g is the switch between forward and reverse, which will bring about longitudinal vibration as the longitudinal speed of the unmanned vehicle alternates. The cornering cost f s corresponds to the deflection angle of the steering wheel of the unmanned vehicle, which poses a risk to the stability of the unmanned vehicle’s driving and has a strong correlation with the vehicle speed, which is not conducive to high-speed driving of the unmanned vehicle. The steering change cost f θ responds to the effect of the amount of steering-wheel deflection angle change on the trajectory continuity of an unmanned vehicle.
The hazardous point distance cost f f reflects some of the forms of hazards encountered by unmanned vehicles, and the hazard distance cost is affected by the distance parameter between the intensity of the hazard and the protection capability of unmanned vehicles, as shown in the following equation. When the minimum distance of the proposed trajectory point from the danger point is less than the l k i l l parameter, it means that the risk level is infinite, and exceeding l k i l l means that the risk decreases.
f f = k ×         inf                 d i s < l k i l l 1 d i s l k i l l + 1 / F               d i s l k i l l
The chassis bump cost f b can be characterized by detecting the degree of front/rear “lift/lowering” of the vehicle over short distances and changes in the lateral camber, as shown in the following Equation (17):
f b = σ × ( | Δ θ p i t c h | + | Δ θ r o l l | )
where Δ θ p i t c h is the change in pitch angle, Δ θ r o l l is the change in the roll angle, and σ is the coefficient of bumping costs, controlling the weight of bumping costs in the total costs. For each cost factor, calculate its coefficient of variation (CV), which is the standard deviation divided by the mean. By calculating the proportion of each cost factor in the total cost, the sensitivity index for different costs can be obtained, as shown in Figure 5.

3.1. Chassis Interference Analysis

For the case of interference with the ground, this paper considers several scenarios that may have occurred, as shown in Figure 6.
The passability is expressed in terms of pitch-angle constraints and side-camber constraints, and the localized height of the ground under the vehicle cannot exceed the minimum ground-clearance constraint of the chassis. When a wheeled unmanned vehicle with independent suspension is traveling at low speed on an uneven road surface, the chassis needs to be checked for interference with ground bumps; for this purpose, it is necessary to obtain information about the interference of the underbody plane, and if there is an interference, this trajectory will not be selected. Since the body is supported by four suspensions, the exact position of the underbody plane can be deduced by calculating the coordinates of the connection points between the suspensions and the body. The independent-suspension-wheeled unmanned vehicle model is shown in Figure 7.
By reducing the suspension to springs and dampers in parallel, in series with the tires, the tires are reduced to springs. The tires are further simplified to rigidity, since they are much more elastic than the suspension. In the study of the passing ability of unmanned vehicles, the role of shock absorbers is neglected, and only the steady-state case is considered, since the main focus is on the low-speed driving condition.
The spatial position of the suspension and the body is modeled and solved by setting the elevations of the four wheels in contact with the ground to be z r f l , z r f r , z r r l , and z r r r ; the elevations of the upper connection points of the suspension and the body to be z c f l , z c f r , z c r l , and z c r r ; the vertical forces of the suspension and the body to be P f l , P f r , P r l , and P r r , which correspond to the left front wheel, the right front wheel, the left rear wheel, and the right rear wheel; wheelbase to be l w l r , and the axle base to be l w f r . The four suspension springs have the same stiffness k , and the initial length of the spring is l . The elevation of the point where the wheels touch the ground can be obtained by querying the 3D map based on the XY-projected coordinates of the unmanned vehicle on the ground. Then the compression value of the spring force is
z c f l = z r f l + l p f l / k z c f r = z r f r + l p f r / k z c r l = z r r l + l p r l / k z c r r = z r r r + l p r r / k
The body pitch and side lean angles are
θ p i t c h = ( arctan z c f l z c r l l w f r + arctan z c f r z c r r l w f r ) 2
θ r o l l = ( arctan z c f r z c f l l w f r + arctan z c r r z c r l l w f r ) 2
Equations (18)–(20) then simplify to
θ p i t c h = z c f l z c r l + z c f r z c r r 2 l w f r = k ( z r f l z r r l + z r f r z r r r ) + P r l + P r r P f l P f r 2 l w f r k
θ r o l l = z c f r z c f l + z c r r z c r l 2 l w l r = k ( z r f r + z r r r z r r l z r f l ) + P f l + P r l P f r P r r 2 l w l r k
Assuming that the center of mass of the unmanned vehicle is coincident with the geometric center in the XY plane, this can be obtained based on the principle of the equilibrium of longitudinal and transverse torques of the body:
P f l + P r l l w l r z m sin θ r o l l = P f r + P r r l w l r + z m sin θ r o l l
P f l + P f r l w f r + z m sin θ p i t c h = P r l + P r r l w f r z m sin θ p i t c h
where z m is the height of the center of inclination from the center of mass. By the principle of balance of forces in the vertical direction,
P f l + P f r + P r l + P r r = m g
where m is the unmanned vehicle spring mass. Since the four suspensions are in a plane with the upper connection point of the body and do not change this feature with body bump pitch, sideways tilt, and rotation, the following can be obtained:
z c f l + z c r r = z c f r + z c r l
Bringing in Equation (26) produces
k ( z r f l + z r r r z r f r z r r l ) = P f l + P r r P f r P r l
The system of Equations (23)–(26) can be obtained by combining the following equations:
P f l + P f r + P r l + P r r = m g k ( z r f l + z r r r z r f r z r r l ) = P f l + P r r P f r P r l P f l + P r l l w l r z m sin θ r o l l = P f r + P r r l w l r + z m sin θ r o l l P f l + P f r l w f r + z m sin θ p i t c h = P r l + P r r l w f r z m sin θ p i t c h
The combination of the first two equations in the system of equations can simplify the four variables into two variables, and then the latter two equations are simplified by trigonometric functions, which are brought into Equations (21) and (22) to solve for the four pendant forces P f l , P f r , P r l , and P r r , which, in turn, yield the coordinates of the four upper connection points of the suspension to the body, as shown in Figure 8 and Figure 9.
As shown in Figure 9, compare the elevation of the lower part of the vehicle body with the plane to determine whether it will be higher than the plane. The blue box in the figure is a simplified outline of the unmanned vehicle, and the light blue rectangle below is the detection range for interference between the unmanned vehicle chassis and the ground. The four circular areas are interference detection points, with darker colors indicating stronger interference, thereby verifying whether there is a risk of “bottom scraping”.

3.2. Collision Detection Model

A sketch of the unmanned vehicle model in this paper is shown in Figure 10.
Take the center of the vehicle as the center of the circle, establish a circular collision detection area with a radius of half of the longitudinal projection of the vehicle plus a safety extension, and set the range of the radius of the collision detection as r . The calculation formula is as follows:
r = L l 2 + max ( C f , C r ) + d
where L l is the front and rear wheelbase, C f is the distance from the front axle to the front end of the vehicle, C r is the distance from the rear axle to the rear end of the vehicle, and d is the safety extension radius. Then the center coordinates ( c x , c y ) of the vehicle are
c x = i x + L l 2 cos ( i x θ )
c y = i y + L l 2 sin ( i y θ )
where i x and i y denote the rear-axle center coordinates of the current position of the vehicle, and i y θ is the current heading angle of the vehicle. Convert the obstacle position o x , o y from a global coordinate system to a vehicle local coordinate system with the center of the vehicle as the origin and the forward direction of the vehicle as the x-axis. The conversion is as follows:
d x d y = cos ( i x θ )   sin ( i x θ ) sin ( i y θ )   cos ( i y θ ) o x c x o y c y
where d x and d y denote the horizontal and vertical distances of the obstacle in the vehicle coordinate system, respectively; then, the collision detection equation of the vehicle is
C o l = d x < r d y < C d 2 + d
If the absolute values of d x and d y are less than the vehicle’s collision detection radius and half of the vehicle’s width plus the extended safety range, respectively, the vehicle is considered to have collided with an obstacle. A collision occurs when the obstacle is within a rectangular area of length 2 r and width C d + 2 d in the vehicle’s local coordinate system.

4. Experimental Simulation

This paper sets the steering-wheel angle range of the autonomous vehicle to ±30°, discretized at 10° intervals, and considers both forward and reverse directions. This means that the autonomous vehicle needs to traverse 12 local trajectories and evaluate and select the local trajectory with the minimum cost. This paper sets a map of 100 m × 150 m, which is gridded in units of 0.5 m. It is assumed that planning a path requires evaluating 400 grid points, which means that at least 4800 local trajectories need to be verified. In other words, 4800 calculations of vehicle posture and chassis collision detection are required. The autonomous vehicle will periodically perceive the above environmental information and accelerate the calculation of all nodes using KDTREE.
In addition, based on the dynamic cost adjustment mechanism and three-dimensional terrain interference modeling method proposed in this paper, the following settings were made during the modeling process:
First, obstacles are modeled using regular rectangular models. During the path cost calculation, the distance between path points and obstacles is measured using the Euclidean distance.
Secondly, the vehicle chassis is modeled as a regular rectangular prism structure, and its suspension system is approximated using a simplified geometric compression model. This is used to assess changes in vehicle posture and terrain interference on three-dimensional undulating terrain, which facilitates the calculation of passability costs.
In terms of terrain, 3D terrain data is treated as static information during path planning, meaning that the terrain elevation does not change over time during the planning phase. This assumption is applicable to applications based on pre-built maps or environments with minimal dynamic changes.
In addition, during the initialization phase of path planning, the task mode is predetermined by the upper-level decision-making system, and the neural network outputs the corresponding cost weights based on the input task type and environmental features. Therefore, there is no need to dynamically switch task modes during the planning process.
The above modeling assumptions are set to effectively control system complexity, highlighting the core advantages and practical effects of the algorithm in this paper in terms of task-driven dynamic weight adjustment and terrain-interference adaptive path planning. The final simulation environment map and path-planning results are shown in Figure 11. The four black squares in the figure represent obstacles, and the red sectors mark the hazard range, in which the outer area is the general hazard zone and the inner area is the lethal hazard zone. The orange node was randomly selected as the target location and the blue node as the starting location of the unmanned vehicle.
Figure 12a shows a three-dimensional map environment model that takes height information into account. To more intuitively reflect the height changes along the path, Figure 12b removes other environmental elements and retains only the height difference curve of the path.
Figure 13 shows the difference between the ADP algorithm and traditional algorithms in terms of path cost distribution. The ADP algorithm comprehensively considers the impact of three-dimensional terrain on the chassis of unmanned vehicles during path generation, especially avoiding chassis interference and areas of severe bumpiness. Traditional algorithms are based only on two-dimensional terrain information and ignore chassis constraints, resulting in significant cost increases in some path segments (such as normalized positions x = 0.3 and x = 0.7). Compared with the traditional A* path-planning algorithm, which does not consider height information, the interference and pass rate are shown in Figure 14.
To further quantify the passability of a path, this paper introduces the path passability-rate metric, defined as the proportion of points in the path where the unit cost is below a certain safety threshold. This paper sets the threshold at 1.6. The calculation results for the pass rate are as follows: The path pass rate for the ADP algorithm is 98.4%, indicating that most path areas are safe for passage; the path pass rate for the traditional algorithm is 81.6%, with a significant number of potential interference or bumpy risk areas. The “path pass rate” refers to the proportion of paths in the entire route that vehicles can traverse smoothly without bottoming out or without excessive bumping.
To facilitate observation of the experimental results, the three-dimensional terrain was mapped onto a two-dimensional plane using elevation projection, as shown in Figure 15. The white curves in the figure represent the four passable paths obtained from the three-dimensional map model in combination with the chassis suspension interference model of the unmanned vehicle.
In order to comprehensively evaluate the generality and adaptability of the ADP path-planning algorithm proposed in this paper, low-density obstacle scenes and high-density obstacle scenes were constructed separately. The former simulates open terrain or open roads and is mainly used to test the search efficiency and path smoothness of the algorithm; the latter simulates urban alleys or complex environments and is used to test the obstacle-avoidance ability and path smoothness of the algorithm in complex environments. First, the path planning results for a low-density obstacle scenario are shown in Figure 16.
The green curves in Figure 16 represent the path trajectories obtained by four different algorithms. As shown in Figure 16a,b, the traditional A* algorithm and FMT* algorithm only approximate the unmanned vehicle as a point mass and fail to consider collisions under the unmanned vehicle model, causing them to perform planning directly at the starting position, which leads to the risk of interference. The traditional A* algorithm performs the path search based on a heuristic search but does not fully consider dynamic terrain characteristics. Furthermore, when approaching the target location, it cannot effectively handle the vehicle’s steering angle, resulting in a large steering angle at the end of the planned path. The path-optimization effect of the FMT* algorithm is affected by the distribution of sampling points. When the sampling density is low, the path will be more tortuous, resulting in poor driving stability. When the sampling density is too high, although the path is more accurate, the computing efficiency is significantly reduced, affecting the real-time performance of the algorithm. Therefore, when the number of sampling points is the same as that of the traditional A* algorithm, FMT* has difficulty accurately capturing path details due to the sparse distribution of sampling points, resulting in paths with many small turns.
As shown in Figure 16c,d, the Informed RRT* algorithm is primarily based on distance-based heuristic optimization and does not integrate other environmental costs, resulting in longer detours around dangerous areas and multiple turns, thereby failing to fully utilize low-risk passageways. In this paper, when there are obstacles at the starting position, the ADP algorithm detects obstacles ahead based on the vehicle model data, performs collision detection, and then reverses to avoid the obstacles. After successfully bypassing the obstacles, the vehicle reaches the target position.
As shown in the enlarged view in Figure 17 below, it can be observed that in the terminal path segment close to the target point, the green curves generated by the algorithm in this chapter and the Informed RRT* algorithm exhibit smoother turning characteristics, with the turning radius of the algorithm in this paper reduced by 37% compared with the traditional A* algorithm. Under the same number of sampling points, the FMT* algorithm exhibits a significantly higher number of minor turns at the end of the path compared with the A* algorithm and the algorithm presented in this chapter, failing to effectively control the adjustment of the unmanned vehicle’s body angle.
To quantify and compare the experimental results of the four algorithms, we conducted 20 sets of control experiments, comparing key indicators, including computation time, path smoothness (variance in curvature changes), and distance to the nearest obstacle. We calculated the variance and confidence interval for each set of data, with specific data shown in Table 2.
The path smoothness in the above table represents the variance in curvature changes, which reflects the magnitude of curvature changes between adjacent points. Although the algorithm described in this paper has a slightly higher computational time than traditional A* and FMT* algorithms, it has a smaller path smoothness and a larger nearest obstacle distance.
The performance of the four algorithms in terms of key indicators such as obstacle distance values and angle-change values was analyzed, and the relevant results are shown in Figure 18 and Figure 19.
Figure 18 shows the distribution of obstacle distance values at different distances within the path range for the traditional A* algorithm, the FMT* algorithm, the Informed RRT* algorithm, and the ADP algorithm proposed in this paper. As can be seen from the figure, the algorithm proposed in this paper guarantees a larger obstacle distance value, indicating that it is safer without any restrictions.
The steering angle of the unmanned vehicle during the path-planning process, is shown in Figure 19. The steering-angle fluctuation of the ADP algorithm in this paper is significantly smaller than that of the other two algorithms, proving that the algorithm in this paper has better smoothness under low-density obstacles.
To validate the effectiveness of the algorithm presented in this paper, we reduced the size of the obstacles while increasing their density and bringing the target point closer to the interference environment, as shown in Figure 20.
The results of the four different algorithms are shown in Figure 20 above. As can be seen from the figure, the traditional A* algorithm and the Informed RRT* algorithm have large steering angles, the FMT* algorithm has excessive steering, while the ADP algorithm proposed in this paper has a smoother path. The magnified view is shown in Figure 21. As can be seen from the figure, the algorithm in this paper effectively identifies the road surface that interferes with the chassis at the endpoint, as shown in the red circle. The experimental results of the four algorithms are compared in Table 3.
As can be seen from the table above, although the algorithm time is slightly higher than that for low obstacle density, the overall experimental results are similar to those for low obstacle density. In a high-density obstacle environment, the performance of the four algorithms was analyzed in terms of key indicators such as obstacle distance values and angle-change values.
As can be seen from Figure 22, in a dense obstacle environment, the algorithm presented in this paper still guarantees a large obstacle distance value, providing better safety. In a dense obstacle environment, the steering angle of the unmanned vehicle is shown in Figure 23.
As can be seen from Figure 23, the ADP algorithm proposed in this paper has the smallest fluctuation among the four algorithms, proving that the algorithm proposed in this paper has better smoothness under high-density obstacles.
To validate the effectiveness of the method used in this paper to dynamically output cost weights by fuzzy neural networks under different modes, and since the passage under dense obstacles may include cases under low-density obstacles, this paper only considers high-density obstacles and performs path planning for different task modes separately. The results are shown in Figure 24.
In Task Mode 1: Conveyance—its fuzzy characteristics are to stay away from danger points, follow a determined path, reduce jolts, and reduce frequent gear changes. Therefore, the generated path tends to be more linear, as shown in Figure 24a.
In Task Mode 2: Reconnaissance—its fuzzy characteristics are to approach dangerous points but not enter the danger zone, take low-risk routes, and not consider route length. Therefore, its path planning results are shown in Figure 24b.
Task Mode 3: Searching, with the following fuzzy characteristics—does not consider firing points, takes the path of least risk, does not consider path length, and does not consider direction changes. The planning results are shown in Figure 24c.
In Mission Mode 4: Drone takeoff and landing—its fuzzy characteristics are to travel in a straight line, control turbulence, and avoid obstacles. The planning results are shown in Figure 24d.
As shown in Figure 24 above, by analyzing the current vehicle parameters and task characteristics, it is possible to generate a trajectory diagram that aligns with the task’s specific requirements. Figure 25, Figure 26, Figure 27 and Figure 28 show the statistical histograms of the distances between each node and the obstacles in the motion trajectory of the path-planning algorithm in this chapter. The horizontal axis represents the distance between each point on the path and the obstacle, while the vertical axis represents the number of points detected within that distance range. This further validates the effectiveness of the algorithm presented in this paper in the field of fuzzy neural network control.

5. Conclusions

This study proposes an adaptive path-planning method for UGVs in complex three-dimensional environments. This method constructs a three-dimensional map environment with terrain elevation information and an interference model for UGVs. It also proposes a mechanism that can dynamically adjust cost weights based on current environmental information during path planning, effectively improving path feasibility and environmental adaptability in unstructured terrain. On this basis, a multi-factor integrated cost function is constructed, and a task-driven dynamic programming strategy adjustment module is designed so that the generated path can respond in real time to path-planning requirements under different task conditions. Experiments were conducted to compare the path-planning results for UGVs in sparse and dense obstacle environments. The experimental results show that, compared with traditional A*, Informed RRT*, and FMT* path-planning algorithms, the method proposed in this paper has certain advantages in terms of obstacle-avoidance distance and trajectory smoothness. In addition, the paths planned by the algorithm in this paper were verified to be consistent with the characteristics of the corresponding tasks in four different task modes. In summary, the algorithm presented in this paper effectively improves the adaptability of UGV path planning in unstructured environments and its dynamic characteristics under different path-planning objectives.

Author Contributions

Conceptualization, H.Z. and Q.Z.; methodology, H.Z. and Q.Z.; software, H.Z. and Q.Z.; validation, Y.W., D.J. and X.C.; formal analysis, X.L.; investigation, Y.S.; resources, Y.W.; data curation, X.C.; writing—original draft preparation, Q.Z.; writing—review and editing, H.Z.; visualization, Y.W.; supervision, Y.S.; project administration, Yunlong Sun.; funding acquisition, D.J. All authors have read and agreed to the published version of the manuscript.

Funding

This work was supported by the National Key Research and Development Project: 2023YFB4704000 (Integrated Chip for Robot Joint Drive and Control).

Institutional Review Board Statement

Not applicable.

Informed Consent Statement

Not applicable.

Data Availability Statement

Data will be made available upon request.

Conflicts of Interest

The authors declare no conflicts of interest.

References

  1. Xi, W.; Lin, J.; Shao, Z. Path planning of mobile robot based on improved PRM and APF. Meas. Control. 2024, 58, 979–995. [Google Scholar] [CrossRef]
  2. Kumar, S.; Sikander, A. A modified probabilistic roadmap algorithm for efficient mobile robot path planning. Eng. Optim. 2023, 55, 1616–1634. [Google Scholar] [CrossRef]
  3. Qiu, S.; Li, B.; Tong, R. Efficient Path Planning Based on Dynamic Bridging Rapidly Exploring Random Tree. Appl. Sci. 2024, 14, 2032. [Google Scholar] [CrossRef]
  4. Wang, X.; Wei, J.; Zhou, X. AEB-RRT*:an adaptive extension bidirectional RRT* algorithm. AutonomousRobots 2022, 46, 685–704. [Google Scholar] [CrossRef]
  5. Lyu, P. Robot path planning algorithm with im-proved DDPG algorithm. Int. J. Interact. Des. Manuf. (IJIDeM) 2025, 19, 1123–1133. [Google Scholar] [CrossRef]
  6. Xue, H.; Yue, T.; Dolan, J. Spline-Based Mini-mum-Curvature Trajectory Optimization for Autonomous Racing. arXiv 2023, arXiv:2309.09186. [Google Scholar]
  7. Lew, T.; Bonalli, R.; Pavone, M. Chance-constrained sequential convex programming for robust trajectory optimization. In Proceedings of the European Control Conference (ECC), St. Petersburg, Russia, 12–15 May 2020; IEEE: Piscataway, NJ, USA, 2020; pp. 1871–1878. [Google Scholar]
  8. Wang, R.; Lu, Z.; Jin, Y. Application of A* algorithm in intelligent vehicle path planning. Math. Models Eng. 2022, 8, 82–90. [Google Scholar] [CrossRef]
  9. Fu, X.; Huang, Z.; Zhang, G. Research on path planning of mobile robots based on improved A* algorithm. PeerJ Comput. Sci. 2025, 11, e2691. [Google Scholar] [CrossRef]
  10. Han, C.; Li, B. Mobile robot path planning based on improved A* algorithm. In Proceedings of the 2023 IEEE 11th Joint International Information Technology and Artificial Intelligence Conference (ITAIC), Chongqing, China, 8–10 December 2023; IEEE: Piscataway, NJ, USA, 2023; Volume 11, pp. 672–676. [Google Scholar]
  11. Zhang, W.; Li, W.; Zheng, X. Improved A* and DWA fusion algorithm based path planning for intelligent substation inspection robot. Meas. Control. 2025, 00202940251316687. [Google Scholar] [CrossRef]
  12. Ou, Y.; Fan, Y.; Zhang, X. Improved A* path planning method based on the grid map. Sensors 2022, 22, 6198. [Google Scholar] [CrossRef]
  13. Wang, F.; Sun, W.; Yan, P. Research on Path Planning for Robots with Improved A* Algorithm under Bidirectional JPS Strategy. Appl. Sci. 2024, 14, 5622. [Google Scholar] [CrossRef]
  14. Zhang, W.; Wang, N.; Wu, W. A hybrid path planning algorithm considering AUV dynamic constraints based on improved A* algorithm and APF algorithm. Ocean. Eng. 2023, 285, 115333. [Google Scholar] [CrossRef]
  15. Duan, C.; Zhang, P. Research on path planning of mobile robot based on hybrid A* algorithm. In Proceedings of the 2024 International Conference on Intelligent Computing and Robotics (ICICR), Dalian, China, 12–14 April 2024; p. 8. [Google Scholar]
  16. Sheng, W.; Li, B.; Zhong, X. Autonomous parking trajectory planning with tiny passages: A combination of multistage hybrid A-star algorithm and numerical optimal control. IEEE Access 2021, 9, 102801–102810. [Google Scholar] [CrossRef]
  17. Meng, T.; Yang, T.; Huang, J. Improved hybrid a-star algorithm for path planning in autonomous parking system based on multi-stage dynamic optimization. Int. J. Automot. Technol. 2023, 24, 459–468. [Google Scholar] [CrossRef]
  18. Chi, Z.; Yu, Z.; Wei, Q. High-efficiency navigation of nonholonomic mobile robots based on im-proved hybrid A* algorithm. Appl. Sci. 2023, 13, 6141. [Google Scholar] [CrossRef]
  19. Zhao, Y.; Zhu, Y.; Zhang, P. A hybrid A* path planning algorithm based on multi-objective constraints. In Proceedings of the Asia Conference on Advanced Robotics, Automation, and Control Engineering (ARACE), Qingdao, China, 26–28 August 2022; IEEE: Piscataway, NJ, USA, 2022; pp. 1–6. [Google Scholar]
  20. Zhao, K.; Zeng, R.; Liang, Z.; Zhong, H. Improved hybrid A* parking path planning algorithm based on arc spline reference path. Sci. Technol. Eng. 2024, 24, 7376–7379. [Google Scholar]
  21. Sun, Y.; Yuan, Q.; Gao, Q. A Multiple Environment Available Path Planning Based on an Improved A* Algorithm. Int. J. Comput. Intell. Syst. 2024, 17, 172. [Google Scholar] [CrossRef]
  22. Ren, B.; Wang, X.; Deng, W. Path Optimization Algorithm for Automatic Parking Based on Hybrid A* and Reeds Shepp Curve with Variable Radius. China J. Highw. Transp. 2022, 35, 317–327. [Google Scholar]
  23. Chi, X.; Zeng, J.; Huang, J. Fast Path Planning for Autonomous Vehicle Parking with Safe-ty-Guarantee using Hamilton-Jacobi Reachability. arXiv 2023, arXiv:2310.15190. [Google Scholar]
  24. Deng, H.; Ma, B.; Zhao, H.; Lv, L.; Liu, Y. Path Planning and Tracking Control of Autonomous Vehicle for Obstacle Avoidance. Acta Armamentarii 2020, 41, 587–589. [Google Scholar]
  25. Wang, F.; Wang, C.; Wang, Y. Data-driven fuzzy logic control method for improved USV path planning. J. Supercomput. 2025, 81, 844. [Google Scholar] [CrossRef]
  26. Kumar, A.; Sahasrabudhe, A.; Nirgude, S. Fuzzy Logic Control for Indoor Navigation of Mobile Robots. arXiv 2024, arXiv:2409.02437. [Google Scholar] [CrossRef]
  27. Maxwell, C.; Baglioni, M.; Jamshidnejad, A. Model Predictive Fuzzy Control: A Hierarchical Multi-Agent Control Architecture for Outdoor Search-and-Rescue Robots. arXiv 2025, arXiv:2505.03257. [Google Scholar]
  28. Teng, Y.; Feng, T.; Song, C. Path Planning of Mo-bile Robot Based on Dual-Layer Fuzzy Control and Improved Genetic Algorithm. Symmetry 2025, 17, 609. [Google Scholar] [CrossRef]
  29. Lan, G.; Shi, M.; Tang, J. An efficient safety pre-diction and control strategy using fuzzy neural net-work architecture search in islanded microgrids. Discov. Comput. 2025, 28, 55. [Google Scholar] [CrossRef]
  30. Kayacan, E.; Kayacan, E.; Ramon, H. Adaptive neuro-fuzzy control of a spherical rolling robot using sliding-mode-control-theory-based online learning algorithm. IEEE Trans. Cybern. 2012, 43, 170–179. [Google Scholar] [CrossRef]
  31. Liu, K.; Ma, J.; Lai, E. A Dynamic Fuzzy Rule and Attribute Management Framework for Fuzzy Inference Systems in High-Dimensional Data. arXiv 2025, arXiv:2504.19148. [Google Scholar] [CrossRef]
  32. Xue, G.; Chang, Q.; Wang, J. An adaptive neuro-fuzzy system with integrated feature selection and rule extraction for high-dimensional classification problems. IEEE Trans. Fuzzy Syst. 2022, 31, 2167–2181. [Google Scholar] [CrossRef]
  33. Zhang, K.; Hao, W.; Yu, X. A Symmetrical Fuzzy Neural Network Regression Method Coordinating Structure and Parameter Identifications for Regression. Symmetry 2023, 15, 1711. [Google Scholar] [CrossRef]
  34. Machavaram, R. Intelligent path planning for autonomous ground vehicles in dynamic environments utilizing adaptive Neuro-Fuzzy control. Eng. Appl. Artif. Intell. 2025, 144, 110119. [Google Scholar] [CrossRef]
  35. Yang, R.; Zheng, L.; Pan, J. Learning-based predictive path following control for nonlinear systems under uncertain disturbances. IEEE Robot. Autom. Lett. 2021, 6, 2854–2861. [Google Scholar] [CrossRef]
  36. Qu, S.; Abouheaf, M.; Gueaieb, W. An adaptive fuzzy reinforcement learning cooperative approach for the autonomous control of flock systems. In Proceedings of the IEEE International Conference on Robotics and Automation (ICRA), Xi’an, China, 30 May–5 June 2021; IEEE: Piscataway, NJ, USA, 2021; pp. 8927–8933. [Google Scholar]
  37. Rusta, M.; Haghpanah, S.; Taghvaei, S. Adaptive neuro-fuzzy sliding mode control of the human upper limb during manual wheelchair pro-pulsion: Estimation of continuous joint movements using synergy-based extended Kalman filter. Neural Comput. Appl. 2024, 36, 17375–17416. [Google Scholar] [CrossRef]
  38. Tilahun, A.; Desta, T.; Salau, A. Design of an Adaptive Fuzzy Sliding Mode Control with Neu-ro-Fuzzy system for control of a differential drive wheeled mobile robot. Cogent Eng. 2023, 10, 2276517. [Google Scholar] [CrossRef]
  39. Liu, Z.; Zhao, Y.; Zhang, O. Adaptive fuzzy neural network-based finite time prescribed performance control for uncertain robotic systems with actuator saturation. Nonlinear Dyn. 2024, 112, 12171–12190. [Google Scholar] [CrossRef]
  40. Sheikhsamad, M.; Puig, V. Learning-based control of autonomous vehicles using an adaptive neuro-fuzzy inference system and the linear matrix inequality approach. Sensors 2024, 24, 2551. [Google Scholar] [CrossRef]
  41. Zhao, J.; Li, L.; Xue, Z. Hierarchical motion planning method based on hybrid A-star for cruising in parking area. J. Mech. Eng. 2023, 59, 290–298. [Google Scholar]
Figure 1. Features of the Hybrid A* Algorithm.
Figure 1. Features of the Hybrid A* Algorithm.
Sensors 25 05454 g001
Figure 2. Neural network training results.
Figure 2. Neural network training results.
Sensors 25 05454 g002
Figure 3. Cost weighting values in different environments.
Figure 3. Cost weighting values in different environments.
Sensors 25 05454 g003
Figure 4. Training loss and validation loss curves.
Figure 4. Training loss and validation loss curves.
Sensors 25 05454 g004
Figure 5. Sensitivity of path-planning results to eight different costs.
Figure 5. Sensitivity of path-planning results to eight different costs.
Sensors 25 05454 g005
Figure 6. Unmanned vehicle passage restraint schematic.
Figure 6. Unmanned vehicle passage restraint schematic.
Sensors 25 05454 g006
Figure 7. Unmanned vehicle modeling on undulating roads.
Figure 7. Unmanned vehicle modeling on undulating roads.
Sensors 25 05454 g007
Figure 8. Chassis-road interference detection model diagram.
Figure 8. Chassis-road interference detection model diagram.
Sensors 25 05454 g008
Figure 9. Localized enlargement of the chassis and road interference detection model.
Figure 9. Localized enlargement of the chassis and road interference detection model.
Sensors 25 05454 g009
Figure 10. Sketch of unmanned vehicle model.
Figure 10. Sketch of unmanned vehicle model.
Sensors 25 05454 g010
Figure 11. Simulation map for unmanned vehicle planning.
Figure 11. Simulation map for unmanned vehicle planning.
Sensors 25 05454 g011
Figure 12. 3D map model: (a) 3D map after introducing height information; (b) 3D path height map.
Figure 12. 3D map model: (a) 3D map after introducing height information; (b) 3D path height map.
Sensors 25 05454 g012
Figure 13. Three-dimensional comparison results of planned paths.
Figure 13. Three-dimensional comparison results of planned paths.
Sensors 25 05454 g013
Figure 14. Chassis interference analysis results.
Figure 14. Chassis interference analysis results.
Sensors 25 05454 g014
Figure 15. 2D topographic map.
Figure 15. 2D topographic map.
Sensors 25 05454 g015
Figure 16. Comparison of planning results of different algorithms under low obstacle density: (a) A* algorithm; (b) FMT* algorithm; (c) Informed RRT* algorithm; (d) ADP algorithm.
Figure 16. Comparison of planning results of different algorithms under low obstacle density: (a) A* algorithm; (b) FMT* algorithm; (c) Informed RRT* algorithm; (d) ADP algorithm.
Sensors 25 05454 g016
Figure 17. Local magnification of planning results for different algorithms under low obstacle density conditions: (a) A* algorithm; (b) FMT* algorithm; (c) Informed RRT* algorithm; (d) ADP algorithm.
Figure 17. Local magnification of planning results for different algorithms under low obstacle density conditions: (a) A* algorithm; (b) FMT* algorithm; (c) Informed RRT* algorithm; (d) ADP algorithm.
Sensors 25 05454 g017
Figure 18. Comparison of obstacle distances between the four algorithms under low obstacle-density conditions.
Figure 18. Comparison of obstacle distances between the four algorithms under low obstacle-density conditions.
Sensors 25 05454 g018
Figure 19. Comparison chart of steering angles for the four algorithms under low obstacle-density conditions.
Figure 19. Comparison chart of steering angles for the four algorithms under low obstacle-density conditions.
Sensors 25 05454 g019
Figure 20. Comparison of planning results of different algorithms under high obstacle density: (a) A* algorithm; (b) FMT* algorithm; (c) Informed RRT* algorithm; (d) ADP algorithm.
Figure 20. Comparison of planning results of different algorithms under high obstacle density: (a) A* algorithm; (b) FMT* algorithm; (c) Informed RRT* algorithm; (d) ADP algorithm.
Sensors 25 05454 g020
Figure 21. Local magnification of planning results for different algorithms under high obstacle density: (a) A* algorithm; (b) FMT* algorithm; (c) Informed RRT* algorithm; (d) ADP algorithm.
Figure 21. Local magnification of planning results for different algorithms under high obstacle density: (a) A* algorithm; (b) FMT* algorithm; (c) Informed RRT* algorithm; (d) ADP algorithm.
Sensors 25 05454 g021
Figure 22. Comparison of obstacle distances between the four algorithms under high obstacle-density conditions.
Figure 22. Comparison of obstacle distances between the four algorithms under high obstacle-density conditions.
Sensors 25 05454 g022
Figure 23. Comparison of four algorithms’ corner detection performance under high obstacle-density conditions.
Figure 23. Comparison of four algorithms’ corner detection performance under high obstacle-density conditions.
Sensors 25 05454 g023
Figure 24. Path-planning results under different task modes: (a) Task Mode 1 path-planning results; (b) Task Mode 2 path-planning results. (c) Task Mode 3 path-planning results; (d) Task Mode 4 path-planning results.
Figure 24. Path-planning results under different task modes: (a) Task Mode 1 path-planning results; (b) Task Mode 2 path-planning results. (c) Task Mode 3 path-planning results; (d) Task Mode 4 path-planning results.
Sensors 25 05454 g024
Figure 25. Task Mode 1: Obstacle distance statistics histogram.
Figure 25. Task Mode 1: Obstacle distance statistics histogram.
Sensors 25 05454 g025
Figure 26. Task Mode 2: Obstacle distance statistics histogram.
Figure 26. Task Mode 2: Obstacle distance statistics histogram.
Sensors 25 05454 g026
Figure 27. Task Mode 3: Obstacle distance statistics histogram.
Figure 27. Task Mode 3: Obstacle distance statistics histogram.
Sensors 25 05454 g027
Figure 28. Task Mode 4: Obstacle distance statistics histogram.
Figure 28. Task Mode 4: Obstacle distance statistics histogram.
Sensors 25 05454 g028
Table 1. Fuzzy control rules for path planning.
Table 1. Fuzzy control rules for path planning.
Fuzzy Rule StatementExplanation of Meaning
High floor unevenness and low energy marginsPrioritize avoidance of bumps, not shortest paths
Low energy margin and low vehicle healthPoor health/power, need more secure path (not shorter but safer)
High vehicle health and low ground unevennessExcellent condition, optimal path-seeking is the main focus
High density of obstacles and medium unevennessCrowded and not very flat, with obstacle avoidance and stability prioritized
High energy margin in floor unevennessFair road conditions, enough energy, can accept appropriate detours and turns
High energy margin and low obstacle densityReducing costs to reach goals as quickly as possible
High unevenness and high density of obstaclesEnhanced obstacle avoidance, stabilization, robustness requirements
Low ground unevenness and low vehicle healthGround is good but the system is vulnerable to failure, choose the less bumpy paths
Low unevenness and high density of obstaclesComplex environment but good ground, allowing for flexibility
Low energy margin and high obstacle densityCommon state, balanced planning
Table 2. Comparison of low-density environmental simulation test results.
Table 2. Comparison of low-density environmental simulation test results.
Algorithm CategoryCalculation Time (min)Path SmoothnessObstacle Distance (m)
A* 1.31   ±   0.08   ( 95 % CI :   ± 0.04 ) 0.45   ±   0.05   ( 95 % CI :   ± 0.02 ) 12.13   ±   0.05   ( 95 % CI :   ± 0.26 )
FMT* 0.56   ±   0.08   ( 95 % CI :   ± 0.04 ) 1.48   ±   0.05   ( 95 % CI :   ± 0.02 ) 8.75   ±   0.05   ( 95 % CI :   ± 0.26 )
Informed RRT* 2.05   ±   0.08   ( 95 % CI :   ± 0.04 ) 0.33   ±   0.05   ( 95 % CI :   ± 0.02 ) 15.14   ±   0.05   ( 95 % CI :   ± 0.26 )
ADP 1.45   ±   0.08   ( 95 % CI :   ± 0.04 ) 0.21   ±   0.05   ( 95 % CI :   ± 0.02 ) 18.25   ±   0.05   ( 95 % CI :   ± 0.26 )
Table 3. Comparison of high-density environmental simulation test results.
Table 3. Comparison of high-density environmental simulation test results.
Algorithm CategoryCalculation Time (min)Path SmoothnessObstacle Distance (m)
A* algorithm 1.47   ±   0.08   ( 95 % CI :   ± 0.04 ) 0.59   ±   0.05   ( 95 % CI :   ± 0.02 ) 5.14   ±   0.05   ( 95 % CI :   ± 0.26 )
FMT* algorithm 1.34   ±   0.08   ( 95 % CI :   ± 0.04 ) 1.39   ±   0.05   ( 95 % CI :   ± 0.02 ) 6.38   ±   0.05   ( 95 % CI :   ± 0.26 )
Informed RRT* 2.15   ±   0.08   ( 95 % CI :   ± 0.04 ) 0.51   ±   0.05   ( 95 % CI :   ± 0.02 ) 8.21   ±   0.05   ( 95 % CI :   ± 0.26 )
ADP algorithm 1.58   ±   0.08   ( 95 % CI :   ± 0.04 ) 0.46   ±   0.05   ( 95 % CI :   ± 0.02 ) 12.59   ±   0.05   ( 95 % CI :   ± 0.26 )
Disclaimer/Publisher’s Note: The statements, opinions and data contained in all publications are solely those of the individual author(s) and contributor(s) and not of MDPI and/or the editor(s). MDPI and/or the editor(s) disclaim responsibility for any injury to people or property resulting from any ideas, methods, instructions or products referred to in the content.

Share and Cite

MDPI and ACS Style

Zhang, H.; Zhao, Q.; Wu, Y.; Jiang, D.; Chen, X.; Liang, X.; Sun, Y. Integration of Vehicle–Terrain Interaction and Fuzzy Cost Adaptation for Robust Path Planning. Sensors 2025, 25, 5454. https://doi.org/10.3390/s25175454

AMA Style

Zhang H, Zhao Q, Wu Y, Jiang D, Chen X, Liang X, Sun Y. Integration of Vehicle–Terrain Interaction and Fuzzy Cost Adaptation for Robust Path Planning. Sensors. 2025; 25(17):5454. https://doi.org/10.3390/s25175454

Chicago/Turabian Style

Zhang, Hongchao, Qiancheng Zhao, Yinghao Wu, Da Jiang, Xiaole Chen, Xiaoming Liang, and Yunlong Sun. 2025. "Integration of Vehicle–Terrain Interaction and Fuzzy Cost Adaptation for Robust Path Planning" Sensors 25, no. 17: 5454. https://doi.org/10.3390/s25175454

APA Style

Zhang, H., Zhao, Q., Wu, Y., Jiang, D., Chen, X., Liang, X., & Sun, Y. (2025). Integration of Vehicle–Terrain Interaction and Fuzzy Cost Adaptation for Robust Path Planning. Sensors, 25(17), 5454. https://doi.org/10.3390/s25175454

Note that from the first issue of 2016, this journal uses article numbers instead of page numbers. See further details here.

Article Metrics

Back to TopTop