Next Article in Journal
Ex Vivo Optical Coherence Tomography Analysis of Resected Human Bladder with a Forward-Looking Microelectromechanical Systems Mirror-Based Catheter
Previous Article in Journal
Rehabilitation Driven Optimized YOLOv11 Model for Medical X-Ray Fracture Detection
Previous Article in Special Issue
A CPS-Based Architecture for Mobile Robotics: Design, Integration, and Localisation Experiments
 
 
Font Type:
Arial Georgia Verdana
Font Size:
Aa Aa Aa
Line Spacing:
Column Width:
Background:
Article

Obstacle Crossing Path Planning for a Wheel-Legged Robot Using an Improved A* Algorithm

School of Information and Control Engineering, Southwest University of Science and Technology, Mianyang 621010, China
*
Author to whom correspondence should be addressed.
Sensors 2025, 25(18), 5795; https://doi.org/10.3390/s25185795
Submission received: 1 August 2025 / Revised: 2 September 2025 / Accepted: 12 September 2025 / Published: 17 September 2025

Abstract

In response to the challenges of obstacle avoidance and terrain negotiation encountered by wheel-legged robots in static environments with complex obstacles, this study introduces an enhanced A* path planning algorithm that incorporates a jump-point search strategy, a dynamically weighted heuristic strategy, and a continuous jumping constraint mechanism to facilitate efficient obstacle traversal. The algorithm extends the traditional 8-neighborhood rule to support jumping in the horizontal, vertical, and diagonal directions. A dynamic, weighted heuristic is introduced to adaptively adjust heuristic weights, guide the search direction, improve efficiency, and reduce detours. Redundant point removal and Bézier curve smoothing were employed to enhance path smoothness, whereas the continuous jumping constraint limited the jump frequency and improved motion stability. The results validate that—relative to the standard A* algorithm, which achieves a 73.7% reduction in path nodes (from 54 to 16)—85% fewer search nodes (from 542 to 78) and a planning time of 0.0032 s were achieved while also enhancing performance in crossing complex structures. This enhances the capability of wheel-legged robots to perform real-time path planning in structurally complex yet static environments, thereby improving their autonomous navigation efficiency.

1. Introduction

Driven by the ongoing progress in robotics, wheel-legged robots, i.e., robots that harness the hybrid locomotion benefits of wheeled and legged systems [1], have attracted widespread attention due to their superior obstacle crossing ability [2] and adaptability in complex terrain. Wheel-legged robots integrate the high efficiency of wheeled locomotion with the terrain adaptability and flexibility of legged movement, and they perform particularly well in obstacle crossing tasks. However, in practical applications, implementing a stable and computationally efficient path planner in a dynamic environment [3] remains a challenge.
Path planning is typically achieved using methods such as graph traversal, sampling-based searches, and potential field algorithms. The A* algorithm [4] and the Djikstra algorithm [5] are typical graph search algorithms, and the artificial potential field method [6] is a typical implementation of potential field strategies. Random tree [7] is a typical sampling search algorithm that has been broadly adopted for pathfinding in static environments. For example, Wu et al. [8] combined an improved random tree algorithm with the dynamic window method and combined the idea of an artificial potential field to reduce redundant points, thereby significantly improving the efficiency of Unmanned Aerial Vehicles (UAVs) to avoid static and dynamic obstacles. Reinforcement Learning (RL), as a model-free method, has unique advantages in path planning. Through the agent’s autonomous learning of the optimal strategy, it performs outstandingly in scenarios such as dynamic obstacle avoidance and multi action collaborative planning. Typical algorithms include Q-learning [9], DDPG [10], and others. For example, Castañeda et al. [11] used an actor–critic approach to overcome the path planning problem of mobile robots that fully cover the environment. Similarly, addressing navigation in complex environments, Zhang et al. [12] proposed a hierarchical path planning method for wheeled mobile robots in partially known uneven terrain using the A* algorithm for global pathfinding and Q-learning for local obstacle avoidance.
The conventional A* algorithm is characterized by inherent limitations, such as low efficiency, large search range, and poor avoidance of dynamic obstacles [13]. This can impede performance in complex environments. Many scholars have improved this concept. Yao et al. [14] enhanced the performance of the A* algorithm by integrating bidirectional search, the D* Lite algorithm, dynamic obstacle trajectory prediction, and the bat clustering algorithm. The experimental results demonstrated that the proposed approach outperformed traditional algorithms in terms of path planning performance. Qi et al. [15] employed polynomial fitting to improve the smoothness of A* path generation, thereby enhancing the motion comfort of firefighting robots. Ge et al. [16] designed a dual-estimation heuristic function based on both energy consumption and distance, and experiments demonstrated that their method achieved advantages in reducing both the trajectory length and power consumption. Liu et al. [17] adopted phase-specific heuristic functions combined with the artificial potential field method, and comparisons with multiple traditional path planning methods showed significant improvements in path length, number of searched nodes, and time efficiency. Meng et al. [18] used a cost evaluation function to improve search efficiency and combined it with model predictive control to achieve more efficient autonomous parking. Xu et al. [19] added unknown path costs to upgrade A* algorithm to strengthen its path planning capability in challenging and dynamic scenarios. Priya et al. [20] proposed a dynamic weighted A* algorithm to achieve stable operation of autonomous driving vehicles in dynamic environments in response to the problems faced by vehicles in dynamic environments. Fu et al. [21] used an improved A* algorithm with a new cost function to design global navigation routes for unmanned surface vessels operating in island and reef-dense regions, thereby improving navigation efficiency in island and reef areas. Xu et al. [22] targeted the path planning problem in a greenhouse by broadening the search neighborhood, employing the Floyd algorithm to optimize the path and improving accuracy and search speed. Saeed et al. [23] blended PID control logic into an A-based planning approach and adjusted the heading based on feedback, thereby enabling a ship to faster reach the optimal route underwater. Yu et al. [24] applied a refined A* algorithm incorporating adaptive extended convolution for UAV path planning, significantly decreasing both the number of explored nodes and the computation time. Despite its widespread use, the conventional A* algorithm is characterized by inherent limitations, such as low search efficiency and large search range, which can impede its performance in complex environments. Numerous scholars have proposed improvements that often focus on enhancing the search speed using bidirectional [14] or dynamic search methods [14,20], optimizing path smoothness using polynomial fitting [15], or reducing operational costs such as energy consumption [16]. Other advanced techniques, such as the receding horizon motion planning method proposed by Zhang et al. [25] for quadrotors, utilize B-splines and nonlinear optimization to generate safe and efficient trajectories for dynamic obstacle avoidance. Other studies have improved heuristic [16,17] or cost functions [18,19,21] to guide the search more efficiently, achieving better performance in terms of path length and computation time. A recent study by Sun et al. [26] further illustrated the advanced avoidance strategies for wheel-legged robots. They integrated Theta* and TEB algorithms, classifying obstacles to enable separate path planning for the robot’s body and wheels. Although this method effectively generates smoother and safer avoidance trajectories, it is fundamentally designed to navigate obstacles. The core logic does not intrinsically evaluate or incorporate high-cost, high-reward traversal actions, such as jumping, as a strategic alternative to circumnavigation. This highlights a critical distinction: our work focuses not only on maneuvering around obstacles, but also on equipping the planner with the decision-making capability to physically cross them when it proves more efficient. However, these general improvements primarily target obstacle avoidance [22,23,24] and do not equip a planner with the logic to handle the unique multi-modal capabilities of wheel-legged robots, specifically the decision to perform high-cost, high-reward actions, such as obstacle crossing [27].
This challenge is especially relevant for complex tasks such as obstacle negotiation. While some studies have explored multi-modal path planning, such as for flying cars [28] (which can switch between ground and air travel to overcome obstacles), these approaches are not directly transferrable to the specific kinematics and stability constraints of wheel-legged robots. Moreover, the core of obstacle crossing for legged systems involves not only a high-level path, but also low-level control for maneuver execution, such as determining foothold selection and developing robust crossing strategies for specific obstacles. De Luca et al. [29] developed a method for a hybrid-legged/wheeled robots to adaptively traverse various terrains. Their method uses primitive behaviors based on ground and obstacle geometries with a perception module that processes LiDAR data to identify terrain features. This enables the autonomous selection and sequencing of traversal behaviors. Chen et al. [30] presented a method to improve the locomotion efficiency of a quadrupedal robot, which is better at traversing terrain but less efficient than wheeled robots. This method uses an optimized stance and CNN-based foothold classifier. It was validated in stair climbing tests with the Pegasus robot. Our work focuses on the high-level path planning that must precede these actions, enabling the robot to strategically identify when and where a jump is more advantageous than a detour.
It is also important to distinguish our approach from the well-known Jump Point Search (JPS) algorithm, which is another significant optimization of A*. JPS accelerates pathfinding by identifying “jump points” that allow the search to bypass large areas of the grid, thereby pruning the search space. Harabor et al. [31] proposed a novel search strategy for pathfinding in uniform-cost grid environments. This algorithm identifies and expands specific nodes, called jump points, to achieve fast optimal path calculations with no memory overhead. This study demonstrates that using jump points can significantly accelerate the A* algorithm while always ensuring optimal solutions; however, these “jumps” are a conceptual search pruning mechanism and do not represent a robot’s physical movement. In contrast, our work introduces a physically grounded “jump” action corresponding to a wheel-legged robot’s actual obstacle crossing capability. Therefore, our use of “jump points” specifically refers to the start and end nodes of a physical traversal over an obstacle, a concept distinct from the search optimization nodes in the JPS framework.
Therefore, how to optimize the existing path planning algorithm to enhance its adaptability to the obstacle crossing demands of wheel-legged robots in complex terrain has become an important direction of current research. To address the issues of low efficiency, inability to perform obstacle crossing actions, and unsmooth, tortuous paths when traditional A* algorithms are used for path planning in wheel-legged robots, this paper proposes an improved A* path planning method specifically designed for wheel-legged robots. The motivation of this study is to enable robots to flexibly integrate obstacle avoidance and obstacle crossing behaviors, thereby enhancing their real-time adaptability and motion stability. The proposed method incorporates three core strategies: (i) an obstacle crossing mechanism based on 16-neighborhood expansion, supporting jumping actions in the horizontal, vertical, and diagonal directions; (ii) a dynamically weighted heuristic function combined with a continuous jumping constraint mechanism to balance search efficiency and path stability; and (iii) redundant point removal and Bézier curve smoothing to improve path continuity and smoothness.
The main contributions of this study are as follows:
(1)
A jump-extended A* framework is designed to leverage the unique obstacle crossing capability of wheel-legged robots, enabling the efficient traversal of surmountable obstacles.
(2)
A dynamic heuristic weighting mechanism and continuous jumping constraints were introduced to enhance search efficiency while ensuring stability.
(3)
The proposed algorithm was validated through extensive simulations on complex grid maps, demonstrating significant improvements in path length, smoothness, and obstacle crossing capability compared with the traditional A* algorithm.

2. Materials and Methods

2.1. Environmental Model

Path planning for obstacle crossing and avoidance in wheel-legged robots was developed using a grid-based approach [32]. The grid environment model discretizes complex terrain and obstacle information into a regular two-dimensional grid. Each grid cell represents a discrete cell in the environment, which can effectively simplify the path planning problem.
The model discretizes complex terrain into two-dimensional regular grids, each of which contain three types of states, as shown in Figure 1: free area (white), insurmountable obstacle (black), and surmountable obstacle (gray). Gray obstacles are permissible to cross, but the barrier-free conditions of the middle grid must be satisfied (e.g., diagonal crossings must be unobstructed in both adjacent directions). When planning the path, the improved A* algorithm integrates the 8-neighborhood obstacle crossing movement rules, giving priority to expanding the jump points across the gray obstacles while avoiding the black obstacles. The algorithm optimizes the search direction through a dynamic weighted heuristic function and marks the explored area, optimal path, and obstacle crossing points through a visual matrix.

2.2. Basic Theory of the A* Algorithm

In 1968, Hart et al. [33] proposed the A* algorithm by combining the Dijkstra and greedy search algorithms. It is frequently applied in path planning scenarios and graph traversal search algorithms. The value function is expressed as follows:
f ( n ) = g ( n ) + h ( n ) ,
where n represents a specific node in the search space, g(n) denotes the actual cost of moving from the start node to node n, h(n) denotes the estimated heuristic cost from node n to the goal node, and f(n) denotes the comprehensive cost of node n.
Heuristic estimations are primarily derived from Manhattan, Euclidean, and diagonal distance calculations.
h m a n ( n ) = x n x g + y n y g ,
h e u c l ( n ) = Δ x 2 + Δ y 2                 Δ x = x n x g , Δ y = y n y g ,
h c h e b ( n ) = x n x g ,   y n y g ,
where (xn, yn) indicates the current position, and (xg, yg) indicates the goal position.

2.3. Obstacle Crossing Action Extension Mechanism

Jumping is a key obstacle crossing motion mode in the path planning of wheel-legged robots. The traditional A* algorithm extended to incorporate 8-neighborhood connectivity mainly serves the obstacle avoidance environment on the ground, and it is difficult to directly handle the interaction between the jumping trajectory and obstacles. To this end, this study adds an obstacle crossing mobility mechanism based on the original neighborhood and optimizes the safety constraints. In Figure 2, the neighborhood expansion is as follows:
The extended neighborhood includes eight standard moves and eight “jump” moves. A jump allows the robot to move over a single grid cell to land two cells away, horizontally, vertically, or diagonally. To ensure physical feasibility and to avoid collisions, every potential jump was evaluated against a strict set of rules: let the robot’s current node be at coordinates (x, y), then the validity of a jump depends on the status of the intermediate cell being jumped over and landing cell.
A horizontal jump from (x, y) to (x + 2, y) is possible if and only if the following apply: (1) The intermediate cell at (x + 1, y) must be a “crossable obstacle” (gray) and is an obstacle that needs to be surmounted. (2) The landing cell at (x + 2, y) must be “free space” (white). (3) The landing cell (x + 2, y) must be within map boundaries.
A diagonal jump from (x, y) to (x + 2, y + 2) has more complex safety requirements to prevent impassable obstacles. It is possible if and only if the following apply: (1) The intermediate cell at (x + 1, y + 1) must be a “crossable obstacle” (gray). (2) The landing cell at (x + 2, y + 2) must be “free space” (white). (3) The adjacent “corner” cells, (x + 1, y) and (x, y + 1), must not be “non-crossable obstacles” (black), which ensures that the robot has a clear path and does not collide with a wall or other impassable barriers during the jump. (4) The landing cell (x + 2, y + 2) must be within the map boundaries.
This detailed rule-based approach ensures that every potential jump is rigorously vetted for safety and feasibility before being considered by the path planner. The obstacle moving logic systematically applies these checks for all 8 possible jump directions from the current node.
As presented in Figure 3, the logic for crossing obstacles is shown.
The obstacle moving logic is as follows.
Step 1: For the current node, iterate through the eight potential jump directions (horizontal, vertical, and diagonal) to determine the coordinates of the intermediate and landing nodes.
Step 2: Check the boundaries to ensure that all coordinates are within the map; otherwise, this jump direction is invalid.
Step 3: Check the attributes of the intermediate and landing nodes based on the rules for horizontal/vertical or diagonal jumps as described above. A jump is only valid if the intermediate node is a crossable (gray) obstacle and the landing node is free space (white). Otherwise, the node is abandoned, and Step 1 is executed again.
Step 4: For a diagonal jump, perform an additional collision avoidance check to ensure that the adjacent corner nodes are not non-crossable (black) obstacles.
Step 5: If all checks for a jump direction are passed, calculate the cost of this move. If this new path to the landing node is cheaper than any existing path, it is recorded as a potential jump point and the node’s cost is updated. Otherwise, return to Step 1.
Step 6: Process other directions and repeat Steps 1–5 until all directions are processed.
Jump points are exclusively recorded when the robot lands after crossing a gray obstacle. This strategy of expanding the neighborhood by integrating jumps enables the robot to both effectively avoid obstacles in complex environments and flexibly respond to obstacle crossing tasks, thus improving the robot’s adaptability in static environments with complex obstacles.

2.4. Dynamically Weighted Heuristic Function, Path Cost, and Admissibility Analysis

When facing intricate obstacle terrains, the traditional A* algorithm can be inefficient because of its fixed heuristic weight. To overcome this, a dynamic weighting strategy, which adaptively adjusts the influence of the heuristic function during the search, was adopted. In this strategy, the dynamic weight, ω ( n ) = 1 + α ( r / R ) , is defined and applied to the standard Euclidean heuristic, h e c u l ( n ) . The influence of the heuristic term is adjusted using this dynamic weight, where α is the dynamic adjustment coefficient used in the calculation. The resulting weighted heuristic, h ( n ) , is calculated using the following core formula.
When facing intricate obstacle terrains, the traditional A* algorithm has difficulty in achieving optimal search efficiency owing to fixed weights; therefore, a dynamic weighting strategy for the heuristic function is introduced, as shown in Equation (3). In this strategy, the influence of the heuristic term is adjusted using the dynamic weight ( 1 + α · ( r / R ) ) , where α is the dynamic adjustment coefficient. The core formula is as follows:
f ( n ) = g ( n ) + h ( n ) ,
h ( n ) = ( 1 + α r R ) h e c u l ( n ) ,
where r and R are the Euclidean distances from the present state to the target location and from the starting point to the target location, respectively; and α is the dynamic adjustment coefficient. At the beginning of the search, priority is given to finding the nearest path to increase search speed and reduce detours. When approaching the endpoint, search accuracy was improved. When gray obstacles that can be crossed are encountered, priority is given to the nodes that can be jumped over to reduce the path length.
It is important to analyze the impact of this dynamic weighting on the theoretical properties of the A* algorithm, specifically its admissibility. An algorithm is admissible if it is guaranteed that it will find the optimal path. Standard A* maintains admissibility when its heuristic function, h(n), never overestimates the true cost of the goal. In our method, the weight ω is greater than 1 when α > 0. This makes the heuristic ω ( n ) h e c u l ( n ) inadmissible as it may overestimate the true cost.
This modification transforms the algorithm into a weighted A*, which intentionally trades optimality for speed. For robotic applications requiring real-time path planning, finding a computationally efficient, near-optimal path is often more critical than guaranteeing the absolute shortest path at a higher computational cost. Parameter α allows us to control this trade-off, and a detailed sensitivity analysis to determine its value is presented in Section 3.5.
For the path cost term, the costs are assigned based on the type of node transition. For standard movements, the step cost is calculated using the Euclidean distance. For obstacle crossing (jump) movements, a higher fixed cost cjump was defined. This cost is intentionally set to be approximately twice that of the standard single-grid movement cost to reflect the increased energy expenditure and kinematic complexity associated with jumping actions. The act of jumping across a grid cell is kinematically equivalent to moving across two grid cells conventionally. Therefore, the cost for horizontal or vertical jumps is set to cjump = 2.0, which is twice the cost of a single horizontal/vertical movement. Similarly, diagonal jumps are equivalent to two consecutive diagonal movements, and their cost is set at cjump ≈ 2.8 to reflect the corresponding higher expense. A high cost makes the obstacle crossing mechanism useless as the robot will always prefer a long detour. Our chosen medium cost of approximately twice the standard movement cost provides a desirable balance, enabling the robot to use jumps strategically to significantly improve path efficiency while acknowledging that jumping is a more demanding action.
g ( n ) = g ( p ) + n p 2 if   standard   movement g ( p ) + c j u m p if   jump   movement ,
where g(p) denotes the cumulative path cost of the parent node, and n p 2 represents the Euclidean distance between node n and its parent node p.

2.5. Continuous Obstacle Crossing Constraint Mechanism

However, the dynamic weighting mentioned in the previous section may lead to problems with continuous jumping. In the early stages of the search, a larger weight ω makes the algorithm more “greedy,” favoring paths that advance rapidly toward the goal, which can include a series of consecutive jump actions. For a physical wheel-legged robot, continuous, high-frequency jumping significantly increases energy consumption and motion instability, potentially leading to mission failure. To strike a balance between the search efficiency and dynamic stability of a robot, it is crucial to introduce a mechanism that constrains this continuous jumping behavior.
To address the potential for the continuous jumping introduced by the dynamic weighting discussed in the previous section, a state-driven continuous obstacle crossing constraint mechanism was embedded in the improved A* algorithm to ensure the robot’s motion stability. When the robot reaches a new target point through obstacle crossing, the node is marked as the last jump. If it is false, the next step is to perform expansion in the conventional and obstacle crossing directions; if it is true, the next step is restricted to conventional movement only. This mechanism constrains the continuous obstacle crossing action. Figure 4 presents the flowchart.

2.6. Redundancy Point Optimization

In path planning algorithms, particularly when applying the A* algorithm to path search tasks, the generated path may contain redundant nodes. To improve path quality while ensuring path feasibility and obstacle avoidance, the algorithm prunes redundant nodes with the aim of replacing multiple line segments with a single line segment whenever possible. The algorithm specifically considers the “jump points” defined in this study, marking all nodes involved in the jumps or obstacles as essential points to ensure that these actions are not removed during optimization. The core concept of the algorithm is as follows:
Step 1: Create an empty new path sequence Pnew. The starting point P1 of the original path P is added as the first node to Pnew. Initialize index pointer i ← 1, which points to the index of the last confirmed and retained node in Pnew within the original path P.
Step 2: Start a loop iteration, where each iteration uses Pi as the root node, Pi+1 as the node to be checked, and Pi+2 as the target node, forming a sliding detection window. The core of the algorithm is to determine whether there is an unobstructed straight-line path between the root node Pi and the target node Pi+2. The two principles are as follows: (1) Confirm that the node to be checked, Pi+1, is not a critical node that must be retained and that the target node Pi+2 exists. (2) If Pi+1 is not a critical node, use the Bresenham line algorithm to check whether there is a collision with obstacles when moving from Pi to Pi+2.
Step 3: Decisions are made based on the detection results from Step 2: If there are no obstacles detected from Pi to Pi+2, then node Pi+1 is a redundant point. In this case, delete Pi+1, the target node Pi+2 is stored as the next critical point in the Pnew sequence, and the index pointer i is updated to i + 2; if there are obstacles detected from Pi to Pi+2, or if Pi+1 is a retained critical node, then Pi+1 is a turning point. Next, add it to the Pnew sequence and update the index pointer i to i + 1.
Step 4: Repeat Steps 2 and 3 until the detection window index exceeds the range of the original path P. The path retains only the starting point, the end point, necessary turning points, and jump points.
It can be obviously seen from Figure 5 that A → B → C → D → E → F is the original obstacle crossing path, where C and D are jumping points. Considering three consecutive points A, B, and C on the path, if the line from A to C does not pass through any obstacle, then B is a redundant point. To ensure the continuity of the obstacle crossing action, obstacle crossing points C and D cannot be deleted. If there is no obstacle from D to F, the intermediate node E can be deleted, and finally, a simplified path is obtained: A → C → D → F.

2.7. Bezier Curve Smoothing

The A* path planning approach, built upon a graph search, was formed by multiple straight lines. The wheel-legged robot cannot change direction precisely during operation owing to hinge points. Bezier curves are required to optimize the path smoothness. The core equation is based on Bernstein basis functions:
B ( t ) = i = 0 n ( n i ) ( 1 t ) n i t i P i   ( t [ 0 ,   1 ] ) ,
where B(t) is the curve trajectory function, n defines the curve’s degree, Pi represents the control point, and t is a parameter. This study employed a second-order Bézier curve to enhance the path smoothness. Below is the form of the second-order Bezier curve:
B ( t ) = ( 1 t ) 2 P 0 + 2 ( 1 t ) P 1 + t 2 P 2 ,   t [ 0 ,   1 ] .
Figure 6 shows a diagram illustrating the second-order Bézier curve optimization, and the following are the exact steps:
Step 1: Extract nodes P0, P1, and P2 from the closed list to generate a polyline path.
Step 2: Select parameter t to calculate the middle point Q0(t), Q1(t) and move along the two line segments with t. As shown in Figure 6, take t = 0.25, 0.5 and 0.75 as follows:
Q 0 ( t ) = ( 1 t ) P 0 + t P 1 Q 1 ( t ) = ( 1 t ) P 1 + t P 2
Linearly interpolate between each pair of corresponding points Q0(t) and Q1(t) to determine the final point B(t) on the curve.
Step 3: Generate a Bezier curve defined by Pi, Pi+1, and Pi+2 with redundant points removed. To ensure that the path is collision-free, the curve is discretized into a high-density sequence of intermediate points. The sampling parameter, t, is varied from 0 to 1 with a small step size (e.g., generating 30 points per curve segment) to create these points. Each discrete point on the curve is then mapped to its corresponding grid cell. The algorithm checks every cell for collisions with impassable obstacles (black cells).
Step 4: If the intermediate point, Pi+1, is a designated jump point, it must be preserved to ensure the obstacle crossing maneuver is executed. In this case, the algorithm retains Pi+1 and advances its window to start the next iteration from (Pi+1, Pi+2, and Pi+3).
If Pi+1 is not a jump point, generate a candidate second-order Bézier curve, B(t), using Pi, Pi+1, and Pi+2 as the control points.
If the entire discretized curve is verified as collision-free, then the original sharp corner at Pi+1 is replaced by the smoothed Bézier curve. The algorithm then advances its window in two steps to the next set of waypoints starting at Pi+2. If any part of the curve is found to collide with an obstacle, the curve is discarded, waypoint Pi+1 is retained, and the window advances by one step to the next iteration starting from Pi+2.
Step 5: Repeat the process until all points in the path are processed. This ensures that the final smoothed path is continuous, avoids all obstacles, and preserves the required jump points.
While the introduction of Bézier curve smoothing and its associated collision-checking procedure introduces a minor computational overhead, its impact on real-time performance is negligible within the overall planning framework. This is because the smoothing is applied only to the final, significantly shortened path generated by the optimized A* search. However, these benefits are substantial in terms of the physical execution of the robot. The resulting smooth trajectory eliminates the need for abrupt stops and sharp turns at waypoints, which are kinematically inefficient and energetically expensive. By enabling the robot to maintain a more consistent velocity and reducing the frequency of acceleration/deceleration cycles, the smoothed path directly contributes to lower energy consumption and to reduced mechanical stress on the robot’s hardware, thereby enhancing the overall operational efficiency and longevity of the system.

3. Results

3.1. Experimental Environment Configuration

The proposed algorithm was validated using deterministic simulations. Similar to the traditional A* algorithm, it consistently produced the same path and performance metrics for any static environment with defined starting and goal points. Unlike stochastic algorithms, which require multiple runs for statistical significance, repeated trials on the same map yielded identical results. However, we conducted ten repeated trials. Thus, our validation focused on a comprehensive comparative analysis of different algorithm versions and a sensitivity analysis of the parameters under various conditions. This approach rigorously assesses the performance, robustness, and effectiveness of the proposed improvements without requiring statistical analysis of repeated runs.
This experiment was implemented in MATLAB 2022a under the hardware environment of a Windows 11 system, a 3.20 GHz AMD Ryzen 7 6800 H CPU, and 16 GB of RAM. A 40 × 40 grid map was constructed and static black insurmountable obstacles and gray surmountable obstacles were randomly generated.

3.2. Verification of the Effectiveness of Obstacle Surmounting Capability

To evaluate the performance advantage of the enhanced A* algorithm in the wheel-legged robot obstacle traversal task, this study carried out a comparative experiment using a 40 × 40 grid map. The environmental settings were as follows: the total obstacle density was 20% (black obstacles 12%, gray obstacles 8%), and the starting location (1, 1) and target point (40, 40) were fixed. The experiments were divided into two groups: the traditional A* algorithm and the obstacle crossing A* algorithm, as shown in Figure 7. As described in Section 2.4, the cost of horizontal/vertical jumping was assigned a constant value of 2, and the cost of diagonal blending was assigned a constant value of 2.8.
As shown in Figure 7 and Table 1, the traditional A* algorithm was compared with the obstacle crossing A* algorithm. Table 1 provides a comparison of the path length, search range, total number of jumps, and time consumption of the two algorithms in the above map. According to the simulation results, the traditional A* algorithm is forced to detour in areas with dense gray obstacles because it cannot utilize jumping actions. Owing to the obstacle crossing performance of the wheel-legged robot, adding an obstacle crossing to the A* algorithm can cross gray obstacles and thus greatly reduce the path length.

3.3. Multi-Scenario Adaptability Evaluation

To assess the function of the obstacle crossing A* algorithm more accurately, three different scenarios were used to conduct the experiments, as shown in Figure 8 and Table 2.
As shown in Figure 8 and Table 2, the improved obstacle crossing A* algorithm showed good path planning capabilities in different scenarios. Although the path length increased slightly in some scenarios (such as 63.35 in Scenario 2), it performed stably in terms of path node optimization, search range compression, and jumping ability, effectively balancing the path quality and computational efficiency. This also demonstrates that the algorithm has good environmental adaptability.
Further analysis of the three paths shows that, even under different obstacle distributions, the paths generated by the algorithm have structural differences; however, they can effectively avoid obstacles by introducing a jumping mechanism to form a shorter and smoother path. This is attributed to the deterministic search framework and jump point guidance mechanism adopted by the algorithm, which can efficiently complete path search in static complex terrain, has good real-time stability, and can meet the needs of wheel-legged robots for fast path planning in complex environments. In particular, in Scenario 3, due to the presence of obstacles around the endpoint, which are gray and crossable, conventional obstacle avoidance would not allow reaching the destination. However, by incorporating the unique obstacle crossing capability of the wheel-legged robot, this feature can be utilized to reach the endpoint, thereby validating the effectiveness of the algorithm presented herein.

3.4. Comparison of the Obstacle Span Performance

As described in Section 2.3, we incorporated the unique obstacle crossing mechanism of wheel-legged robots into the traditional A* algorithm, enabling them to easily cross single-grid low-height obstacles. To verify this performance improvement, we conducted a comparative experiment by crossing two consecutive obstacles in the same scenario.
The experimental results (Figure 9 and Table 3) show that while crossing two consecutive obstacles can slightly shorten the path length and reduce the number of path nodes such a maneuver involves greater kinematic complexity and risk. In practical applications, increasing the jump distance can negatively affect the landing stability of the robot and the overall success rate of the action. Therefore, despite the marginal path improvement shown in the simulation, we ultimately chose to retain the more reliable single-grid obstacle crossing solution to ensure higher motion stability and robustness in real-world scenarios.

3.5. Dynamic Heuristic Function Optimization

As discussed in Section 2.4, the dynamic adjustment coefficient α controls the balance between the search efficiency and path optimality. While the obstacle crossing mechanism improves the path directness, the search scope can remain large, as shown in Table 1. To address this issue, we introduced a dynamic heuristic weighting strategy. To determine an appropriate value for α, we conducted a sensitivity analysis by running the algorithm in the same scenario with the α set to various values: 0, 0.25, 0.5, 0.75, 1.0, and 1.5. The results are shown in Figure 10 and Table 4.
The data clearly demonstrate a trade-off controlled by α. As α increases, the heuristic becomes more aggressive, which significantly reduces the search scope (number of expanded nodes) and the planning time. For instance, increasing α from 0 to 0.5 reduces the search scope from 547 to 80 nodes—an 85.3% reduction. However, this gain in efficiency comes at the cost of a slightly longer suboptimal path (path length increases from 61.01 to 63.35, i.e., a 3.8% increase). When α is increased beyond 0.5, the gains in search scope reduction become marginal, whereas the path quality may degrade further. Therefore, we selected α = 0.5 as it offered an excellent compromise, drastically improving the search efficiency while maintaining a near-optimal path.

3.6. Verification of the Continuous Obstacle Crossing Constraint Mechanism

As shown in Section 3.5, after adding dynamic heuristic weights, the search range was significantly reduced, but continuous obstacle crossing occurred owing to an increase in the initial search speed. To verify the effectiveness of the continuous obstacle crossing constraint mechanism proposed in Section 2.5, the improved obstacle crossing A* algorithm with the constraint mechanism enabled was compared with the baseline algorithm without the mechanism enabled.
From Figure 11 and Table 5, we can see that enabling the constraint did not significantly cause the path to detour. Instead, the path was optimized because of a more reasonable jump arrangement. When the path quality was preserved, the jump count was significantly minimized, the motion stability of the robot was improved, and the potential for dynamic instability caused by high-frequency continuous jumps was effectively avoided.

3.7. Comprehensive Performance Comparison Analysis

3.7.1. Analysis of a 40 × 40 Grid

To address the requirements of wheel-legged robots for obstacle crossing and avoidance in complex terrains, this study proposes an improved A* algorithm that integrates a jump point search mechanism and a dynamic weighted heuristic strategy. The algorithm expands the traditional 8-neighborhood search to support multi-directional jump paths (horizontal, vertical, and diagonal) and combines this with refining the path by eliminating unnecessary points and applying Bézier curve smoothing to effectively optimize the performance and smoothness of the planned path.
In the experiments, obstacles were categorized as insurmountable (black) and surmountable (gray), allowing the algorithm to achieve unified integration of avoidance and crossing strategies through differentiated processing. A comprehensive performance comparison showed that, in a 40 × 40 grid map, the fully optimized algorithm demonstrated significant improvements over the traditional A* algorithm. From Figure 12 and Table 6, the number of path nodes was reduced from 54 to 16 (a 70.4% reduction), the number of search nodes decreased from 542 to 78 (an 85.6% reduction), and the path length was also shortened. These results highlight the strong real-time performance and environmental adaptability of the algorithm.

3.7.2. Scalability Analysis

To test the performance of the algorithm under different map sizes and obstacle densities, we maintained a constant obstacle density (20%) and ran the optimized algorithm and traditional A* algorithm on maps of various sizes, such as 20 × 20, 40 × 40, and 60 × 60, as shown in Figure 13 and Table 7.
The experimental results clearly demonstrate that the superiority of the optimized algorithm over the traditional A* algorithm became more pronounced as the map size increased. As the map expanded from 20 × 20 to 60 × 60, our proposed algorithm consistently maintained a significant advantage in reducing the number of search nodes and path nodes while also generating shorter and more efficient paths. This trend highlights the excellent scalability and robustness of our method, confirming its suitability for path planning tasks in larger and more complex environments.

4. Discussion

Aiming at the obstacle crossing and avoidance requirements of wheel-legged robots in complex terrains, this study proposes an improved A* algorithm that integrates a jump-point search mechanism and a dynamic weighted heuristic strategy. The algorithm expands the traditional 8-neighborhood to support multi-directional jump paths (horizontal, vertical, and diagonal) and combines redundant point removal with Bézier curve smoothing to effectively optimize the performance and smoothness of the planned path. In the experiments, obstacles were categorized as insurmountable (black) and surmountable (gray), allowing the algorithm to achieve unified integration of avoidance and crossing strategies through differentiated processing. The experimental results are compelling. In a 40 × 40 grid map, the improved algorithm reduces the number of path nodes by 73.7% (from 54 to 16) and shrinks the search range by 85% (from 542 to 78 nodes), with a planning time of only 0.0032 s, when compared to the traditional A* algorithm. Furthermore, a scalability analysis confirmed that the superiority of the algorithm becomes more pronounced as the map size increases, highlighting its excellent robustness and strong real-time performance for practical applications in larger environments.
This study validated the effectiveness of the proposed algorithm through simulation experiments in a 2D grid map environment. These results serve as a foundational validation of the algorithm’s core logic. The 2D grid map is a simplification and abstraction of the real world, where gray, crossable obstacles simulate barriers that can be traversed with a jump, such as rubble or low mounds, whereas black, non-crossable obstacles represent features that cannot be jumped, such as walls or high steps; however, despite this, we acknowledge the limitations of the current MATLAB-based 2D simulations. A key simplification in this study is the treatment of the robot as a point particle, which intentionally abstracts away complexities, such as robot dimensions, kinematics, dynamics, and precise foot placement, during jumps. This abstraction is a common practice in foundational path planning research to isolate and validate the core logic of the algorithm. The 2D grid map is a further simplification of the real world, where gray, crossable obstacles simulate barriers that can be traversed with a jump, such as rubble or low mounds, while black, non-crossable obstacles represent features that cannot be jumped, like walls or high steps. To fully substantiate the engineering applicability and motion stability of the algorithm, further validation on a physical robot platform or within a high-fidelity physics-based simulator, such as Gazebo, is essential. This constitutes the core of our future research.
Future research will focus on bridging the gap between current simulations and real-world applications. Furthermore, we recognize that the current study was confined to static environments. The next step is to extend the applicability of the framework to dynamic scenarios. This will involve integrating our high-level strategic planner with reactive, real-time collision avoidance algorithms, such as the Dynamic Window Approach (DWA), to create a hybrid planning system capable of navigating environments with moving obstacles. To overcome the limitations of this study, we developed a physical wheel-legged robot prototype for deploying the proposed algorithm. The next phase involved integrating a stereo camera to enable real-time 3D environmental perception, allowing for a transition from simplified 2D grid maps to more realistic 3D point cloud representations. Consequently, obstacles were defined by their actual physical dimensions, such as height and slope, rather than as a binary “crossable/non-crossable” state. The jump cost function was further refined by integrating the robot’s dynamic model to ensure that all planned maneuvers were both physically feasible and stable. This future work will significantly advance the practical applicability of the algorithm for complex missions, such as search and rescue or planetary exploration.

5. Conclusions

This study successfully developed and validated an improved A* algorithm tailored to the unique path planning challenges of wheel-legged robots in complex, static environments. By introducing an obstacle crossing mechanism with a 16-neighborhood search, a dynamic heuristic weighting strategy, and a continuous jumping constraint, the proposed algorithm fundamentally enhances the robot’s ability to intelligently decide between detouring around or jumping over obstacles. Further refinements, including refining the path by eliminating unnecessary points and applying Bézier curve smoothing, ensure that the final path is efficient.
The comprehensive simulation results demonstrate the significant superiority of our method over the traditional A* algorithm. In a 40 × 40 grid map, the optimized algorithm achieved a 73.7% reduction in path nodes and an 85% reduction in search nodes, all while generating a shorter and smoother trajectory. Scalability analysis confirmed that these performance gains become even more pronounced in larger environments, highlighting the robustness and efficiency of the algorithm. By equipping the path planner with a strategic obstacle negotiation capability, this study provides a robust foundation for enhancing the autonomous navigation and operational effectiveness of wheel-legged robots in challenging terrains.

Author Contributions

Conceptualization, M.P. and J.L.; Methodology, J.L. and M.P.; Software, J.L.; Validation, J.L. and G.Z.; Formal Analysis, J.L. and M.P.; Investigation, J.L. and G.Z.; Resources, M.P.; Data Curation, G.Z.; Writing—Original Draft, J.L.; Writing—Review and Editing, M.P. and G.Z.; Visualization, J.L.; Supervision, M.P.; Project Administration, M.P.; Funding Acquisition, M.P. All authors have read and agreed to the published version of the manuscript.

Funding

This research was funded by the Sichuan Provincial Key R&D Program (Grant No. 2024YFFK0039) and the Doctoral Research Fund of the Southwest University of Science and Technology (Grant No. 21zx7142). The APC was funded by the same source.

Institutional Review Board Statement

This study did not involve humans or animals; therefore, ethical approval was not required.

Informed Consent Statement

Not applicable.

Data Availability Statement

No new data were created or analyzed in this study. Data sharing was not applicable in this study.

Conflicts of Interest

The authors declare no conflicts of interest.

References

  1. Nagano, K.; Fujimoto, Y. Simplification of Motion Generation in the Singular Configuration of a Wheel-Legged Mobile Robot. IEEJ J. Ind. Appl. 2019, 8, 745–755. [Google Scholar] [CrossRef]
  2. Deng, J.; Zeng, X.; Zhang, K.; Tong, J.; Liu, F.; Zhang, Z. Optimization Method for Obstacle Crossing of Transmission Line X-ray Inspection Robot Based on Multiple Points of Interest. In Proceedings of the 2025 International Conference on Mechatronics, Robotics, and Artificial Intelligence (MRAI), Jinan, China, 19–21 June 2025; pp. 399–402. [Google Scholar]
  3. Wang, D.; Liu, B.; Jiang, H.; Liu, P. Path Planning for Construction Robot Based on the Improved A* Algorithm and Building Information Modeling. Buildings 2025, 15, 719. [Google Scholar] [CrossRef]
  4. Guo, J.; Huo, X.; Guo, S.; Xu, J. A Path Planning Method for the Spherical Amphibious Robot Based on Improved A-star Algorithm. In Proceedings of the 2021 IEEE International Conference on Mechatronics and Automation (ICMA), Takamatsu, Japan, 8–11 August 2021; pp. 1274–1279. [Google Scholar]
  5. Shi, X.; Liu, H.; Li, Y.; Zhu, B.; Liang, J. Location Planning of Field Ammunition Depot for Multi-stage Supply Based on Dijstra Algorithm. In Proceedings of the 2021 4th International Conference on Applied Mathematics, Modeling and Simulation (AMMS 2021), Guangzhou, China, 17–18 September 2021; pp. 95–101. [Google Scholar]
  6. Nasuha, A.; Priambodo, A.S.; Pratama, G.N.P. Vortex Artificial Potential Field for Mobile Robot Path Planning. In Proceedings of the 5th International Conference on Electrical, Electronics, Informatics, and Vocational Education (ICEELINVO 2022), Yogyakarta, Indonesia, 5–6 October 2022; p. 2406. [Google Scholar]
  7. Ding, J.; Zhou, Y.; Huang, X.; Song, K.; Lu, S.; Wang, L. An Improved RRT* Algorithm for Robot Path Planning Based on Path Expansion Heuristic Sampling. J. Comput. Sci. 2023, 67, 101937. [Google Scholar] [CrossRef]
  8. Wu, T.; Zhang, Z.; Jing, F.; Gao, M. A Dynamic Path Planning Method for UAVs Based on Improved Informed-RRT* Fused Dynamic Windows. Drones 2024, 8, 539. [Google Scholar] [CrossRef]
  9. Zhao, J.; Yang, C.; Wang, W.; Li, Y.; Qie, T.; Xu, B. An Improved Elitist-Q-Learning Path Planning Strategy for VTOL Air-ground Vehicle Using Convolutionalneural Network Mode Prediction. Adv. Eng. Inform. 2025, 65, 103316. [Google Scholar] [CrossRef]
  10. Zhang, D.; Ju, R.; Cao, Z. DDPG-based Path Planning for Cable-driven Manipulators Inmulti-obstacle Environments. Robotica 2024, 42, 2677–2689. [Google Scholar] [CrossRef]
  11. Garrido-Castañeda, S.I.; Vasquez, J.I.; Antonio-Cruz, M. Coverage Path Planning Using Actor–Critic Deep Reinforcement Learning. Sensors 2025, 25, 1592. [Google Scholar] [CrossRef]
  12. Zhang, B.; Li, G.; Zheng, Q.; Bai, X.; Ding, Y.; Khan, A. Path Planning for Wheeled Mobile Robot in Partially Known Uneven Terrain. Sensors 2022, 22, 5217. [Google Scholar] [CrossRef]
  13. Wu, B.; Chi, X.; Zhao, C.; Zhang, W.; Lu, Y.; Jiang, D. Dynamic Path Planning for Forklift AGV Based on Smoothing A* and Improved DWA Hybrid Algorithm. Sensors 2022, 22, 7079. [Google Scholar] [CrossRef]
  14. Yao, Z.; Sun, J.; Han, C.; Jin, L. A Path-Planning Algorithm Integrated Improved A* and D* Lite with Bat Clustering. J. Comput. Methods Sci. Eng. 2024, 25, 2159–2184. [Google Scholar] [CrossRef]
  15. Qi, W.; Liu, X.; Yuan, K.; Chen, W. Improved A* Path Planning Algorithm for Fire Robot. World Sci. Res. J. 2024, 10, 12–17. [Google Scholar]
  16. Ge, H.; Ying, Z.; Chen, Z.; Zu, W.; Liu, C.; Jin, Y. Improved A* Algorithm for Path Planning of Spherical Robot Considering Energy Consumption. Sensors 2023, 23, 7115. [Google Scholar] [CrossRef]
  17. Liu, H.; Cao, J.; Wang, Z. Research on Path Planning of Mobile Robot in Complex Environment. Discov. Appl. Sci. 2025, 7, 330. [Google Scholar] [CrossRef]
  18. Meng, Q.; Qian, C.; Sun, Z.-Y.; Zhao, S. Autonomous Parking Method Based on Improved A* Algorithm and Model Predictive Control. Nonlinear Dyn. 2024, 113, 6839–6862. [Google Scholar] [CrossRef]
  19. Xu, B. Precise Path Planning and Trajectory Tracking Based on Improved A-Star Algorithm. Meas. Control. 2024, 57, 1025–1037. [Google Scholar] [CrossRef]
  20. Priya, V.; Balambica, V.; Achudhan, M. Dynamic Weighted A* Path Planning for Autonomous Vehicles in Evolving Environments. Int. J. Veh. Struct. Syst. 2024, 16, 435–441. [Google Scholar]
  21. Fu, H.; Shao, G.; Zhao, L. Global Path Planning of Unmanned Ship Island Region Based on Improved A* Algorithm. In Proceedings of the 2024 6th International Conference on Artificial Intelligence Technologies and Applications, Changchun, China, 14–16 June 2024; 2858, p. 012021. [Google Scholar] [CrossRef]
  22. Xu, H.; Yu, G.; Wang, Y.; Zhao, X.; Chen, Y.; Liu, J. Path Planning of Mecanum Wheel Chassis Based on Improved A* Algorithm. Electronics 2023, 12, 1754. [Google Scholar] [CrossRef]
  23. Saeed, A.M.; Rijab, K.S. PID Controller Enhanced A* Algorithm for Efficient Water Boat. J. Eur. Des Systèmes Autom. 2023, 56, 1083–1093. [Google Scholar] [CrossRef]
  24. Xu, Y.; Li, Y.; Tai, Y.; Lu, X.; Jia, Y.; Wang, Y. A* Algorithm Based on Adaptive Expansion Convolution for Unmanned Aerial Vehicle Path Planning. Intell. Serv. Robot. 2024, 17, 521–531. [Google Scholar] [CrossRef]
  25. Zhang, B.; Liu, P.; Liu, W.; Bai, X.; Khan, A.; Yuan, J. Search-based Path Planning and Receding Horizon Based Trajectory Generation for Quadrotor Motion Planning. Int. J. Control. Autom. Syst. 2024, 22, 631–647. [Google Scholar] [CrossRef]
  26. Sun, J.; Sun, Z.; Wei, P.; Liu, B.; Wang, Y.; Zhang, T.; Yan, C. Path Planning Algorithm for a Wheel-Legged Robot Based on the Theta* and Timed Elastic Band Algorithms. Symmetry 2023, 15, 1091. [Google Scholar] [CrossRef]
  27. Khan, M.S.; Mandava, R.K. Design of Dynamically Balanced Gait for the Biped Robot While Crossing the Obstacle. Proc. Inst. Mech. Eng. Part C J. Mech. Eng. Sci. 2024, 238, 9125–9140. [Google Scholar]
  28. Yan, J.; Deng, T.; Xu, B. Three Dimensional Path Planning for Flying Car Based on Improved A* Algorithm and Bezier Curve Fusion. Proc. Inst. Mech. Eng. Part D J. Automob. Eng. 2024, 239, 2205–2219. [Google Scholar]
  29. De Luca, A.; Muratore, L.; Raghavan, V.S.; Antonucci, D.; Tsagarakis, N.G. Autonomous Obstacle Crossing Strategies for the Hybrid Wheeled-Legged Robot Centauro. Front. Robot. AI 2021, 8, 721001. [Google Scholar] [CrossRef]
  30. Chen, L.; Ye, S.; Sun, C.; Zhang, A.; Deng, G.; Liao, T.; Sun, J. CNNs Based Foothold Selection for Energy-Efficient Quadruped Locomotion over Rough Terrains. In Proceedings of the 2019 IEEE International Conference on Robotics and Biomimetics (ROBIO), Dali, China, 6–8 December 2019; pp. 1115–1120. [Google Scholar]
  31. Harabor, D.; Grastien, A. Online Graph Pruning for Pathfinding on Grid Maps. In Proceedings of the Twenty-Fifth AAAI Conference on Artificial Intelligence, San Francisco, CA, USA, 7–11 August 2011; pp. 1114–1119. [Google Scholar]
  32. Miao, C.; Chen, G.; Yan, C.; Wu, Y. Path Planning Optimization of Indoor Mobile Robot Based on Adaptive Ant Colony Algorithm. Comput. Ind. Eng. 2021, 156, 107230. [Google Scholar] [CrossRef]
  33. Hart, P.E.; Nilsson, N.J.; Raphael, B. A Formal Basis for the Heuristic Determination of Minimum Cost Paths. IEEE Trans. Syst. Sci. Cybern. 1968, 4, 100–107. [Google Scholar] [CrossRef]
Figure 1. Simple obstacle map. Gray cells represent crossable obstacles, while black cells indicate impassable ones.
Figure 1. Simple obstacle map. Gray cells represent crossable obstacles, while black cells indicate impassable ones.
Sensors 25 05795 g001
Figure 2. Extended obstacle crossing neighborhood. The blue solid arrows represent regular movement directions, while the red dashed arrows indicate jump directions. The central point denotes the current position (Start).
Figure 2. Extended obstacle crossing neighborhood. The blue solid arrows represent regular movement directions, while the red dashed arrows indicate jump directions. The central point denotes the current position (Start).
Sensors 25 05795 g002
Figure 3. Obstacle overcoming movement logic flow diagram. The algorithm iteratively traverses eight possible jumping directions, checks boundary safety and obstacle properties, and computes costs for valid jumpable paths before expanding to the next node.
Figure 3. Obstacle overcoming movement logic flow diagram. The algorithm iteratively traverses eight possible jumping directions, checks boundary safety and obstacle properties, and computes costs for valid jumpable paths before expanding to the next node.
Sensors 25 05795 g003
Figure 4. Flow diagram of the continuous obstacle protection mechanism.
Figure 4. Flow diagram of the continuous obstacle protection mechanism.
Sensors 25 05795 g004
Figure 5. Comparison of the original path and the path after redundant point removal on a 5 × 5 simplified grid map.
Figure 5. Comparison of the original path and the path after redundant point removal on a 5 × 5 simplified grid map.
Sensors 25 05795 g005
Figure 6. Diagram illustrating second-order Bézier curve optimization.
Figure 6. Diagram illustrating second-order Bézier curve optimization.
Sensors 25 05795 g006
Figure 7. Comparison between the traditional A* algorithm and obstacle crossing A* algorithm. (a) The traditional A* algorithm based on obstacle avoidance; (b) obstacle crossing A* algorithm incorporating the unique jumping capability of wheel-legged robots. The green circle is the start point, the magenta square is the goal point, blue dots indicate searched nodes, cyan crosses represent all explored jump points, the solid red line is the optimized path, and the red stars on the path mark actual jump points.
Figure 7. Comparison between the traditional A* algorithm and obstacle crossing A* algorithm. (a) The traditional A* algorithm based on obstacle avoidance; (b) obstacle crossing A* algorithm incorporating the unique jumping capability of wheel-legged robots. The green circle is the start point, the magenta square is the goal point, blue dots indicate searched nodes, cyan crosses represent all explored jump points, the solid red line is the optimized path, and the red stars on the path mark actual jump points.
Sensors 25 05795 g007
Figure 8. Effects of the obstacle crossing A* algorithm in different scenarios. (ac) represent three different obstacle scenarios, respectively. The green circle is the start point, the magenta square is the goal point, blue dots indicate searched nodes, cyan crosses represent all explored jump points, the solid red line is the optimized path, and the red stars on the path mark actual jump points.
Figure 8. Effects of the obstacle crossing A* algorithm in different scenarios. (ac) represent three different obstacle scenarios, respectively. The green circle is the start point, the magenta square is the goal point, blue dots indicate searched nodes, cyan crosses represent all explored jump points, the solid red line is the optimized path, and the red stars on the path mark actual jump points.
Sensors 25 05795 g008
Figure 9. Comparison of the crossing one obstacle and crossing two obstacles scenarios. (a) Crossing a single obstacle cell in a horizontal, vertical, or diagonal direction; (b) crossing two consecutive obstacle cells in a horizontal, vertical, or diagonal direction. The green circle is the start point, the magenta square is the goal point, blue dots indicate searched nodes, cyan crosses represent all explored jump points, the solid red line is the optimized path, and the red stars on the path mark actual jump points.
Figure 9. Comparison of the crossing one obstacle and crossing two obstacles scenarios. (a) Crossing a single obstacle cell in a horizontal, vertical, or diagonal direction; (b) crossing two consecutive obstacle cells in a horizontal, vertical, or diagonal direction. The green circle is the start point, the magenta square is the goal point, blue dots indicate searched nodes, cyan crosses represent all explored jump points, the solid red line is the optimized path, and the red stars on the path mark actual jump points.
Sensors 25 05795 g009
Figure 10. Path comparison under different weight coefficients. (a) With α = 0, the search covered a wide area. (bf) As α increased, the search range was significantly reduced, resulting in a more focused and goal-directed path. The green circle is the start point, the magenta square is the goal point, blue dots indicate searched nodes, cyan crosses represent all explored jump points, the solid red line is the optimized path, and the red stars on the path mark actual jump points.
Figure 10. Path comparison under different weight coefficients. (a) With α = 0, the search covered a wide area. (bf) As α increased, the search range was significantly reduced, resulting in a more focused and goal-directed path. The green circle is the start point, the magenta square is the goal point, blue dots indicate searched nodes, cyan crosses represent all explored jump points, the solid red line is the optimized path, and the red stars on the path mark actual jump points.
Sensors 25 05795 g010
Figure 11. Verification of the continuous obstacle crossing constraint mechanism. (a) Without the constraint mechanism, the path exhibited multiple consecutive obstacle crossing actions, which may lead to instability; (b) with the constraint enabled, consecutive crossings were limited, resulting in more controlled and safer navigation. The green circle is the start point, the magenta square is the goal point, blue dots indicate searched nodes, cyan crosses represent all explored jump points, the solid red line is the optimized path, and the red stars on the path mark actual jump points.
Figure 11. Verification of the continuous obstacle crossing constraint mechanism. (a) Without the constraint mechanism, the path exhibited multiple consecutive obstacle crossing actions, which may lead to instability; (b) with the constraint enabled, consecutive crossings were limited, resulting in more controlled and safer navigation. The green circle is the start point, the magenta square is the goal point, blue dots indicate searched nodes, cyan crosses represent all explored jump points, the solid red line is the optimized path, and the red stars on the path mark actual jump points.
Sensors 25 05795 g011
Figure 12. Algorithm path in a 40 × 40 map. (a) The traditional A* algorithm generated a path that avoided obstacles but tended to be longer and less smooth; (b) the obstacle crossing A* algorithm reduced path length by allowing jumps over gray obstacles; and (c) the optimized A* algorithm improved path continuity and smoothness, enabling more efficient robot traversal. The green circle is the start point, the magenta square is the goal point, blue dots indicate searched nodes, cyan crosses represent all explored jump points, the cyan line shows the optimized final path, and the red stars on the path mark actual jump points.
Figure 12. Algorithm path in a 40 × 40 map. (a) The traditional A* algorithm generated a path that avoided obstacles but tended to be longer and less smooth; (b) the obstacle crossing A* algorithm reduced path length by allowing jumps over gray obstacles; and (c) the optimized A* algorithm improved path continuity and smoothness, enabling more efficient robot traversal. The green circle is the start point, the magenta square is the goal point, blue dots indicate searched nodes, cyan crosses represent all explored jump points, the cyan line shows the optimized final path, and the red stars on the path mark actual jump points.
Sensors 25 05795 g012
Figure 13. Comparison of the traditional A* algorithm and the obstacle crossing A* algorithm in this paper used on different map sizes: (a,b) are for 20 × 20 maps, (c,d) are for 40 × 40 maps, and (e,f) are for 60 × 60 maps. The green circle is the start point, the magenta square is the goal point, blue dots indicate searched nodes, cyan crosses represent all explored jump points, the cyan line shows the optimized final path, and the red stars on the path mark actual jump points.
Figure 13. Comparison of the traditional A* algorithm and the obstacle crossing A* algorithm in this paper used on different map sizes: (a,b) are for 20 × 20 maps, (c,d) are for 40 × 40 maps, and (e,f) are for 60 × 60 maps. The green circle is the start point, the magenta square is the goal point, blue dots indicate searched nodes, cyan crosses represent all explored jump points, the cyan line shows the optimized final path, and the red stars on the path mark actual jump points.
Sensors 25 05795 g013
Table 1. Comparison between the traditional A* algorithm and obstacle crossing A* algorithm.
Table 1. Comparison between the traditional A* algorithm and obstacle crossing A* algorithm.
Path LengthPath NodesSearch ScopeNumber of JumpsTime Consumed (s)
Traditional A* Algorithm63.35554542 0.0146
Obstacle Crossing A* Algorithm61.0124754730.0085
Table 2. Quantification of the performance indicators of the obstacle crossing A* algorithm in different scenarios.
Table 2. Quantification of the performance indicators of the obstacle crossing A* algorithm in different scenarios.
ScenarioPath LengthPath NodesSearch ScopeNumber of Jumps
Scene 160.42445054
Scene 263.35526912
Scene 359.84404868
Table 3. Comparison of the crossing one-grid obstacle and crossing two-grid obstacle scenarios.
Table 3. Comparison of the crossing one-grid obstacle and crossing two-grid obstacle scenarios.
Path LengthPath NodesSearch ScopeTime Consumed
One grid61.59465420.0134
Two grids61.01435200.0194
Table 4. Comparison of the different weight coefficient parameters.
Table 4. Comparison of the different weight coefficient parameters.
Weight CoefficientPath LengthPath NodesSearch ScopeNumber of Jumps
061.01475473
0.2563.35481376
0.563.3548806
0.7564.52481108
165.1150747
1.565.1150657
Table 5. Quantification of the verification indicators of the continuous obstacle crossing constraint mechanism.
Table 5. Quantification of the verification indicators of the continuous obstacle crossing constraint mechanism.
Path LengthPath NodesSearch ScopeNumber of Jumps
Constraints not enabled63.3548806
Constraints enabled62.1848784
Table 6. Comparison of the simulation results obtained from a 40 × 40 map.
Table 6. Comparison of the simulation results obtained from a 40 × 40 map.
Path LengthPath NodeNumber of JumpsSearch Nodes
Traditional A* Algorithm63.35540542
Obstacle Crossing A* Algorithm61.01483547
Optimized Obstacle Crossing A* Algorithm57.9616478
Table 7. Comparison of the quantitative metrics for the two algorithms used on different map sizes.
Table 7. Comparison of the quantitative metrics for the two algorithms used on different map sizes.
MapAlgorithmPath LengthPath NodesNumber of JumpsSearch Nodes
20 × 20A* algorithm32.72300184
A* algorithm in this paper29.048423
40 × 40A* algorithm63.35540542
A* algorithm in this paper57.9616478
60 × 60A* algorithm96.918301670
A* algorithm in this paper89.91215198
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

Lu, J.; Pi, M.; Zeng, G. Obstacle Crossing Path Planning for a Wheel-Legged Robot Using an Improved A* Algorithm. Sensors 2025, 25, 5795. https://doi.org/10.3390/s25185795

AMA Style

Lu J, Pi M, Zeng G. Obstacle Crossing Path Planning for a Wheel-Legged Robot Using an Improved A* Algorithm. Sensors. 2025; 25(18):5795. https://doi.org/10.3390/s25185795

Chicago/Turabian Style

Lu, Jinliang, Ming Pi, and Guoxin Zeng. 2025. "Obstacle Crossing Path Planning for a Wheel-Legged Robot Using an Improved A* Algorithm" Sensors 25, no. 18: 5795. https://doi.org/10.3390/s25185795

APA Style

Lu, J., Pi, M., & Zeng, G. (2025). Obstacle Crossing Path Planning for a Wheel-Legged Robot Using an Improved A* Algorithm. Sensors, 25(18), 5795. https://doi.org/10.3390/s25185795

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