Next Article in Journal
Projection Profiling: A Data Compressing Strategy in Three-Dimensional Liquid Chromatography for Quality Control of Traditional Herbal Medicine
Previous Article in Journal
Efficient IoT User Authentication Protocol with Semi-Trusted Servers
Previous Article in Special Issue
Advanced Sensing and Control Technologies for Autonomous Robots
 
 
Font Type:
Arial Georgia Verdana
Font Size:
Aa Aa Aa
Line Spacing:
Column Width:
Background:
Article

Autonomous Navigation of Mobile Robots: A Hierarchical Planning–Control Framework with Integrated DWA and MPC

by
Zhongrui Wang
1,
Shuting Wang
1,
Yuanlong Xie
1,2,
Tifan Xiong
1 and
Chao Wang
2,*
1
School of Mechanical Science and Engineering, Huazhong University of Science and Technology, Wuhan 430074, China
2
State Key Laboratory of Robotics and Systems, Harbin Institute of Technology, Harbin 150080, China
*
Author to whom correspondence should be addressed.
Sensors 2025, 25(7), 2014; https://doi.org/10.3390/s25072014
Submission received: 22 February 2025 / Revised: 7 March 2025 / Accepted: 12 March 2025 / Published: 23 March 2025

Abstract

:
In human–robot collaborative environments, the inherent complexity of shared operational spaces imposes dual requirements on process safety and task execution efficiency. To address the limitations of conventional approaches that decouple planning and control modules, we propose a hierarchical planning–control framework. The proposed framework explicitly incorporates path tracking constraints during path generation while simultaneously considering path characteristics in the control process. The framework comprises two principal components: (1) an enhanced Dynamic Window Approach (DWA) for the local path planning module, introducing adaptive sub-goal selection method and improved path evaluation functions; and (2) a modified Model Predictive Control (MPC) for the path tracking module, with a curvature-based reference state online changing strategy. Comprehensive simulation and real-world experiments demonstrate the framework’s operational advantages over conventional methods.

1. Introduction

The maturation of robotics and cyber-physical systems has propelled mobile robots into critical roles across smart manufacturing and logistics ecosystems [1,2,3,4]. These autonomous platforms now constitute essential infrastructure for material handling and process automation in industrial production and warehouse management [5]. These operational environments typically exhibit dynamic uncertainty characterized by static and dynamic obstacles, including misplaced components or moving humans [6,7]. These dynamic interactions within the environment frequently interfere with the intended global trajectories of mobile robots, rendering the predefined paths ineffective [8,9]. Conventional fixed-path tracking systems prove inadequate in such non-stationary conditions, severely compromising operational efficiency and limiting industrial applications. Thus, to maintain operational continuity during different tasks, mobile robots must simultaneously achieve closed-loop trajectory following through advanced tracking controllers and real-time local reference path generation upon obstacle detection. This integration of real-time path re-planning with robust trajectory tracking forms the foundational requirement for the safe autonomous navigation of mobile robots.
The Dynamic Window Approach (DWA), a widely implemented path planning algorithm, determines an optimal local path through real-time fusion of sensor-acquired environmental data and robotic odometric information [10,11]. This methodology operates via four computational phases: (1) establishing a velocity window by enumerating all kinematically feasible velocities within current dynamic constraints; (2) discretizing the velocity domain through systematic sampling; (3) generating trajectory predictions; and (4) executing multi-objective optimization through predefined objective functions to identify the optimal trajectory for subsequent actuation [12,13]. Ref. [14] introduces the Finite Distribution Estimation-based DWA (FDEDWA), which enhances DWA by integrating finite memory filtering (FMF) to estimate obstacle distributions in dynamic environments, enabling robust navigation through noise reduction via Frobenius norm optimization and covariance adaptation. A hybrid navigation method that combines reinforcement learning with the DWA is proposed in [15], employing a neural network trained via proximal policy optimization (PPO) to dynamically adjust DWA’s cost function weights based on short-term obstacle motion observations. Ref. [16] presents a hybrid algorithm for Automated Guided Vehicles (AGVs) in Industry 4.0 settings, combining an enhanced Social Force Model (SFM) and improved Dynamic Window Approach (DWA) with SparkLink communication technology to optimize dynamic obstacle avoidance by boosting environmental perception and data reliability. Ref. [17] proposes a dual-layer path planning algorithm for multi-robot systems in dynamic environments, integrating an improved Glasius Bio-inspired Neural Network (GBNN) with an enhanced DWA to optimize global path planning and enable real-time obstacle avoidance. However, existing DWA planning methods exhibit critical limitations in concurrently ensuring trajectory smoothness and planning reliability. A fundamental limitation stems from inadequately addressing the geometric continuity between local and global path segments and neglecting the kinematic constraint of the system. This dual deficiency induces geometrically non-smooth trajectories, thereby triggering unstable maneuvers during obstacle avoidance.
Trajectory tracking control constitutes a closed-loop process where controllers compute actuation commands (e.g., velocity and torque) based on the state error between the robotic system’s current state and the reference trajectory, subsequently driving wheel motors to achieve path-following precision [18,19]. Distinguished by its model-based optimization framework, Model Predictive Control (MPC) operates through three constitutive elements: predictive model, receding horizon optimization, and feedback compensation mechanisms [20,21]. This approach demonstrates superior robustness and control accuracy compared to conventional methods, especially in handling constrained optimization through real-time quadratic programming that explicitly incorporates system constraints (e.g., torque saturation and velocity boundaries) [22,23]. This constraint-handling capability, absent in most tracking controllers, renders MPC increasingly popular in real-world applications [24,25]. Ref. [26] combines MPC and Sliding Mode Control (SMC) to enhance path tracking precision and robustness by integrating sliding mode functions into the MPC framework and adaptively adjusting prediction/control horizons via fuzzy rules based on vehicle speed and path curvature. A nonlinear MPC framework for unmanned sailboats is proposed in [27], which jointly regulates velocity and heading, employing a Line-of-Sight (LOS) guidance with Lyapunov-based backstepping for non-upwind tracking and a zigzag strategy with lateral error-triggered heading switching for upwind scenarios. Ref. [28] introduces a parallel NMPC path tracking controller for autonomous vehicles, combining a Newton optimization algorithm with FPGA hardware acceleration to enhance real-time performance by simplifying the optimization problem through variable approximations and optimizing hardware design for speed–resource efficiency. A tube-based robust MPC for autonomous articulated vehicles is proposed in [29], combining a simplified lumped dynamics model with constraint integration to enhance path tracking accuracy and stability while ensuring robustness against modeling errors and worst-case disturbances. However, the inherent geometric particularity of local paths relative to global paths in autonomous navigation systems presents significant challenges for precise tracking control. Prevailing methodologies simplify controller architecture by employing identical control policies across both the nominal tracking mode and the obstacle avoidance mode. These methodologies prove inadequate when local path planning necessitates abrupt curvature variations (e.g., sharp turns) to circumvent obstacles, violating fundamental requirements for motion smoothness and tracking accuracy. To ensure system stability under such non-uniform curvature conditions, advanced control strategies must adaptively modulate control gains based on real-time path geometry characteristics such as the curvature.
Based on the above discussion, existing hierarchical frameworks typically neglect information integration between the local path planning and tracking stages. Thus, as shown in Figure 1, these methods have two critical limitations: (1) the control layer, uninformed by planning constraints, fails to adapt to trajectory modifications during tracking, potentially inducing system oscillations during mode transitions (e.g., normal operation to obstacle avoidance); and (2) the planned trajectories, generated without considering control dynamics, may violate the robot’s kinematic and dynamic characteristics, resulting in significant tracking errors that could precipitate unintended collisions. These limitations fundamentally lead to poor autonomous navigation performance of mobile robotic systems in dynamic environments. Therefore, navigation with simultaneous consideration of control and planning is of research value. Consequently, we proposed a framework for robotic navigation that integrates the control and planning stages in this paper. The following issues are considered:
  • For better local planning performance, the selection of a local target requires careful consideration of the spatial relationships of the robot and the obstacle to ensure effective navigation. Additionally, enhancing path smoothness through geometric continuity constraints is essential for maintaining control stability during obstacle avoidance maneuvers. In addition, guaranteeing planning success rates in complex environments necessitates adaptive methods that preserve path connectivity between the start and goal points under varying obstacle situations.
  • How to design an effective controller that will ensure smooth transitions between global and local paths for the robot to achieve high tracking accuracy and operational safety.
The key contribution of this paper are as follows:
  • A hierarchical planning–control framework with integrated DWA and MPC was proposed. The proposed framework holistically considers trajectory feasibility, continuity during path recovery, and tracking accuracy. The overall scheme is shown in Figure 2.
  • For the local path planning module, an online local target point selection strategy was developed to address the limitations of conventional planning methods that inadequately consider the correlation between local and global paths, while simultaneously improving planning success rates across diverse environments. Additionally, building upon the standard DWA, we improved the path smoothness through modifications to the path evaluation function. These enhancements provide convenience for the subsequent control module.
  • Regarding the trajectory tracking control module, a curvature-adaptive reference point adjustment mechanism was proposed to mitigate tracking accuracy degradation in the obstacle avoidance mode. Furthermore, we implemented adaptive optimization of both prediction horizon and control horizon parameters, thereby significantly improving the tracking precision and the computational efficiency of the controller.
The rest of this paper is organized as follows. Section 2 gives the preliminaries of the proposed method. Then, the hierarchical planning-control framework with integrated DWA and MPC is introduced in detail in Section 3. In Section 4, a series of simulations and real-world experiments is conducted to demonstrate the advantages of the proposed framework over traditional methods. Finally, Section 5 concludes this paper.

2. Preliminaries

2.1. The Dynamic Window Approach

DWA is a well-established local path planning methodology capable of generating collision-free trajectories, demonstrating particular effectiveness in real-time navigation scenarios [30,31]. The approach operates within a velocity window defined by angular velocity ω and linear velocity v parameters. The evaluation function simultaneously optimizes for obstacle avoidance, motion smoothness, and target convergence. The velocity vector achieving maximum evaluation score is selected as the optimal velocity command for subsequent planning stages. Through this iterative process, DWA progressively constructs collision-free trajectories from initial position to the designated target [32], as shown in Figure 3. The subsequent control layer then executes trajectory tracking commands derived from this planned path, ultimately achieving collision-free navigation through coordinated planning–control interactions.
Velocity sampling fundamentally involves the systematic construction of an admissible velocity window through a multi-constraint synthesis to satisfy application-specific operational requirements. As illustrated in Figure 4, the velocity window V f of mobile robots during a certain sampling period can be expressed as:
V f = V s V d V a
The primary constraints originate from bounded ranges defined by the linear velocity and angular velocity limits, which constitute the fundamental boundaries of the velocity window V s :
V s = ( v , ω ) v 0 , v max ω ω max , ω max
Given a current velocity state ( v c , ω c ) , the dynamically admissible velocity window V d arises from bounded acceleration capabilities, specifically the maximum linear acceleration v ˙ m and angular acceleration ω ˙ m , constrained by the torque limitations of the drive system:
V d = ( v , ω ) v v c v ˙ m Δ t , v c + v ˙ m Δ t ω ω c ω ˙ m Δ t , ω c + ω ˙ m Δ t        
The final constraint stems from collision-avoidance requirements, mandating the capability to execute an emergency stop before potential collisions. This safety criterion defines the admissible velocity window V a through the braking condition:
V a = ( v , ω ) v 0 , 2 · dist ( v , ω ) · v ˙ m ω 0 , 2 · dist ( v , ω ) · ω ˙ m
The computed velocity window V f undergoes systematic discretization to generate candidate velocity pairs. These discretized ( v , ω ) values are subsequently applied as control inputs to predict states through the system model, yielding all kinematically feasible trajectories at the current planning iteration. The trajectory evaluation process employs a multi-criteria framework where all candidate trajectories undergo quantitative assessment. Finally the velocity ( v , ω ) corresponding to the trajectory with the highest score is selected as the simulated velocity at the next planning moment. The fundamental optimization objective combines obstacle avoidance with time-optimal navigation, mathematically expressed as minimizing the time-to-goal t f under safety constraints:
f v , ω = ρ w h · heading v , ω + w v · vel v , ω + w o · obdist v , ω
where w h , w v and w o are the weighting coefficients of each sub-evaluation function, and  ρ · denotes the normalization function. The specific form of each sub-evaluation function can be expressed as follows:
heading v , ω = 180 ° Δ θ
vel v , ω = v s .
obdist v , ω = d max , d obs τ obs d obs , d obs < τ obs
where Δ θ and d obs represents the target direction vector and distance value from the terminus of the trajectory to be assessed to the local navigation target, respectively. d max and τ obs are predefined parameters with respect to the obstacle avoidance range and the maximum evaluation threshold.

2.2. System Modeling

Under low-velocity operational conditions, kinematic modeling demonstrates superior fidelity in characterizing a system while maintaining structural simplicity, thus achieving prevalent adoption in mobile robotic systems. The kinematic model investigates the geometric dependencies governing mobile robots’ spatial-temporal behavior, incorporating analytical descriptions of positional coordinates, velocity profiles, and their temporal variations. Therefore, this paper employs the kinematic model to systematically examine motion planning and control strategies for autonomous navigation. As shown in Figure 5, let XOY denote the world coordinate system. Designating C as the robot’s center of mass, x c , y c corresponds to its Cartesian coordinates in the XOY frame. The  X v -axis orientation aligns with the robot’s heading direction, with  θ specifying the angle between the X v -axis and the global X-axis, formally defined as the yaw angle. The steering angle is denoted by δ f , while v and ω represent the linear velocity and angular velocity, respectively. L f and L r , respectively, indicate the longitudinal distances from the front/rear axles to the center of mass. The instantaneous center of rotation (ICR), determined by the intersection of virtual front-wheel steering axis and rear-wheel alignment perpendicular, generates the turning radius R measured from the vehicle’s central axis. Based on the above definition, the kinematic model of the mobile robot can be represented as:
η ˙ = x ˙ c y ˙ c θ ˙ = v cos θ v sin θ tan δ f L f + L r v = f η , u
with ω = θ ˙ = v R = v L f + L r tan δ f . η = x c , y c , θ T and u = v , ω T denotes the state vector and control input, respectively.

3. Methodology

To enable autonomous navigation of mobile robots, this section proposes a hierarchical framework integrating local path planning with trajectory tracking control. The framework architecture was designed with two principal enhancements: (1) optimization of the evaluation function and sub-target selection strategy in the standard DWA to ensure trajectory feasibility and control compatibility; and (2) development of a curvature-adaptive model predictive controller incorporating reference point adjustment mechanisms to address path tracking inaccuracies caused by global–local path discrepancies.

3.1. The Improved DWA

There are clear options for improving the traditional DWA. Firstly, the existence of the trajectory evaluation function gives the designer a high degree of freedom to modify and optimize according to the different tasks; secondly, as a point-to-point path planning algorithm, the selection of the local sub-target points has a great influence on the planning results. Therefore, this section will propose an improvement scheme for these two points, so that the planned local paths are more in line with the needs of practical trajectory tracking control.

3.1.1. Modification of the Evaluation Function

The conventional DWA exhibits inherent conflicts between its obstacle avoidance and heading alignment criteria. As illustrated in Figure 6, when obstacles proximate the target location, the heading evaluation prioritizes trajectories minimizing angular deviation Δ θ , while the obstacle metric conversely favors trajectories maximizing clearance distance. This fundamental contradiction becomes particularly acute when obstacles obstruct the direct path to the goal, where the competing objectives induce oscillatory behavior that compromises system stability and may ultimately result in planning failures.
To mitigate path oscillations caused by the interference between heading angle and obstacle evaluation functions in mobile robot navigation, the conventional heading angle evaluation function is transformed into a target distance-based evaluation function godist ( v , ω )
godist v , ω = 1 x p x g 2 + y p y g 2 + ς
where ς is a non-zero small quantity, and  ( x p , y p ) and ( x g , y g ) represent the coordinates of the end of the predicted trajectory and the target point under the global coordinate system, respectively.
Remark 1. 
The target distance evaluation function is defined as the reciprocal of the distance between predicted trajectory and target coordinates. This metric demonstrates inverse proportionality characteristics: during long-range navigation phases, its minimal contribution to the overall evaluation function allows flexible path exploration, whereas near obstacles, the function dominates the optimization process to prioritize the dual objectives of target approach and obstacle avoidance. This dynamic mechanism effectively resolves the oscillation phenomenon inherent in conventional heading-based DWA.
Secondly, the conventional method’s inherent limitation lies in its disregard for velocity continuity between consecutive planning cycles. The current optimal velocity vector ( v , ω ) is determined independently from the preceding state ( v prev , ω prev ) , creating discontinuous velocity variations. Through the curvature relationship k = ω / v , such discontinuities propagate into trajectory curvature fluctuations that exceed actuator tracking capabilities. To ensure smooth motion execution, the evaluation must incorporate curvature continuity constraints quantified by the curvature differential Δ k = | k t k t 1 | , where lower differential values correspond to higher trajectory quality ratings:
curcon v , ω = 1 ω v ω last v last + ς
In summary, the improved evaluation function is:
G v , ω = ρ w d · godist v , ω + w v · vel v , ω + w o · obdist v , ω + w c · curcon v , ω

3.1.2. Adaptive Sub-Target Selection Strategy

As a point-to-point navigation methodology, the determination of the sub-target critically influences planning performance. Optimal sub-target selection ensures trajectory continuity and smoothness, whereas bad choices may induce terminal oscillations or planning failures. Conventional fixed-interval sampling sub-targeting along global paths, while computationally efficient, demonstrates scenario sensitivity due to its static configuration. Particularly in cluttered environments where the obstacle distribution is stochastic, this approach suffers from robustness deficiencies and reduced success rates, exemplified by planning failure when obstacles proximate the sampled sub-target. To address these limitations, we propose an adaptive sub-target selection strategy. All candidate nodes within the target region undergo a multi-criteria cost analysis, with the optimal node selected through minimum-cost optimization. Notably, this methodology maintains algorithm-agnostic characteristics, enabling integration with various local planners beyond the baseline DWA.
The local sub-target determination process initiates with global path discretization. Given a predefined global trajectory ξ spanning from initial position p s to terminal goal p g , we construct a discrete reference point set through parametric sampling:
ξ = p s , p 2 , p 3 p g
where p i R 2 denotes Cartesian coordinates.
Building upon the fixed-interval sampling method, the global path undergoes uniform segmentation into m isomorphic sub-paths ξ j ( j = 1 , , m ) , each maintaining equal arc length Δ s . This decomposition transforms the holistic navigation task into sequential sub-goal tracking problems. During nominal tracking mode, the trajectory tracking controller ensures asymptotic convergence to each ξ j . Obstacle detection will trigger a conditional planning mode governed by the distance assessment. Let d curr quantify the arc-length along current sub-path ξ j , and  τ path denote the switching threshold. As shown in Figure 7, the viable target region Γ follows a threshold-based switching criterion:
Γ = p p ξ j + 1 , d curr τ path p p ξ j P curr p > P curr P ob , d curr < τ path
where P curr R 2 and P ob R 2 represent the robot/obstacle position, with  | | · | | denoting the Euclidean metric.

3.1.3. Design of the Sub-Goal Evaluation Function

At each planning iteration, we define the candidate sub-target selection as a evaluation problem over the feasible set Γ . The candidate point with the smallest cost in the region Γ will be selected as the local sub-target point at the current moment. The composite cost functional cost ( · ) integrates three critical navigation metrics:
ob-cost p i , Γ = o b max , d ob p i , Γ τ ob 1 d ob p i , Γ , d ob p i , Γ > τ ob
dist-cost p i , Γ = P curr p i , Γ
yaw-cost p i , Γ = 1 cos Δ φ p i , Γ
As shown in Equation (18) and Figure 8, the function used to evaluate each target point p i , Γ can be expressed as:
cost p i , Γ = w b · ob-cost p i , Γ + w t · dist-cost p i , Γ + w y · yaw-cost p i , Γ
where w b , w t and w y are the weight coefficients of different sub-evaluation function. d ob p i , Γ denotes the distance of the to-be-selected target from the obstacle, τ ob and o b max are the predefined thresholds. Δ φ p i , Γ is the heading angle difference between current position and the target point.
Remark 2. 
The formulation presented in Equation (15) demonstrates that proximal positioning of sub-target points relative to obstacles induces elevated cost values, thereby preventing path planning failures caused by obstacle occlusion of the target location. This cost mechanism simultaneously eliminates sharp turns associated with the proximity of local sub-target points to obstacles, improving motion smoothness. Furthermore, to guarantee fast reintegration of the mobile robot into the normal navigation mode after obstacle avoidance, spatial proximity between the local sub-target and the current position must be constrained, as presented in Equation (16). The heading cost (Equation (17)) primarily addresses transitional continuity between local path segments and the global path. Without this orientational component, the path planner will exhibit preferential selection of geometrically proximal targets relative to the initial planning position. Under such conditions, local paths asymptotically approach orthogonality relative to the global path’s directional vector at the target node, as illustrated in Figure 9, which significantly compromises motion stability during transitional maneuvers.

3.2. Trajectory Tracking Controller with MPC

3.2.1. Design of Objective Function and Constraints

MPC derives optimal control inputs through real-time optimization, where the objective function and constraint formulation critically determine controller performance. The design prioritizes tracking accuracy for reference trajectories while simultaneously ensuring control continuity through bounded actuation variations to mitigate system oscillations. This dual-focused approach enables precise and stable trajectory tracking, mathematically expressed as:
J = Y ˜ Q 2 + Δ U ˜ R 2 = i = 1 N p η ( k + i | k ) η r ( k + i | k ) Q 2 + i = 0 N c 1 u ( k + i | k ) u r ( k + i | k ) R 2 = i = 1 N p η ( k + i | k ) η r ( k + i | k ) T Q η ( k + i | k ) η r ( k + i | k ) + i = 0 N c 1 u ( k + i | k ) u r ( k + i | k ) T R u ( k + i | k ) u r ( k + i | k )
where Q, R represent the positive-definite weight matrices, and  N p and N c represent the prediction and control horizon. η r = x r , y r , θ r T and u r = v r , ω r T denotes the reference state and control input, respectively.
The objective function incorporates control variation penalties, imposing progressive cost escalation with increasing actuation changes to discourage abrupt adjustments. Nevertheless, the mobile robot’s mechanical limitations necessitate strict bounds on both the control input and its rate:
u min u u max
Δ u min Δ u Δ u max
where u min and u max represent the minimum and maximum executable control values dictated by the actuation system. Equation (21) constrains the control rate Δ u , with  Δ u min and Δ u max enforcing bounds on permissible actuation variations per sampling interval. These limitations ensure compliance with the robot’s dynamic response capabilities while preventing mechanical stress caused by abrupt control commands.
Then, the optimal control problem for path tracking can be formulated as:
min u J ( η , u )
subject to:
η ˙ = f η , u
η ( 0 ) = η 0
u U
where Equation (23a) enforces the state constraint according to the system dynamics with f ( · ) defining the nonlinear state transition function and the initial state η 0 . The feasible set U is defined in Equations (20) and (21).

3.2.2. Curvature-Adaptive Reference Point Adjustment Mechanism

Upon obstacle detection, the locally planned path might undergo abrupt curvature variations such as sharp turns. In such scenarios, conventional controllers cannot respond promptly to these sudden changes due to their inability to anticipate upcoming road conditions. This could result in a significant tracking error from the reference path, potentially leading to unintended collisions with obstacles, even when a collision-free local path is successfully generated. To solve this problem, this section develops a curvature-adaptive reference point adjustment mechanism. When a detected curvature variation exceeds a predefined threshold, a forward-looking path point is activated as the preview-enabled reference, improving the prediction capability regarding the change in the path. During curvature stabilization phases, the reference point exponentially converges to the nearest point p near , preserving path tracking continuity.
Before further discussion, the forward-looking distance d f , the out-of-segment distance d o n , and the on-segment distance d o u t are introduced. The forward-looking distance evaluates the mobile robot’s ability to predict the path ahead and is the basis for selecting the reference point; the out-of-segment distance d o n refers to the distance between the closest point p near on the global path ξ and the mobile robot at the current moment; and the up-segment distance d o u t defines the the distance from the actual reference point p r to the nearest reference point p near :
d o n = P curr p i , p i ξ
d o u t = p i + 1 p i , p i ξ
ξ = p near , , p r
d f = d o n + d o u t
The forward-looking distance exhibits significant correlation with reference point selection in trajectory tracking systems. Paths demonstrating high curvature variance demand extended preview distances to proactively compensate for abrupt curvature transitions, thereby enhancing path tracking robustness. Conversely, low-curvature paths permit reduced preview horizons through curvature-adaptive scaling. Based on this, an iterative update strategy is defined such that the forward-looking distance varies with the path curvature:
d f ( k + 1 ) = d f ( k ) + sgn ( δ c κ 1 ) × max ( δ c , κ 1 )
with
δ c = κ 2 c r c r + 1
d fmin d f ( k ) d fmax
sgn y = 1 , y > 0 0 , y = 0 1 , y < 0
where c r is the curvature of the path at the current reference point, and  δ c is associated with the curvature variance. κ i ( i = 1 , 2 ) , d fmin , and  d fmax are positive adjustable parameters. The sign function sgn ( · ) determines whether the value of the forward-looking distance d f increases or decreases.
Remark 3. 
The forward-looking distance d f ( k + 1 ) is dynamically determined by the current distance d f ( k ) and curvature variation δ c . This strategy operates based on path characteristics: (1) high-curvature-variation segments (typical in local obstacle-avoidance paths with abrupt curvature transitions, e.g., sharp turns); and (2) low-curvature-variation segments (common in global reference paths composed of simple geometric curves). For local path tracking, d f progressively adjusts to d f m a x through monotonic increments, enhancing path prediction accuracy to mitigate tracking errors and collision risks. Conversely, in global path tracking, d f asymptotically converges to d f m i n via controlled reduction, optimizing computational efficiency, which will be further discussed at the end of this section.
This adaptive adjustment of the forward-looking distance is achieved by comparing the curvature variation δ c with a predefined threshold κ 1 . The  max ( · ) function determines the larger value between these two parameters, while the sgn ( · ) function regulates the direction of distance adjustment: when δ c < κ 1 , in smooth global paths, the negative sgn ( · ) function triggers a gradual reduction in the look-ahead distance; conversely, when δ c > κ 1 in local paths with significant curvature variations, the positive sgn ( · ) function initiates a progressive increase. This mechanism enables self-adaptive switching between global and local path tracking. Based on this, the curvature-adaptive reference point adjustment mechanism can be expressed as:
p r = argmin d o u t p near p i , p i ζ , d f > d min p near , d f = d min
Remark 4. 
This predictive curvature adaptation enables the mobile robot to anticipate path curvature variations, enhancing path tracking accuracy through improved reference path alignment. Simultaneously, it mitigates steering oscillations caused by exclusive reliance on the nearest reference point ( p n e a r ) by avoiding excessive steering maneuvers. The integrated approach thereby reduces collision risks associated with trajectory tracking inaccuracies, as shown in Figure 10.
Adjustments in reference points may render the original prediction horizon inadequate for current operational requirements. Extended prediction horizons intensify computational complexity in optimal control problem solving, while reduced horizons impair predictive capability of upcoming paths, compromising anticipatory control input generation and tracking accuracy. Optimal performance is achieved by strategically balancing the prediction horizon to enhance tracking precision with acceptable computational cost increments, as determined by the following equation:
N ˜ p = d f v c × T
N p = min max N ˜ p , N pmin , N pmax
where v c denotes the current velocity of the mobile robot, T denotes the sampling period, and  N pmin and N pmax are the set minimum and maximum prediction horizon, respectively.
Additionally, it is assumed in this paper that the control horizon is correlated with the prediction horizon:
N c = μ N p , μ 0 , 1
Generally, the proposed framework demonstrates two novel advancements over conventional hierarchical control architectures: The standard DWA is enhanced through evaluation function refinement and sub-target selection optimization to guarantee trajectory feasibility while maintaining control system compatibility; simultaneously, curvature-aware adaptation dynamically adjusts reference points based on local path geometry, significantly enhancing control precision.

4. Experiment

This section evaluates the proposed hierarchical planning-control framework through dual-aspect comparative experiments, rigorously assessing path planning efficacy and trajectory tracking precision to validate the performance advantages of the proposed methodology. The general flow of the proposed method is shown in Algorithm 1 and Figure 11, and the algorithmic parameters are listed in Table 1.
Algorithm 1 DWA-MPC Hierarchical Navigation Framework
Require: 
Global path G, Robot state X
Ensure: 
Control command u
1:
loop
2:
    Local map M, Lidar _ cloud S ENSOR U PDATE ( )
3:
     Collision _ flag E VALUATE C OLLISION R ISK ( Lidar _ cloud , X )
4:
    if  Collision _ flag  then               ▹ Local Replanning via DWA
5:
         Candidate _ goals G ENERATE S UBGOALS ( G , X , M , radius = 2.0 m )
6:
         Optimal _ subgoal arg max S CORE S UBGOALS ( Candidate _ goals , X , M )
7:
         τ DWAP LANNER ( X , Optimal _ subgoal , M )
8:
         MPC . ReferenceTrajectory τ
9:
         R ESET MPCH ORIZONS ( N p , N c )
10:
    else
11:
         MPC . ReferenceTrajectory G
12:
    end if
                           ▹ Adaptive MPC Tracking
13:
    if  MPC _ execution _ cycle  then
14:
         Current _ ref _ point F INDNEAREST P OINT ( MPC . ReferenceTrajectory , X )
15:
         κ C OMPUTE O PTIMAL R EFERENCE ( MPC . ReferenceTrajectory , Current _ ref _ point )
16:
         ( N P adapt , N C adapt ) A DJUST H ORIZONS ( κ )
17:
         u opt S OLVE M P C ( X , κ )
18:
         A PPLY C ONTROL ( u opt [ 0 ] )
19:
    end if
20:
end loop

4.1. Local Path Planning Layer

To validate the proposed DWA, random obstacles are generated along the global path as shown in Figure 12, the gray circles represent static obstacles in the robot’s navigation environment. The radius of the gray circles is determined by the obstacle radius (0.2 m), the robot radius (0.15 m), and a predefined safety margin of 0.1 m. These obstacles simulated common indoor navigation challenges (e.g., pillars, furniture). The improved method is benchmarked against the standard DWA, with both methods coupled to the proposed MPC trajectory tracker. Statistical performance metrics—including mean path length and planning success rate—are derived from multiple experimental trials to quantify algorithm efficacy.
Figure 12 demonstrates the local path trajectories generated by both standard and enhanced DWA under identical environmental conditions. The proposed method achieves superior path smoothness by integrating a curvature continuity term in its cost function to explicitly account for geometric consistency during local path generation. This is evidenced by the robot’s gradual transition maneuvers around obstacles compared to abrupt directional changes observed in the baseline method. Region II in Figure 12 shows the mobile robot’s seamless transition from global to local path navigation, replacing abrupt steering maneuvers near obstacles with curvature-consistent path following. This anticipatory behavior mitigates collision risks induced by path curvature discontinuities during trajectory tracking control.
Regions I and III demonstrate the practical effects of the adaptive sub-target selection strategy. The strategy significantly outperforms the standard fixed-length strategy by simultaneously optimizing distance and heading angle continuity between local targets and the robot’s current position. As evidenced in Region I, the proposed approach enables faster global path recovery after obstacle avoidance. This mitigates tracking complexity through smooth local–global path transitions. Conversely, the standard DWA induces persistent global path divergence, and the robot takes a longer time to return to the global path. The obstacle-proximity awareness in local sub-target selection prevents goal occupancy conflicts, as demonstrated in Region III, by enforcing minimum clearance thresholds between targets and obstacles. Standard DWA often triggers circular search patterns near obstructed targets due to persistent infeasible path generation, invariably resulting in planning failures. Conversely, the proposed method proactively selects collision-free targets through obstacle distance optimization, thereby resolving the inherent conflict between obstacle avoidance and goal convergence to guarantee planning feasibility.
As quantified in Table 2, through 20 randomized obstacle environments, the proposed method achieves a 8.58 m reduction in average path length compared to the traditional DWA, significantly enhancing task completion efficiency. Concurrently, the planning success rate improves from 60% (12/20) to 95% (19/20), demonstrating substantial performance gains in complex navigation scenarios.

4.2. Path Tracking Layer

In this section, the proposed DWA will be selected as the basic local planning method, and a series of comparative experiments will be carried out using the standard MPC with N p = 10 , a PID controller (P = 1, I = 0.001, D = 20), and the proposed MPC as the tracking control methods. The actual trajectory output results are jointly determined by both the trajectory tracking control layer and the local path planning layer.
Figure 13 gives the output trajectories of the mobile robot under different tracking methods. Despite successful collision-free path planning, the PID controller exhibits significant trajectory oscillations during execution, ultimately causing collisions due to unstable tracking performance—as demonstrated by the failed maneuver in Region I of Figure 13. The curvature-adaptive MPC outperforms both the standard MPC and PID controllers in high-curvature scenarios (e.g., obstacle-avoidance paths in Region II and sharp turns in Region III), with smoother trajectory and smaller tracking errors (Figure 13). The tracking errors is shown in Figure 14.
The Integral Absolute Error (IAE) metric is adopted to evaluate the tracking accuracy:
IAE = 0 t total e r r o r ( t ) d t
where e r r o r ( t ) represents instantaneous tracking error. As per Table 3, the proposed MPC method reduces x-direction errors by 56.04% compared to PID control and 44.91% versus standard MPC, with corresponding y-direction error reductions of 49.10% and 44.26%, respectively. These results confirm the framework’s superior tracking precision.
Figure 15a illustrates the dynamic evolution of prediction horizons for both the standard and proposed methods. Prediction horizon expansion correlates with sharp curvature transitions in reference paths. This adaptation enhances tracking precision during critical avoidance maneuvers while enabling rapid convergence to minimal permissible horizons upon normal mode recovery, thereby balancing computational efficiency. Figure 15b reveals the calculation time distribution. Due to the adaptive horizon changing strategy, the average prediction horizon is shorter, thus the computational burden is smaller. The proposed method achieved a 36.6% reduction in maximum computation time and 23.5% reduction in average computation time. Overall, the proposed MPC reduces the computational burden while ensuring high tracking accuracy.

4.3. Real-World Experiments

In this section, the proposed method will be validated using the experimental platform (shown in Figure 16), while the warehouse (shown in Figure 17) is selected as the experimental scenario. The experimental platform comprises an Ackermann-steering robotic system specifically designed for autonomous navigation. This physical prototype integrates an NVIDIA Jetson TX1 embedded computing unit with a Robot Operating System (ROS)-based architecture. The optimization problem is formulated and solved via the CasADi framework [33] with a nonlinear programming solver, maintaining a 10 Hz control loop frequency. For environmental perception, a planar LiDAR sensor with a 5 m maximum ranging capability and an inertial measurement unit (IMU) provide obstacle localization and ego-state estimation, respectively, with raw point cloud data processing implemented through Point Cloud Library. All software components were developed using the C++ programming language with ROS Melodic integration, ensuring real-time performance optimizations.

4.3.1. Scene I

Figure 18 shows the experimental scene in this section and Figure 19 demonstrates the hierarchical planning–control framework’s real-time obstacle response capability. Upon detecting obstacles, the system activates the local path planning layer to generate a collision-free local trajectory while executing curvature-adaptive tracking maneuvers via the proposed MPC. The whole navigation progress is shown in Figure 19d. Through the local sub-target selection strategy, the mobile robot prioritizes navigation between two obstacles (narrow passage navigation, as shown in Figure 19a,b). Compared to moving from the same side of two obstacles, this preference makes the local path closer to the global path as much as possible while ensuring safety. Figure 19c shows the mobile robot bypassing the last obstacle and about to reach the end point.

4.3.2. Scene II

In scene II (Figure 20), the robot has to move along the global path from the start point to the end point, avoiding a human moving back and forth.
Figure 21 illustrates the robot’s dynamic obstacle avoidance and path recovery behaviors under moving obstacle conditions. Figure 21a,c demonstrate evasive steering maneuvers triggered by approaching the obstacle, while Figure 21d,e show the avoidance behavior when the robot is moving in the same direction as the obstacle. Recovery motion to global reference trajectory after avoiding the obstacle is documented in Figure 21b. The steering logic is as follows: left-turn avoidance dominates after detecting the obstacle (Figure 21a,c,e); and right-turn recovery activates upon threat clearance (Figure 21b,d) to minimize global path deviation. The whole navigation progress is shown in Figure 21f.
The proposed hierarchical strategy is benchmarked against PID control and baseline DWA, and the tracking error is shown in Figure 22. Quantitative analysis reveals 90.26% and 84.40% reductions in mean tracking errors (x: 0.113 m → 0.011 m; y: 0.109 m → 0.017 m), significant improvements validating the framework’s superior path-following accuracy. These precision gains directly translate to enhanced obstacle avoidance reliability, particularly critical in the space-constrained operational settings.

5. Conclusions

This study addresses the path planning and control challenges for mobile robots by proposing a hierarchical framework integrating local path planning and trajectory tracking control. The standard DWA is enhanced through modified evaluation functions and an adaptive sub-target selection strategy, improving planning success rates, path smoothness, and reducing tracking control complexity. An MPC-based trajectory tracking layer is developed with a curvature-adaptive reference point adjustment mechanism to enhance control accuracy during abrupt curvature variations. The prediction horizon is adaptively adjusted to balance prediction reliability and real-time computational efficiency.
Comparative experiments across diverse scenarios validate the proposed framework’s performance, demonstrating superior tracking accuracy and obstacle-avoidance performance over current approaches, establishing a new benchmark for autonomous mobile systems requiring both efficiency and safety guarantees. Specifically, it achieves a reduction in average path length alongside dramatically improved planning reliability, substantially enhancing operational efficiency. The customized MPC formulation outperforms both PID control and standard MPC in tracking precision, reducing lateral errors, with absolute tracking accuracy reaching millimeter-level precision. These advancements are achieved while concurrently reducing computational load, enabling real-time performance crucial for dynamic environments.
Future research will prioritize two extensions: (1) real-time planning-control co-optimization under dynamic uncertainties via probabilistic obstacle intention modeling, enhancing adaptability to unpredictable dynamic obstacle motions and sensor noise; and (2) distributed multi-agent collaborative navigation integrating priority-aware coordination protocols and formation control to address large-scale logistics scenarios. These advancements will be validated in human–robot shared workspaces and industrial digital twins, and comparative experiments with state-of-the-art dual-layer navigation frameworks will be conducted, bridging theoretical innovation with real-world deployment challenges.

Author Contributions

Methodology, Z.W.; Software, Z.W.; Validation, Z.W.; Formal analysis, Z.W.; Investigation, Z.W.; Resources, S.W.; Data curation, Z.W.; Writing—original draft, Z.W.; Writing—review & editing, Y.X., T.X. and C.W.; Visualization, Z.W.; Supervision, Y.X. and C.W.; Project administration, S.W. and Y.X.; Funding acquisition, S.W. and Y.X. All authors have read and agreed to the published version of the manuscript.

Funding

This research was funded in part by the State Key Laboratory of Robotics and Systems (HIT) (SKLRS-2024-KF-10), in part by the National Natural Science Foundation of China under Grant U21A20151 and Grant 52275488, and in part by the Key Research and Development Program of Hubei Province, China under Grant 2022BAA064.

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. Huang, Z.; Shen, Y.; Li, J.; Fey, M.; Brecher, C. A Survey on AI-Driven Digital Twins in Industry 4.0: Smart Manufacturing and Advanced Robotics. Sensors 2021, 21, 6340. [Google Scholar] [CrossRef] [PubMed]
  2. Arents, J.; Greitans, M. Smart Industrial Robot Control Trends, Challenges and Opportunities within Manufacturing. Appl. Sci. 2022, 12, 937. [Google Scholar] [CrossRef]
  3. Nagy, M.; Lăzăroiu, G.; Valaskova, K. Machine Intelligence and Autonomous Robotic Technologies in the Corporate Context of SMEs: Deep Learning and Virtual Simulation Algorithms, Cyber-Physical Production Networks, and Industry 4.0-Based Manufacturing Systems. Appl. Sci. 2023, 13, 1681. [Google Scholar] [CrossRef]
  4. Zhang, X.; Zheng, S.; Ahn, C.K.; Xie, Y. Adaptive Neural Consensus for Fractional-Order Multi-Agent Systems With Faults and Delays. IEEE Trans. Neural Netw. Learn. Syst. 2023, 34, 7873–7886. [Google Scholar] [CrossRef]
  5. Xie, Y.; Wang, S.; Zheng, S.; Hu, Z. Advanced Sensing and Control Technologies for Autonomous Robots. Sensors 2024, 24, 5478. [Google Scholar] [CrossRef] [PubMed]
  6. Palmieri, G.; Scoccia, C. Motion Planning and Control of Redundant Manipulators for Dynamical Obstacle Avoidance. Machines 2021, 9, 121. [Google Scholar] [CrossRef]
  7. Teso-Fz-Betoño, D.; Zulueta, E.; Fernandez-Gamiz, U.; Aramendia, I.; Uriarte, I. A Free Navigation of an AGV to a Non-Static Target with Obstacle Avoidance. Electronics 2019, 8, 159. [Google Scholar] [CrossRef]
  8. Sun, Y.; Zhao, X.; Yu, Y. Research on a Random Route-Planning Method Based on the Fusion of the A* Algorithm and Dynamic Window Method. Electronics 2022, 11, 2683. [Google Scholar] [CrossRef]
  9. Zhou, L.; Wu, N.; Chen, H.; Wu, Q.; Lu, Y. RRT*-Fuzzy Dynamic Window Approach (RRT*-FDWA) for Collision-Free Path Planning. Appl. Sci. 2023, 13, 5234. [Google Scholar] [CrossRef]
  10. Fox, D.; Burgard, W.; Thrun, S. The Dynamic Window Approach to Collision Avoidance. IEEE Robot. Autom. Mag. 1997, 4, 23–33. [Google Scholar] [CrossRef]
  11. Wang, Q.; Li, J.; Yang, L.; Yang, Z.; Li, P.; Xia, G. Distributed Multi-Mobile Robot Path Planning and Obstacle Avoidance Based on ACO-DWA in Unknown Complex Terrain. Electronics 2022, 11, 2144. [Google Scholar] [CrossRef]
  12. Khan, A.; Zhang, J.; Ahmad, S.; Memon, S.; Qureshi, H.A.; Ishfaq, M. Dynamic Positioning and Energy-Efficient Path Planning for Disaster Scenarios in 5G-Assisted Multi-UAV Environments. Electronics 2022, 11, 2197. [Google Scholar] [CrossRef]
  13. Wang, X.; Cheng, M.; Zhang, S.; Gong, H. Multi-UAV Cooperative Obstacle Avoidance of 3D Vector Field Histogram Plus and Dynamic Window Approach. Drones 2023, 7, 504. [Google Scholar] [CrossRef]
  14. Lee, D.H.; Lee, S.S.; Ahn, C.K.; Shi, P.; Lim, C.-C. Finite Distribution Estimation-Based Dynamic Window Approach to Reliable Obstacle Avoidance of Mobile Robot. IEEE Trans. Ind. Electron. 2021, 68, 9998–10006. [Google Scholar] [CrossRef]
  15. Dobrevski, M.; Skočaj, D. Dynamic Adaptive Dynamic Window Approach. IEEE Trans. Rob. 2024, 40, 3068–3081. [Google Scholar] [CrossRef]
  16. Yi, H.; Lin, R.; Wang, H.; Wang, Y.; Ying, C.; Wang, D.; Feng, L. Dynamic Obstacle Avoidance with Enhanced Social Force Model and DWA Algorithm Using SparkLink. Sensors 2025, 25, 992. [Google Scholar] [CrossRef]
  17. Teng, Y.; Feng, T.; Li, J.; Chen, S.; Tang, X. A Dual-Layer Symmetric Multi-Robot Path Planning System Based on an Improved Neural Network-DWA Algorithm. Symmetry 2025, 17, 85. [Google Scholar] [CrossRef]
  18. Zhang, X.; Qin, D.; Wang, S.; Xie, Y.; Li, H.; Li, S. Position/Attitude Cascade Regulation of Nonholonomic Four-Wheeled Mobile Robot via Double-Loop Sliding-Mode Control Mechanism. Entropy 2023, 25, 27. [Google Scholar] [CrossRef]
  19. Geng, Q.; Yang, H.; Li, L.; Hua, C. Hybrid Dynamic Event-Triggered Tracking Control of Wheeled Mobile Robots Against Stochastic DoS Attacks. IEEE Trans. Syst. Man Cybern. Syst. 2023, 53, 7805–7813. [Google Scholar] [CrossRef]
  20. Najafqolian, M.A.; Alipour, K.; Mousavifard, R.; Tarvirdizadeh, B. Control of Aerial Robots Using Convex QP LMPC and Learning-Based Explicit-MPC. IEEE Trans. Ind. Inform. 2024, 20, 10883–10891. [Google Scholar] [CrossRef]
  21. Benotsmane, R.; Kovács, G. Optimization of Energy Consumption of Industrial Robots Using Classical PID and MPC Controllers. Energies 2023, 16, 3499. [Google Scholar] [CrossRef]
  22. Arcos-Legarda, J.; Gutiérrez, Á. Robust Model Predictive Control Based on Active Disturbance Rejection Control for a Robotic Autonomous Underwater Vehicle. J. Mar. Sci. Eng. 2023, 11, 929. [Google Scholar] [CrossRef]
  23. Huang, K.; Wei, K.; Li, F.; Yang, C.; Gui, W. LSTM-MPC: A Deep Learning Based Predictive Control Method for Multimode Process Control. IEEE Trans. Ind. Electron. 2023, 70, 11544–11554. [Google Scholar] [CrossRef]
  24. Dai, L.; Lu, Y.; Xie, H.; Sun, Z.; Xia, Y. Robust Tracking Model Predictive Control With Quadratic Robustness Constraint for Mobile Robots With Incremental Input Constraints. IEEE Trans. Ind. Electron. 2021, 68, 9789–9799. [Google Scholar] [CrossRef]
  25. Li, P.; Tong, X.; Wang, Z.; Xu, M.; Zhu, J. Sensorless Model Predictive Control of Single-Phase Inverter for UPS Applications via Accurate Load Current Estimation. Sensors 2023, 23, 3742. [Google Scholar] [CrossRef]
  26. Liu, W.; Guo, R.; Zhao, J. Adaptive Sliding Mode Predictive Control for Path Tracking of Wheeled Agricultural Vehicles. Machines 2025, 13, 157. [Google Scholar] [CrossRef]
  27. Liu, K.; Yu, J.; Zhao, W. Straight-Line Trajectory Tracking Control of Unmanned Sailboat Based on NMPC Velocity and Heading Joint Control. J. Mar. Sci. Eng. 2025, 13, 15. [Google Scholar] [CrossRef]
  28. Xu, F.; Zhang, X.; Chen, H.; Hu, Y.; Wang, P.; Qu, T. Parallel Nonlinear Model Predictive Controller for Real-Time Path Tracking of Autonomous Vehicle. IEEE Trans. Ind. Electron. 2024, 71, 16503–16513. [Google Scholar] [CrossRef]
  29. Jeong, D.; Choi, S.B. Tube-Based Robust Model Predictive Control for Tracking Control of Autonomous Articulated Vehicles. IEEE Trans. Intell. Veh. 2024, 9, 2184–2196. [Google Scholar] [CrossRef]
  30. Shan, D.; Zhang, S.; Wang, X.; Zhang, P. Path-Planning Strategy: Adaptive Ant Colony Optimization Combined with an Enhanced Dynamic Window Approach. Electronics 2024, 13, 825. [Google Scholar] [CrossRef]
  31. Yuan, X.; Tong, C.; He, G.; Wang, H. Unmanned Vessel Collision Avoidance Algorithm by Dynamic Window Approach Based on COLREGs Considering the Effects of the Wind and Wave. J. Mar. Sci. Eng. 2023, 11, 1831. [Google Scholar] [CrossRef]
  32. Dao, T.-K.; Ngo, T.-G.; Pan, J.-S.; Nguyen, T.-T.-T.; Nguyen, T.-T. Enhancing Path Planning Capabilities of Automated Guided Vehicles in Dynamic Environments: Multi-Objective PSO and Dynamic-Window Approach. Biomimetics 2024, 9, 35. [Google Scholar] [CrossRef] [PubMed]
  33. Andersson, J.A.E.; Gillis, J.; Horn, G.; Rawlings, J.B.; Diehl, M. Enhancing CasADi: A software framework for nonlinear optimization and optimal control. Math. Program Comput. 2019, 11, 1–36. [Google Scholar] [CrossRef]
Figure 1. Shortcomings of current hierarchical frameworks.
Figure 1. Shortcomings of current hierarchical frameworks.
Sensors 25 02014 g001
Figure 2. The framework of the proposed autonomous navigation method.
Figure 2. The framework of the proposed autonomous navigation method.
Sensors 25 02014 g002
Figure 3. Main steps of DWA: velocity sampling, trajectory prediction, and trajectory evaluation.
Figure 3. Main steps of DWA: velocity sampling, trajectory prediction, and trajectory evaluation.
Sensors 25 02014 g003
Figure 4. The velocity window.
Figure 4. The velocity window.
Sensors 25 02014 g004
Figure 5. The kinematic model of the robot system.
Figure 5. The kinematic model of the robot system.
Sensors 25 02014 g005
Figure 6. The conflict between heading evaluation and obstacle avoidance evaluation.
Figure 6. The conflict between heading evaluation and obstacle avoidance evaluation.
Sensors 25 02014 g006
Figure 7. The viable target region with a threshold-based switching strategy.
Figure 7. The viable target region with a threshold-based switching strategy.
Sensors 25 02014 g007
Figure 8. Local target point selection strategy.
Figure 8. Local target point selection strategy.
Sensors 25 02014 g008
Figure 9. The role of the heading cost function.
Figure 9. The role of the heading cost function.
Sensors 25 02014 g009
Figure 10. The proposed strategy reduces the possibility of accidental collision due to poor control performance.
Figure 10. The proposed strategy reduces the possibility of accidental collision due to poor control performance.
Sensors 25 02014 g010
Figure 11. The overall flow of the proposed method.
Figure 11. The overall flow of the proposed method.
Sensors 25 02014 g011
Figure 12. Validation results of the proposed local path planning layer.
Figure 12. Validation results of the proposed local path planning layer.
Sensors 25 02014 g012
Figure 13. Validation results of the proposed path tracking layer.
Figure 13. Validation results of the proposed path tracking layer.
Sensors 25 02014 g013
Figure 14. Tracking error. (a) Error in X direction. (b) Error in Y direction.
Figure 14. Tracking error. (a) Error in X direction. (b) Error in Y direction.
Sensors 25 02014 g014
Figure 15. Results. (a) Variation in the prediction horizon of different methods. (b) Comparison of the calculation time.
Figure 15. Results. (a) Variation in the prediction horizon of different methods. (b) Comparison of the calculation time.
Sensors 25 02014 g015
Figure 16. Experimental Platform.
Figure 16. Experimental Platform.
Sensors 25 02014 g016
Figure 17. Experimental scenario.
Figure 17. Experimental scenario.
Sensors 25 02014 g017
Figure 18. Scene I.
Figure 18. Scene I.
Sensors 25 02014 g018
Figure 19. Experimental results in scene I. (a) Narrow passage navigation. (b) Robot moves between two obstacles. (c) Robot bypasses the last obstacle and about to reach the end point. (d) The whole navigation progress. The red dashed line shows the actual trajectory of the robot.
Figure 19. Experimental results in scene I. (a) Narrow passage navigation. (b) Robot moves between two obstacles. (c) Robot bypasses the last obstacle and about to reach the end point. (d) The whole navigation progress. The red dashed line shows the actual trajectory of the robot.
Sensors 25 02014 g019
Figure 20. Scene II.
Figure 20. Scene II.
Sensors 25 02014 g020
Figure 21. Experimental results in scene II. (a) Obstacle moves towards the robot. (b) Robot returns to global path after avoiding the obstacle. (c) Obstacle moves towards the robot. (d) Obstacle moves in the same direction as the robot. (e) Obstacle moves in the same direction as the robot. (f) The whole navigation progress. The red dashed line shows the actual trajectory of the robot.
Figure 21. Experimental results in scene II. (a) Obstacle moves towards the robot. (b) Robot returns to global path after avoiding the obstacle. (c) Obstacle moves towards the robot. (d) Obstacle moves in the same direction as the robot. (e) Obstacle moves in the same direction as the robot. (f) The whole navigation progress. The red dashed line shows the actual trajectory of the robot.
Sensors 25 02014 g021
Figure 22. Tracking error. (a) Error in X direction. (b) Error in Y direction.
Figure 22. Tracking error. (a) Error in X direction. (b) Error in Y direction.
Sensors 25 02014 g022
Table 1. Parameters.
Table 1. Parameters.
ParameterSymbolValueParameterSymbolValue
DWA_Distance weight w d 0.2SubGoal_Obstacle weight w b 0.5
DWA_Velocity weight w v 0.1SubGoal_Distance weight w t 0.3
DWA_Obstacle weight w o 0.4SubGoal_Heading weight w y 0.2
DWA_Curvature weight w c 0.3Max Prediction horizon N p m a x 20
Max velocity (linear) v m a x 0.3 m/sMin Prediction horizon N p m i n 5
Max velocity (angular) w m a x 1 rad/sMPC_weightQ0.8
Horizon parameter μ 0.4MPC_weightR0.2
Table 2. Average length and success rate of different methods.
Table 2. Average length and success rate of different methods.
Traditional DWAProposed DWA
Average path length (m)111.9768103.3942
Success rate (%)6095
Table 3. Quantitative analysis.
Table 3. Quantitative analysis.
IAE-xIAE-y
PID + DWA25.588930.0039
MPC + DWA20.419527.4022
Proposed MPC + DWA11.249615.2733
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

Wang, Z.; Wang, S.; Xie, Y.; Xiong, T.; Wang, C. Autonomous Navigation of Mobile Robots: A Hierarchical Planning–Control Framework with Integrated DWA and MPC. Sensors 2025, 25, 2014. https://doi.org/10.3390/s25072014

AMA Style

Wang Z, Wang S, Xie Y, Xiong T, Wang C. Autonomous Navigation of Mobile Robots: A Hierarchical Planning–Control Framework with Integrated DWA and MPC. Sensors. 2025; 25(7):2014. https://doi.org/10.3390/s25072014

Chicago/Turabian Style

Wang, Zhongrui, Shuting Wang, Yuanlong Xie, Tifan Xiong, and Chao Wang. 2025. "Autonomous Navigation of Mobile Robots: A Hierarchical Planning–Control Framework with Integrated DWA and MPC" Sensors 25, no. 7: 2014. https://doi.org/10.3390/s25072014

APA Style

Wang, Z., Wang, S., Xie, Y., Xiong, T., & Wang, C. (2025). Autonomous Navigation of Mobile Robots: A Hierarchical Planning–Control Framework with Integrated DWA and MPC. Sensors, 25(7), 2014. https://doi.org/10.3390/s25072014

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