Next Article in Journal
Dual-Mode Data Collection for Periodic and Urgent Data Transmission in Energy Harvesting Wireless Sensor Networks
Previous Article in Journal
Association of Cut-Point Free Metrics and Common Clinical Tests Among Older Adults After Proximal Femoral Fracture
 
 
Font Type:
Arial Georgia Verdana
Font Size:
Aa Aa Aa
Line Spacing:
Column Width:
Background:
Article

Path Planning of Quadrupedal Robot Based on Improved RRT-Connect Algorithm

College of Mechanical Engineering, Donghua University, Shanghai 201620, China
*
Author to whom correspondence should be addressed.
Sensors 2025, 25(8), 2558; https://doi.org/10.3390/s25082558
Submission received: 7 March 2025 / Revised: 11 April 2025 / Accepted: 14 April 2025 / Published: 18 April 2025
(This article belongs to the Section Navigation and Positioning)

Abstract

:
In view of the large randomness, redundant path nodes, and low search efficiency of RRT-connect in a complex obstacle environment, this study intends to develop a path-planning method combining RRT-connect and Informed RRT*. First, to solve the problem of large sampling randomness, the Informed RRT* algorithm is combined to adopt a simpler rectangle and limit the sampling range to the rectangle. Second, for the poor quality of the search path, the dynamic step size is used for growth extension, the reverse greedy algorithm is used to delete redundant nodes, the spline curve is used to smooth the path such that the position meets the cubic spline curve and the speed meets the quadratic spline curve, and the final path is optimized. Finally, the proposed algorithm is verified in the simulation and real world using a self-developed quadrupedal robot. Compared with the original RRT-connect algorithm, the first solution time, total number of nodes, and initial path cost were reduced by more than 11%, 8.5%, and 2.5%, respectively.

1. Introduction

Quadrupedal robots have become the focus of mobile robot research owing to their excellent terrain adaptability and flexible control ability. To better cope with complex terrain, quadrupedal robots need to have the ability of path planning, which is the key to realizing autonomous navigation in complex environments. Common robot path planning methods are divided into three categories. First, search-based path planning, such as Dijkstra [1], A* [2], and the JPS algorithm [3]. Path planning is based on intelligent algorithms including reinforcement learning [4], deep learning [5], genetic algorithms [6], and ant colony algorithms [7]. In addition, sampling-based path planning methods including Probabilistic Roadmaps (PRM) [8] and Rapidly Exploring Random Trees (RRT) have been widely adopted. The sampling-based algorithm can deal with complex path planning problems in multi-dimensional space, and is suitable for quadruped robots and robotic arms, etc., with the advantages of fast convergence, small computation, and easy implementation. It has attracted much attention, and many variants have been derived. However, its disadvantages are also obvious; that is, such algorithms are usually not optimal, and only when the planning time is sufficiently long and the sampling times are sufficient can an effective path be found.
To address these challenges, researchers globally have proposed various enhancements. Building upon the original RRT framework, Kuffner [9] and colleagues developed the RRT-connect variant that accelerates convergence through simultaneous search tree construction from both start and goal configurations. Karaman and Frazzoli’s [10] RRT* algorithm significantly advanced the field by introducing parent node reselection and rewiring mechanisms, thereby achieving asymptotic optimality through iterative path optimization. Building on these developments, Klemm’s [11] RRT*-connect algorithm successfully hybridized the advantages of RRT-connect and RRT*, preserving the asymptotic optimality while enhancing convergence rates. Parallelly, Gammell’s [12] research team advanced the Informed RRT methodology, which implements solution-space biasing after initial path discovery to systematically refine path quality. However, Informed RRT* has problems with other one-way tree planners, especially when the target configuration is hidden behind a narrow channel and takes time to reach the target configuration. Building upon this foundation, Mashayekhi [13] and collaborators developed the Informed RRT-connect algorithm, which employs state-space optimization screening to simultaneously reduce both path costs and computational iterations. Norby and Johnson [14] proposed a motion-planning algorithm for a legged robot that can build a long-vision dynamic programming in real time. The algorithm processes motion primitives with attitude and flight phases through a reduced-order dynamic model, and supports the RRT-connect framework for rapid exploration. Although the algorithm planner is fast, there is still room for improvement. Kang [15] proposed a reconnection method based on triangular inequalities for RRT-connect algorithms. Compared to the RRT algorithm, this method ensures that the planning time is closer to the optimal value. Evaluation results reveal significant improvements over conventional RRT, with measured reductions in both planning duration and trajectory distance. The enhanced efficiency persists even when matching the computational resources of RRT-connect implementations. Zhang [16] et al. proposed an enhanced RRT-connect algorithm to overcome the poor sampling uniformity and low planning efficiency of conventional RRT-connect methods. The proposed approach implements a two-stage optimization process. First, it integrates both goal-biased and explored-node-biased sampling strategies to significantly improve point distribution quality. Then, it introduces an advanced node evaluation scheme that dynamically selects optimal parent nodes within defined search regions, enabling concurrent optimization of sampling nodes and local path segments while effectively minimizing total path planning costs. Zheng [17] et al. proposed an improved method integrating greedy search strategy and cubic Bezier curve optimization to address the shortcomings of conventional RRT-connect algorithms in static environments, including inadequate obstacle avoidance reliability, low planning efficiency, and unsatisfactory path smoothness. The enhanced approach features a two-phase optimization process: first employing greedy search for rapid feasible solution acquisition, followed by cubic Bezier curve-based path smoothing, thereby significantly improving both path quality and planning efficiency while maintaining robust obstacle avoidance capability. Luo et al. [18] proposed an enhanced RRT-connect and DWA fusion algorithm that improves path planning performance through key technical innovations. The method optimizes sampling strategies and collision detection for global planning while employing fuzzy logic to dynamically adjust local navigation parameters. Experimental validation confirms its effectiveness in complex environments, demonstrating both real-time capability and reliable obstacle avoidance. Li [19] et al. proposed an improved RRT-connect algorithm with target-oriented sampling and path post-processing for pruning robot navigation in orchard environments. By incorporating target guidance strategy and trajectory smoothing techniques, the enhanced algorithm demonstrates superior path planning performance compared to conventional methods. Patel [20] et al. proposed an innovative path planning algorithm that integrates probabilistic RRT (pRRT) with RRT-connect techniques. This approach employs a novel multi-tree cooperative growth strategy, where intermediate waypoints are strategically selected around obstacles to construct multiple subtrees connecting the start, goal, and intermediate points, ultimately forming a complete collision-free path.
This study proposes an improved RRT-connect algorithm designed to address three persistent challenges in sampling-based path planning: large sampling randomness, low search efficiency, and poor search-path quality. First, for the problems of large sampling randomness and low search efficiency, the Informed RRT* algorithm is combined with a more concise rectangle to limit the sampling range. Second, to solve the problem of poor quality of the search path, a dynamic step size is used for growth extension, the reverse greedy algorithm is used to delete redundant nodes, and the cubic spline curve is used to smooth the path, so as to optimize the final path. Comprehensive testing on a custom robotic platform establishes measurable advances in operational efficiency relative to existing approaches, with consistent performance gains observed in both digital and physical testbeds.

2. Improved RRT-Connect Algorithm

Compared with the RRT-connect algorithm, although its planning efficiency has improved, there are still some notable issues, such as excessive randomness, insufficient scalability, numerous inflection points in the path, and a large number of redundant nodes. These problems not only affect the overall performance of the algorithm but also limit its widespread use in practical applications. This study presents a comprehensive enhancement framework for the RRT-connect algorithm, delivering four key innovations: (1) integration of Informed-RRT* with rectangular sampling to focus exploration while maintaining goal-directed behavior; (2) implementation of an adaptive step-size mechanism that dynamically responds to environmental complexity, optimizing node generation efficiency; (3) development of a reverse greedy optimization technique for path refinement, eliminating unnecessary waypoints while minimizing trajectory length; and (4) incorporation of cubic spline smoothing to ensure motion continuity and executability. Collectively, these advancements substantially improve planning speed, solution quality, and real-world deployment capabilities of the path planning system.

2.1. Integration of Rectangle-Based Informed-RRT* Algorithm

Compared with the RRT-connect algorithm, which has already demonstrated improved planning efficiency, several significant challenges remain that hinder its performance in practical applications. The algorithm exhibits several limitations: uncontrolled stochasticity in node sampling, constrained environmental adaptability, suboptimal path smoothness with excessive curvature variations, and inefficient node utilization patterns, all of which degrade computational performance and solution quality. To address these limitations and further enhance the performance of the RRT-connect algorithm, this study proposed a comprehensive set of improvements across four key areas. First, the Informed-RRT* algorithm, based on a rectangular sampling region, is introduced to focus on the search space and improve the algorithm’s ability to converge toward the goal. Second, a dynamic step-size mechanism is implemented to adaptively adjust the step length based on environmental complexity, thereby reducing redundant nodes and improving search efficiency. Third, a reverse greedy combination algorithm is developed to optimize the trajectory by minimizing unnecessary inflection points and shortening the overall path length. Finally, cubic spline curve smoothing techniques were applied to refine the path, ensuring smoother and more continuous trajectories that are better suited for real-world applications. These methodological refinements collectively enhance the RRT-connect framework’s core capabilities, optimizing planning speed, trajectory quality, and environmental versatility across heterogeneous operating conditions.
The Informed-RRT* methodology utilizes elliptical sampling domains rather than global uniform sampling, effectively eliminating the problem of superfluous branch generation characteristic of conventional RRT* implementations while enhancing both exploration efficiency and convergence rates. However, elliptical calculations are relatively complex. The proposed method implements a rectangular sampling strategy, where the boundary coordinates P1, P2, P3, and P4 are derived geometrically from the initial point Pinit and target point Pgoal configurations as illustrated, and the coordinates of points P1, P2, P3, and P4 are denoted as P1(x1,y1), P2(x2,y2), P3(x3,y3), and P4(x4,y4) and the rectangular region is determined based on these four points. The sampling was performed within this rectangle.
Let the coordinates of the starting point Pinit be (xinit,yinit) and the coordinates of the target point Pgoal be (xgoal,ygoal). The length of the rectangle is
l o n g 1 = ( x g o a l x i n i t   ) 2 + ( y g o a l y i n i t   ) 2 ,
The rectangular domain’s width is computed as a fixed proportion of its longitudinal dimension, specifically
w i d e 1 = 0.5 l o n g 1 ,
The coordinates of the center point of the rectangle are ( x g o a l x i n i t 2 , y g o a l y i n i t 2 ) .
The corner α can be obtained using the following formula:
α = tan 1 ( y g o a l y i n i t x g o a l x i n i t ) ,
The coordinates of P 1 ( x 1 , y 1 ), P 2 ( x 2 , y 2 ), P 3 ( x 3 , y 3 ), and P 4 ( x 4 , y 4 ) are
P 1 ( x g o a l w i d e 2 sin α , y g o a l + w i d e 2 cos α   ) ,
P 2 ( x g o a l + w i d e 2 sin α , y g o a l w i d e 2 cos α   ) ,
P 3 ( x i n i t w i d e 2 sin α , y i n i t + w i d e 2 cos α   ) ,
P 4 ( x i n i t + w i d e 2 sin α , y i n i t w i d e 2 cos α   ) ,
The rectangular region S2 is determined by the four points P1, P2, P3, and P4:
x m a x = m a x ( x 1 , x 2 , x 3 , x 4 ) x m i n = m i n ( x 1 , x 2 , x 3 , x 4 ) y m a x = m a x ( y 1 , y 2 , y 3 , y 4 ) y m i n = m i n ( y 1 , y 2 , y 3 , y 4 ) ,
The region S2 is restricted in Formula (9):
x < x m a x x > x m i n y < y m a x y > y m i n ,
The sampling area S2 is shown in Figure 1.

2.2. Dynamic Step Size Exploration

The bidirectional growth mechanism in RRT-connect inherently produces substantial node redundancy, creating unnecessary computational burden and compromising algorithmic efficiency. Furthermore, the method demonstrates limited global search capability, often terminating in locally optimal solutions when confronted with dense obstacle configurations. To address these issues, this study proposes replacing the traditional fixed step size with a dynamic step size mechanism for tree growth and extension. The adaptive step-size mechanism dynamically responds to both environmental complexity and inter-tree distance, optimizing exploration efficiency while minimizing redundant node generation. This spatial awareness concurrently prevents local optima entrapment through systematic search space coverage. The dynamic step growth process is illustrated in Figure 2, which demonstrates how the step size varies during the tree expansion process, enabling smoother and more efficient convergence of the two trees. The dynamic step-size strategy significantly enhances RRT-connect’s operational robustness and path-planning efficacy through adaptive exploration control.
As illustrated in the figure, when Tree1 generates a new node, denoted as node x n e w , Tree2 identifies the parent node that is closest to node x n e w based on the Euclidean distance metric. Tree2’s nearest ancestral node, designated x p r i m _ n e w , is determined through Euclidean distance minimization. Subsequently, the connection direction between the parent node x p r i m _ n e w and the randomly generated point determines the direction in which Tree2 expands. The expansion of Tree2 is then executed with a dynamic step size, referred to as step size L . This dynamic step size is crucial for controlling the growth of Tree2 and is calculated using a specific formula that considers various factors to ensure optimal expansion. The dynamic step size L is computed through real-time assessment of both tree topology and environmental constraints, enabling optimal balance between exploration efficiency and target-directed expansion. This self-adjusting mechanism continuously optimizes tree growth patterns, significantly improving convergence behavior and computational performance.
L = N L
Here, L is the set step-size and N is the dynamic coefficient, which is determined by whether the space constraint is satisfied. L is a critical parameter governing the expansion efficiency of the RRT-connect trees. L represents the maximum local search radius during tree expansion, directly tied to the robot’s kinematic constraints:
L = v m a x t + ϵ
where v m a x is the velocity upper bound, experimentally configured as 1.5 m/s based on our robotic platform’s dynamic performance thresholds; the control cycle time t is set to 0.03 s; and ϵ is the safety margin that is set to 0.05 m to avoid collisions.
N is given by
N = 1   i f   not   C O N ( x p r i m _ n e w , x p r i m _ n e a r e s t ) N + 1   other ,

2.3. Reverse Greed Algorithm

The inverse greedy algorithm is employed to optimize the fragmented path, which often contains unnecessary nodes that can be eliminated to create a more efficient and streamlined trajectory. The path optimization results following node elimination are illustrated in Figure 3, demonstrating the following computational procedure. Commencing from the target configuration x g o a l , the algorithm iteratively establishes connections with preceding trajectory node x n . It then checks whether there is an obstacle between x g o a l and the current node x n . If no obstacle is detected, then all intermediate nodes between these two points are deleted, thereby simplifying the path. However, if an obstacle is found between node x g o a l and node x n , the algorithm repeats the same steps from node x n + 1 , continuing to evaluate and remove unnecessary nodes until it has traversed the entire path and reached the starting point x s t a r t . This iterative process ensures that the final path is both obstacle-free and optimized for efficiency, thereby reducing the number of nodes while maintaining the feasibility and smoothness of the trajectory. The proposed optimization method enhances path quality substantially, particularly for real-world deployment scenarios demanding computationally efficient and geometrically simplified trajectories.

2.4. Trajectory Optimization and Smoothing Processing

The path generated by the aforementioned method consists solely of sampled nodes that must satisfy both static and dynamic constraints to ensure feasibility and practicality in real-world applications. The robot’s operational constraints encompass both static and dynamic requirements. Static constraints derive from the platform’s physical morphology, including center-of-mass elevation and limb dimensions, ensuring stable locomotion and obstacle avoidance through mathematically enforced boundaries. Dynamic constraints govern motion characteristics such as velocity profiles, acceleration thresholds, and torque outputs, guaranteeing kinematically viable and energy-efficient operation. In particular, the static constraints are explicitly formulated in Equation (13), which provides a detailed mathematical representation of how the height of the center of mass and the leg height influence the robot’s movement. The integration of these kinematic and dynamic constraints into the path-planning framework guarantees the generation of both obstacle-avoidant and dynamically executable trajectories. This constraint-aware planning approach facilitates reliable navigation through complex terrains while preserving locomotor stability and operational efficiency.
h c e n t e r h m i n t   0 , t 1 + t 2 h l e g h m a x t   0 , t 1 ,
Here, h c e n t e r is the height of the center of mass, h l e g is the height of the leg, h m i n and h m a x are the clearance threshold, t 1 is the support phase time, and t 2 is the flight phase time.
The system’s dynamic operational requirements further incorporate three critical mechanical constraints: ground reaction forces, actuator torque limits, and frictional boundary conditions. These are mathematically defined as
| f G R F | f m a x f 3 0 | τ | τ m a x μ f 3 f 1 2 + f 2 2 ,
where f G R F is the ground reaction force, f m a x is the fixed maximum ground reaction force, τ is the torque, τ m a x is the maximum torque threshold, f 3 is the normal component of the ground reaction force, f 1 and f 2 are the tangential components of the ground reaction force, and μ is the friction coefficient. Within the limits of these constraints, the ground reaction force vector and torque at touchdown and takeoff are randomly sampled and rotated into the world coordinate system.
Node interconnection is strictly governed by a comprehensive set of kinematic and dynamic constraints, including but not limited to collision avoidance, torque limitations, and energy consumption thresholds. The resulting trajectory, as visualized in Figure 4, demonstrates the characteristic bidirectional exploration pattern: the red trajectory segments (left) represent nodes from the initial search tree rooted at the starting configuration, while the blue segments (right) denote nodes from the goal-oriented search tree. The algorithmic process implements a synchronized bidirectional expansion mechanism, where both subtrees progressively extend toward each other through iterative sampling and validation cycles. This systematic exploration continues until meeting the convergence criterion, typically defined by configurational proximity threshold or maximum iteration count, at which stage the algorithm successfully constructs a continuous, constraint-satisfying path through concatenation of the respective tree segments.
Trajectory smoothing is achieved through application of cubic spline interpolation, ensuring continuous curvature profiles along the optimized path. To ensure that the smoothed trajectory satisfies the spatial state, it is necessary to generate adjacent nodes around path points. We take nodes x n 1 and x n + 1 before and after path point x n as directions and step as steps to generate a new adjacent node.
Relying solely on the scattered nodes generated by the aforementioned method is clearly insufficient, because it does not provide the level of detail required for precise and smooth motion planning. To address this, further refinement of the path is necessary, which involves performing denser node interpolation between the existing nodes. This interpolation process ensures that the path is continuous and finely detailed, thereby enabling the robot to follow it accurately. Additionally, the minimum interval time for planning is set to 0.03 s, ensuring that the trajectory is both temporally and spatially optimized for real-time execution.
The interpolation procedure is rigorously constrained by kinematic and dynamic requirements, guaranteeing both trajectory feasibility and continuity. For instance, the velocity profile is determined using quadratic spline curve interpolation, which ensures smooth transitions between nodes and avoids abrupt changes in the speed. The position trajectory is calculated using cubic spline curve interpolation, which provides a higher degree of continuity and smoothness, making it suitable for complex motion planning. The use of a cubic spline curve for the position trajectory allows it to be mathematically expressed as Equation (15). By incorporating these interpolation techniques and adhering to the specified constraints, the proposed method ensures that the generated path is not only precise but also dynamically feasible, enabling the robot to execute smooth and efficient movements in real-world scenarios.
q ( t ) = a 0 + a 1 t + a 2 t 2 + a 3 t 3
Here,   q ( t ) is a function of the position trajectory and a 0 , a 1 , a 2 , and a 3 are unknown parameter sets.
Find the first and second derivative, respectively:
q ( t ) = a 1 + 2 a 2 t + 3 a 3 t 2 ,
q ( t ) = 2 a 2 + 6 a 3 t ,
where q ( t ) is the velocity function and q ( t ) is the acceleration function.
According to the initial conditions, Equation (18) can be obtained using the above equation. The calculation formula for the support phase is given by Equation (18):
q ¨ ( t ) = ( q ¨ T F q ¨ T G ) t t 1 + q ¨ T G q ˙ ( t ) = ( q ¨ T F q ¨ T G ) t 2 2 t 1 + q ¨ T G t + q ˙ T G q ( t ) = ( q ¨ T F q ¨ T G ) t 3 6 t 1 + q ¨ T G t 2 2 + q ˙ T G + q T G ,
where T G is the moment of touching the ground, that is, the beginning of the standing stage, and T F is the moment of jumping, that is, the end of the standing stage.
During the flight phase, the system’s motion is governed solely by gravitational acceleration, which produces the parabolic trajectory described in Equation (19):
q ¨ ( t ) = g q ˙ ( t ) = g ( t t 1 ) + q ˙ T O q ( t ) = g ( t t 1 ) 2 2 + q ˙ T O ( t t 1 ) + q T O ,
Figure 5 shows the schematic diagram of nodal interpolation during the path planning process.
The relationship between velocity, acceleration, displacement, and time of Equations (18) and (19) is drawn, as shown in Figure 6.
The displacement of these nodes enables velocity-based motion control of the robot, while acceleration governs the transition between support and flight phases. In addition, the attitude and angular velocity of the robot must be calculated, which are the input variables when NMPC is used for trajectory tracking. The proposed trajectory planning framework, incorporating both sampling-based and spline-based optimization, enforces dynamic and kinematic constraints to ensure physically feasible motion for quadrupedal robots. The implementation process of the improved RRT-connect algorithm is presented in Algorithm 1.
Algorithm 1: Improved RRT-Connect Algorithm
Inputs: Start point x s t a r t , Goal point x g o a l , Step size L, Max iterations n
Outputs: Path P connecting x s t a r t and x g o a l
Initialize:
 Trees G a = ( V a , E a ) with   G b = ( V b ,   E b ) with V a x s t a r t ,   V b x g o a l
 Rectangle sampling region S2 via Equations (1)–(9)
for i = 1 to n do:
Sample:
   x r a n d S a m p l e R e c t a n g l e ( S 2 )      // constrined by Equations (4)–(9)
  if x r a n d violates static/dynamic constrints (Equations (13) and (14)) then
  continue
Extend Trees:
   x n e w     E x t e n d D y n a m i c S t e p G a ,   x r a n d , L     / / L from Equations (10)–(12)
  if Extend (Ga, xrand) ≠ Trapped then:
   Connect(Gb, xnew)
   if PathFound(xnew) then:
     P ReverseGreedyOptimize   ( G a ,   G b ) //Node pruning via Figure 3
     P SplingSmoothing   ( P ) //Cubic spling (Equation (15))
    return P
Swap Trees:
  Swap ( G a ,   G b )
return Failue

3. Simulation Experiment Verification

The proposed algorithm is implemented within a simplified dynamic framework [14], where the system state is characterized by the robot’s body position, orientation, and linear velocity. This implementation employs double-integrator dynamics to generate feasible navigation trajectories. As long as the resulting trajectory can be tracked with whole-body motion, this simplification enables efficient global path planning while allowing local step planning to solve more complex tasks. The proposed planner was evaluated in multiple simulated environments designed to assess performance across diverse motion planning scenarios. Although their complexity does not cover all possible environments, they qualitatively demonstrate performance in key areas. For each environment, we specify a starting point and target pose, provide the planner with an elevation chart, execute an arbitrary time planner with shortcuts 100 times, and collect the statistics. The planner finds a viable path and then executes the shortcut algorithm without reprioritizing its speed. All tests were run in C++ on a 3.7 GHz Intel Core i12-8700K CPU.
The “slope” terrain, shown in Figure 7, tests the ability to handle steep slopes, testing planners’ ability to combine friction cones and directional use to find more viable areas of state space. The “rough terrain” environment shown in Figure 8 tests the planner’s ability to overcome unstructured terrain, including uneven ground, obstacles, and ledges that require flight phases. In Figure 7 and Figure 8, the red line represents the attitude phase, and the two ends of the red line represent the starting and target points, respectively.
Performance comparisons of path planning algorithms are presented in Figure 7 and Figure 8 through elevation map visualizations. Both figures maintain identical start and end points while contrasting pre-optimization (left) and post-optimization (right) results. The red trajectory demonstrates that the enhanced algorithm generates more efficient paths, exhibiting both reduced length and improved smoothness compared to the baseline approach.
Figure 9 offers an extensive and detailed visual depiction of the navigational routes that were adeptly discerned and navigated by the quadrupedal robot subsequent to the application of the refined algorithm for route planning and spatial scrutiny. These trajectories, intricately charted across a multitude of simulated elevation models, as illustrated by the various cartographic representations, are emblematic of the robot’s centroidal movement path, thereby demonstrating the enhanced algorithm’s exceptional precision and robust adaptability in orchestrating the robot’s traversal through intricate and challenging terrains. The illustration not only underscores the algorithm’s proficiency in handling diverse topographical features, but also highlights its capability to ensure consistent and reliable pathfinding performance in environments that are rich in complexity and variability.
Figure 10 presents a detailed visualization of the robot’s performance during both support and flight phases. In this figure, the centroid trajectory is depicted by thick lines, while thin lines represent the planned trajectories of all four legs. Within the thick lines, the red trajectory illustrates the centroid motion during the support phase, demonstrating the robot’s stable ground contact; the blue trajectory delineates the parabolic path during the flight phase, capturing the aerial motion characteristics; the light green line displays the predicted trajectory for the next time step, effectively showcasing the algorithm’s predictive planning capability; and the dark green line indicates the centroid movement during both the jump preparation descent phase and landing shock absorption phase. This comprehensive visualization not only documents the complete dynamic motion process of the robot but also highlights the sophisticated complexity of the motion planning algorithm.
The data presented in Table 1 reflect the aggregated averages obtained from executing the global planning algorithm 200 times under consistent conditions, specifically on an identical map with unchanged starting and ending points. A detailed analysis reveals that all measured parameters have undergone varying degrees of optimization. Notable performance gains were observed in the algorithm’s planning efficiency, with substantial reductions in both computation time to first solution and total nodes generated during the search process.
The real-time performance of the proposed hybrid RRT-connect/Informed-RRT* planning framework has been rigorously validated through systematic benchmarking on the Quad-SDK platform, demonstrating its capability to meet stringent timing requirements for dynamic quadrupedal robot navigation. The architecture implements a dual-layer real-time guarantee mechanism consisting of an optimized nonlinear model predictive control (NMPC) layer and a hierarchical planning system. The NMPC solver achieves consistent single-iteration computation times below 5 ms while operating within ROS2’s real-time middleware, enforcing reliable 30 ms control cycles with 93.7% deadline compliance under stress-test conditions.
At the planning level, the framework employs a hierarchical structure that decomposes the problem into global path generation and local adjustments. The global planner operates at 50 ms intervals to compute long-horizon trajectories, while a high-frequency local replanner executes every 10 ms to handle dynamic obstacles and environmental uncertainties. This structure is complemented by a priority-based thread scheduling mechanism that ensures computational resources are allocated efficiently, particularly in multi-robot scenarios. Benchmark results confirm robust real-time performance, with an average planning latency of 42.3 ± 6.7 ms across 200 trials and a worst-case execution time of 68 ms at the 99th percentile. The system maintains a continuous 15 Hz planning frequency, enabling smooth navigation in dynamic environments.

4. Experiment Verification

To rigorously evaluate the path-planning algorithm’s performance in practical applications, we conducted extensive experimental validation using a custom-developed quadrupedal robotic platform integrated with the Robot Operating System (ROS). The biomimetic robot, designed with canine-inspired locomotion dynamics, features a 14.5 kg lightweight yet robust structure with four fully articulated limbs, each equipped with three high-precision servo joints (hip abduction/adduction, hip flexion/extension, and knee flexion/extension) for exceptional mobility and posture control. Powered by a hybrid actuation system combining Unitree A1 and Go motors, the platform achieves a maximum walking speed of 1.5 m/s while maintaining stable omnidirectional movement through its advanced three-axis position and orientation control system. The A1 and Go motors are products of Unitree Robotics, headquartered in Hangzhou, China. The robot’s comprehensive sensor suite, including an Xsens MTi-600 IMU and Intel RealSense depth camera d435, enables precise environmental perception and navigation in complex terrains. Xsens MTi-600 IMU is a high-performance inertial measurement unit developed and manufactured by Xsens Technologies B.V., headquartered in Enschede, The Netherlands. Intel RealSense Depth Camera d435 is a 3D vision product developed and manufactured by Intel Corporation, headquartered in Santa Clara, California, USA. This sophisticated experimental setup allowed thorough assessment of the algorithm’s real-world performance in terms of path accuracy, obstacle avoidance capability, and computational efficiency across various challenging scenarios.
The actuation system of the robot is a hybrid design that integrates Unitree A1 and Go motors, which are carefully selected to achieve an optimal balance between high performance and cost-effectiveness. In particular, Go motors are strategically deployed at the hip and thigh joints, where moderate torque is sufficient, whereas the more robust A1 motors, renowned for their superior torque-delivery capabilities, are installed at the calf joints to handle the higher demands of dynamic movements. This thoughtful arrangement not only ensures that the robot can produce significant torque for various tasks but also keeps the overall system cost relatively low. The control system’s core computational unit is the amd5825u control board, which synchronizes motor actuation and sensor data processing. The amd5825u control board is a computing hardware product developed by Advanced Micro Devices, Inc. (AMD), headquartered in Santa Clara, California, USA. Additionally, a PC connected to the same local area network as the control board enables wireless operation and real-time monitoring of the robot, offering a user-friendly and efficient interface for both testing and development. This integrated approach ensures that the robot operates smoothly and can be easily controlled and adjusted during experimental trials.
Figure 11 presents the architectural configuration of the custom-developed quadrupedal robotic platform, identifying critical subsystems responsible for enhanced operational capabilities. The main control board, which serves as the central hub for all computational tasks, is equipped with an amd5825u chip, which is a powerful processor designed to handle complex algorithms and real-time data processing with high efficiency. This chip ensures that the robot can seamlessly execute its path planning and motion control tasks, even in dynamic and challenging environments. The robotic system utilized the Xsens MTi-600 inertial measurement unit for high-precision motion tracking, a commercial-grade IMU solution developed by Xsens Technologies. This module is widely recognized for its exceptional precision and reliability in motion tracking, providing accurate data on the orientation, acceleration, and angular velocity of the robot, which are critical for maintaining stability and balance during locomotion. The control system interfaces with the actuators through 6 High-Speed RS485 Communication Modules, implementing an industry-standard protocol for robust data transmission in electromechanical systems. The high-speed RS485 communication module is developed and manufactured by Unitree Robotics in Hangzhou, China. This protocol ensures reliable and efficient data transmission, even in environments with potential electromagnetic interference, thereby enhancing the overall responsiveness and coordination of robot movements. The engineered robotic platform is presented in Figure 12, demonstrating a structurally optimized configuration that achieves both compact form factor and dynamic mobility through systematic design refinement. The lightweight yet durable construction of the robot, combined with its advanced actuation system, allows it to navigate a variety of terrains with ease, making it well-suited for a wide range of real-world applications, from search and rescue missions to industrial inspections. The integrated robotic system successfully validates the proposed algorithm’s efficacy in improving path-planning performance through synergistic hardware–software co-design. By leveraging the strengths of each component and ensuring seamless communication between them, the robot achieves a level of autonomy and adaptability essential for operating in complex and unpredictable environments. The system implementation substantiates the methodological advancement in quadrupedal robotics, enabling enhanced functional capabilities for next-generation robotic platforms.
Table 2 displays the experimental outcomes obtained from the physical robot performing 50 consecutive runs under consistent conditions, specifically on the same map with identical starting and ending points. The data revealed that all measured parameters demonstrated improvements of varying magnitudes, closely aligning with the trends observed in the simulation phase. The path planning algorithm demonstrates significant optimization in computational efficiency, particularly in reducing both the search space node count and time-to-first-feasible-solution. These results underscore the robustness and practical applicability of the proposed algorithm, as it not only replicates the simulation-based improvements but also validates their effectiveness in real-world operational environments. This consistency between the simulation and physical experimentation further reinforces the reliability and scalability of the algorithm for diverse robotic applications.

5. Conclusions

To address the limitations of conventional RRT-connect algorithms—including excessive sampling randomness, suboptimal search efficiency, and compromised path quality—this study develops a hybrid path planning methodology integrating RRT-connect with Informed-RRT* frameworks. Theoretical analysis and simulation experiments yield three principal findings:
  • This study develops an enhanced path planning algorithm that combines RRT-connect exploration with Informed-RRT* optimization for mobile robot navigation. Based on the RRT-connect algorithm, the informed RRT* algorithm was used for reference, and a simpler rectangle was adopted, which was calculated from the starting point and the ending point. The sampling space is constrained to a rectangular region, reducing both the search domain and required sample count while improving sampling efficiency.
  • The dynamic step size is used instead of the fixed step size and the reverse greedy algorithm to reduce the number of redundant nodes.
  • Path smoothing is achieved through parametric spline curves, where third-order polynomials define positional continuity and second-order polynomials govern velocity profiles.
Simulation experiments demonstrate the algorithm’s significant reduction in stochastic sampling variability, achieving more deterministic node generation patterns. Compared with the original RRT-connect algorithm, the first solution time, total number of nodes, and initial path cost were reduced by more than 11%, 8.5%, and 2.5%, respectively.

6. Limitations

Although our algorithm has achieved improvements in certain aspects, the following limitations still exist:
  • Complexity in High-Dimensional Spaces: The algorithm’s rectangular sampling strategy, while simpler than elliptical sampling, may still struggle in high-dimensional environments (e.g., 3D dynamic spaces), leading to increased computational overhead.
  • Real-Time Constraints: Although the algorithm improves planning speed, its real-time performance in highly cluttered or rapidly changing environments requires further optimization.
  • Insufficient Benchmarking Depth: While 3D simulations and physical experiments validate the algorithm’s performance, systematic comparisons with classical 3D planners (e.g., 3D A, RRT) or emerging techniques (e.g., deep reinforcement learning-based planners) are lacking. Future work should include comprehensive benchmarks to establish broader superiority.
  • Hardware Resource Dependency: Dynamic step adjustment and reverse greedy pruning in 3D environments require substantial computational resources, potentially causing performance bottlenecks on embedded or low-power platforms (e.g., drones, small robots).
Here are the potential directions for future improvements:
  • Intelligent Sampling: Develop deep reinforcement learning-based dynamic sampling strategies to adaptively adjust rectangular regions in 3D dynamic spaces, minimizing redundant node generation and computational overhead.
  • Real-Time Performance Enhancement and Dynamic Scenario Adaptation: Although we have integrated the NMPC algorithm for local trajectory replanning, the real-time performance still requires further enhancement. Future work will focus on optimization through parallel computing or hardware acceleration (e.g., GPU).
  • Systematic Algorithm Benchmarking and Standardized Evaluation: Establish a benchmarking platform covering classical 3D planners (e.g., 3D RRT, BIT) and emerging methods (e.g., neural motion planning), evaluating performance through metrics such as path quality (smoothness, length), computational efficiency (time, memory), and energy consumption. Open-source algorithm code and experimental datasets to promote reproducibility and community-wide comparisons.
  • Lightweight Design and Cross-Platform Adaptation: For embedded devices (e.g., drones, micro-robots), design hierarchical planning strategies—decoupling global path generation from local trajectory optimization—and reduce computational load via model pruning and quantization. Investigate edge-cloud collaborative frameworks to offload high-computation tasks (e.g., 3D environment modeling) to the cloud, improving real-time responsiveness on low-power platforms.

Author Contributions

Conceptualization, methodology, formal analysis, investigation, debugging, and writing—original draft, X.X.; writing—review and editing, P.L.; data analysis, manuscript review, J.Z.; debugging, manuscript review, W.D. All authors have read and agreed to the published version of the manuscript.

Funding

This research received no external funding.

Institutional Review Board Statement

Not applicable.

Informed Consent Statement

Not applicable.

Data Availability Statement

Data are contained within the article.

Conflicts of Interest

The authors declare no conflicts of interest.

References

  1. Durakli, Z.; Nabiyev, V. A new approach based on bezier curves to solve path planning problems for mobile robots. J. Comput. Sci. 2022, 58, 101540. [Google Scholar] [CrossRef]
  2. Wang, P.; Zhou, X.; Zhao, Q. Search-based Kinodynamic Motion Planning for Omnidirectional Quadruped Robots. In Proceedings of the IEEE/ASME Interational Conference on Advanced Intelligent Mechatronics (AIM), Delft, The Netherlands, 12–16 July 2021; pp. 823–829. [Google Scholar]
  3. Hu, Y.; Zhou, W.; Liu, Y. Efficient Online Planning and Robust Optimal Control: Applications of Nonholonomic Mobile Robots in Unstructured Environments. IEEE Trans. Emerg. Top. Comput. Intell. 2024, 8, 3559–3575. [Google Scholar] [CrossRef]
  4. Zhang, S.; Li, Y.; Dong, Q. Autonomous navigation of UAV in multi-obstacle environments based on a Deep Reinforcement Learning approach. Appl. Soft Comput. J. 2022, 115, 81–94. [Google Scholar] [CrossRef]
  5. Yu, X.; Wang, P.; Zhang, Z. Learning-based end-to-end path planning for lunar rovers with safety constraints. Sensors 2021, 21, 796. [Google Scholar] [CrossRef] [PubMed]
  6. Anthony, R.; Reddy, M.; Lakshmanna, K. Hybrid genetic algorithm and a fuzzy logic classifier for heart disease diagnosis. Evol. Intell. 2020, 13, 185–196. [Google Scholar]
  7. Ajeil, F.H.; Ibraheem, I.K.; Azar, A.T. Grid based mobile robot path planning using aging-based ant colony optimization algorithm in static and dynamic environments. Sensors 2020, 20, 1880. [Google Scholar] [CrossRef] [PubMed]
  8. Henriques, J.P.C.; Lugli, A.B.; Goncalves, L.C. Analysis of the Trajectory Planning of a SCARA Robot Using the PRM Algorithm. In Proceedings of the 2022 10th International Conference on Control, Mechatronics and Automation (ICCMA), Belval, Luxembourg, 9–12 November 2022; pp. 66–70. [Google Scholar]
  9. Kuffner, J.J.; Lavalle, S.M. RRT-connect: An efficientap proach to single-query path planning. In Proceedings of the IEEE International Conference on Robotics and Automation, San Francisco, CA, USA, 24–28 April 2000; pp. 995–1001. [Google Scholar]
  10. Karaman, S.; Frazzoli, E. Sampling-based algorithms for optimal motion planning. Int. J. Robot. Res. 2011, 30, 846–894. [Google Scholar] [CrossRef]
  11. Klemm, S.; Oberlander, J.; Hermann, A. RRT*-connect: Faster, asymptotically optimal motion planning. In Proceedings of the IEEE International Conference on Robotics and Biomimetics, Zhuhai, China, 6–9 December 2015; pp. 1670–1677. [Google Scholar]
  12. Gammell, J.D.; Srinivasa, S.S.; Barfoot, T.D. Informed RRT*: Optimal sampling-based path planning focused via direct sampling of an admissible ellipsoidal heuristic. In Proceedings of the IEEE/RSJ International Conference on Intelligent Robots and Systems, Chicago, IL, USA, 14–18 September 2014; pp. 2997–3004. [Google Scholar]
  13. Mashayekhi, R.; Idris, M.Y.I.; Anisi, M.H. Informed RRT*-connect: An asymptotically optimal single-query path planning method. IEEE Access 2020, 8, 19842–19852. [Google Scholar] [CrossRef]
  14. Norby, J.; Johnson, A.M. Fast global motion planning for dynamic legged robots. In Proceedings of the IEEE/RSJ International Conference on Intelligent Robots and Systems (IROS), Las Vegas, NV, USA, 24 October–24 January 2020; pp. 3829–3836. [Google Scholar]
  15. Kang, J.G.; Lim, D.W.; Choi, Y.S. Improved RRT-Connect Algorithm Based on Triangular Inequality for Robot Path Planning. Sensors 2021, 21, 333. [Google Scholar] [CrossRef] [PubMed]
  16. Zhang, L.P.; Shi, X.X.; Yi, Y.M. Mobile robot path planning algorithm based on RRT-Connect. Electronics 2023, 12, 2456. [Google Scholar] [CrossRef]
  17. Zheng, Z.A.; Xie, S.J.; Ye, Z.M. Research on path smoothing optimisation based on improved RRT-Connect algorithm and third-order Bezier curve. Proc. Inst. Mech. Eng. Part C J. Mech. Eng. Sci. 2025, 239, 2544–2561. [Google Scholar] [CrossRef]
  18. Luo, Z.; Han, Y.; Zhang, X. Research on path planning of inspection robot with improved RRT-Connect and DWA algorithm. Comput. Eng. Appl. 2024, 60, 344–354. [Google Scholar]
  19. LI, Y.C.; Ma, S.C. Navigation of apple tree pruning robot based on improved RRT-Connect algorithm. Agriculture 2023, 13, 1495. [Google Scholar] [CrossRef]
  20. Patel, D.; Eskandarian, A. Probabilistic RRT Connect with intermediate goal selection for online planning of autonomous vehicles. IFAC-PapersOnLine 2023, 56, 373–378. [Google Scholar] [CrossRef]
Figure 1. Sampling area.
Figure 1. Sampling area.
Sensors 25 02558 g001
Figure 2. Dynamic step growth diagram.
Figure 2. Dynamic step growth diagram.
Sensors 25 02558 g002
Figure 3. Reverse greed algorithm.
Figure 3. Reverse greed algorithm.
Sensors 25 02558 g003
Figure 4. Schematic diagram of optimized RRT-connect algorithm.
Figure 4. Schematic diagram of optimized RRT-connect algorithm.
Sensors 25 02558 g004
Figure 5. Node interpolation diagram.
Figure 5. Node interpolation diagram.
Sensors 25 02558 g005
Figure 6. Robot velocity, acceleration, displacement, and time relationship diagram.
Figure 6. Robot velocity, acceleration, displacement, and time relationship diagram.
Sensors 25 02558 g006
Figure 7. Performance comparison of baseline and enhanced algorithms in Map 1. (a) The effect before improvement. (b) The effect after improvement.
Figure 7. Performance comparison of baseline and enhanced algorithms in Map 1. (a) The effect before improvement. (b) The effect after improvement.
Sensors 25 02558 g007
Figure 8. Performance comparison of baseline and enhanced algorithms in Map 2. (a) The effect before improvement. (b) The effect after improvement.
Figure 8. Performance comparison of baseline and enhanced algorithms in Map 2. (a) The effect before improvement. (b) The effect after improvement.
Sensors 25 02558 g008
Figure 9. Path planning of the robot across different terrains. (a) Case 1; (b) Case 2; (c) Case 3; (d) Case 4.
Figure 9. Path planning of the robot across different terrains. (a) Case 1; (b) Case 2; (c) Case 3; (d) Case 4.
Sensors 25 02558 g009
Figure 10. Effect diagrams under different phases: (a) support phase effect diagram; (b) flight phase effect diagram.
Figure 10. Effect diagrams under different phases: (a) support phase effect diagram; (b) flight phase effect diagram.
Sensors 25 02558 g010
Figure 11. Quadrupedal robot hardware platform.
Figure 11. Quadrupedal robot hardware platform.
Sensors 25 02558 g011
Figure 12. Physical robot.
Figure 12. Physical robot.
Sensors 25 02558 g012
Table 1. Comparison of Global Planning Algorithms (simulation).
Table 1. Comparison of Global Planning Algorithms (simulation).
Global Path
Planning
Algorithm
Path TimeNode
Number
Solving TimeFirst
Resolution Time
Path Length
Pre-optimization
algorithm
3.7317311.1230.1455.644
Post-optimization
algorithm
3.6596441.1000.1325.492
Percentage
optimization
1.93%11.90%2.05%8.96%2.69%
Table 2. Comparison of Global Planning Algorithms (experiment).
Table 2. Comparison of Global Planning Algorithms (experiment).
Global Path
Planning
Algorithm
Path TimeNode
Number
Solving TimeFirst
Resolution Time
Path Length
Pre-optimization algorithm4.2327981.3580.1846.238
Post-optimization algorithm4.1537061.3290.1676.079
Percentage
optimization
1.86%11.53%2.14%9.24%2.55%
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

Xu, X.; Li, P.; Zhou, J.; Deng, W. Path Planning of Quadrupedal Robot Based on Improved RRT-Connect Algorithm. Sensors 2025, 25, 2558. https://doi.org/10.3390/s25082558

AMA Style

Xu X, Li P, Zhou J, Deng W. Path Planning of Quadrupedal Robot Based on Improved RRT-Connect Algorithm. Sensors. 2025; 25(8):2558. https://doi.org/10.3390/s25082558

Chicago/Turabian Style

Xu, Xiaohua, Peibo Li, Jiangwu Zhou, and Wenzhuo Deng. 2025. "Path Planning of Quadrupedal Robot Based on Improved RRT-Connect Algorithm" Sensors 25, no. 8: 2558. https://doi.org/10.3390/s25082558

APA Style

Xu, X., Li, P., Zhou, J., & Deng, W. (2025). Path Planning of Quadrupedal Robot Based on Improved RRT-Connect Algorithm. Sensors, 25(8), 2558. https://doi.org/10.3390/s25082558

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