Next Article in Journal
Enhanced DWT for Denoising Heartbeat Signal in Non-Invasive Detection
Previous Article in Journal
Tool Wear State Identification Method with Variable Cutting Parameters Based on Multi-Source Unsupervised Domain Adaptation
 
 
Font Type:
Arial Georgia Verdana
Font Size:
Aa Aa Aa
Line Spacing:
Column Width:
Background:
Article

Estimating Bus Mass Using a Hybrid Approach: Integrating Forgetting Factor Recursive Least Squares with the Extended Kalman Filter

School of Automobile, Chang’an University, Xi’an 710064, China
*
Author to whom correspondence should be addressed.
Sensors 2025, 25(6), 1741; https://doi.org/10.3390/s25061741
Submission received: 31 December 2024 / Revised: 7 March 2025 / Accepted: 10 March 2025 / Published: 11 March 2025
(This article belongs to the Section Vehicular Sensing)

Abstract

:
The vehicle mass is a crucial state variable for achieving safe and energy-efficient driving, as it directly impacts the vehicle’s power performance, braking efficiency, and handling stability. However, current methods frequently rely on particular operating conditions or supplementary sensors, which limits their ability to provide accurate, stable, and convenient vehicle mass estimation. Moreover, as a form of public transportation, buses are subject to stringent safety standards. The frequent variations in passenger numbers result in substantial fluctuations in vehicle mass, thereby complicating the accuracy of mass estimation. To address these challenges, this paper proposes a hybrid vehicle mass estimation algorithm that integrates Robust Forgetting Factor Recursive Least Squares (Robust FFRLS) and Extended Kalman Filter (EKF). By sequentially employing these two methods, the algorithm conducts dual-stage mass estimation and incorporates a proportional coordination factor to balance the outputs from FFRLS and EKF, thereby improving the accuracy of the estimated mass. Importantly, the proposed method does not necessitate the installation of new sensors, relying instead on data from existing CAN-bus and IMU sensors, thus addressing cost control concerns for mass-produced vehicles. The algorithm was validated through MATLAB(2022b)-TruckSim(2019.0) simulations under three loading conditions: empty, half-load, and full-load. The results demonstrate that the proposed algorithm maintains an error rate below 10% across all conditions, outperforming single-method approaches and meeting the stringent requirements for vehicle mass estimation in safety and stability functions. Future work will focus on conducting real-world tests under various driving conditions to further validate the robustness and applicability of the proposed method.

1. Introduction

With the rapid development of electric and intelligent vehicles, the safety and energy efficiency of cars have been greatly improved, effectively reducing the incidence of traffic accidents and lowering fuel consumption and pollution emissions [1]. To achieve higher levels of automotive active safety and intelligent control, precise estimation of the vehicle’s own state and motion state is required [2]. Among the factors, the total vehicle mass is a critical one. For large buses, these vehicles exhibit characteristics such as a high center of gravity, heavy payload, complex operating conditions, and significant fluctuations in occupancy during operation. The total vehicle mass varies considerably between empty and full loaded states, which must be carefully considered in the design of the control system [3]. Therefore, achieving precise, stable, and robust estimation of the total vehicle mass is of great significance for the safety and intelligent control of vehicles.
For the estimation of the total vehicle mass, a straightforward approach is to measure it by introducing new sensors. The total vehicle mass can be indirectly acquired by measuring the shape variables of the load-bearing parts of the vehicle under different load conditions by sensors [4]. For instance, variations in tire pressure can be measured using tire pressure sensors [5], and the deformation extent of the suspension can be measured with strain gauge sensors [4], thereby obtaining the total vehicle mass. However, the method of measurement through sensor installation has significant limitations in equipment installation, measurement environment, and data processing [6]. Furthermore, for original equipment manufacturers (OEMs), the addition of new sensors will lead to an increase in costs, which, from an economic cost perspective, also restricts the large-scale application of this method. Currently, it is only supported for limited use in specific scenarios.
The vehicle mass, as a critical parameter in automotive dynamics, has received increasing attention in recent years owing to advancements in methodologies and technologies. Current approaches for estimating vehicle mass can be broadly classified into two categories: based on vehicle dynamics models and deep learning techniques [7].
Methods based on vehicle dynamics models are widely employed to study the longitudinal dynamics of vehicles. In recent years, with the advancement of intelligent technologies in commercial vehicles, IMU sensors have been increasingly utilized in both passenger and commercial vehicles, significantly enhancing the accuracy of overall vehicle mass estimation. From a methodological perspective, the primary approaches for estimating vehicle mass using dynamics models include recursive least squares (RLS) [8,9] and Kalman filtering (KF) algorithms [10,11]. Vahidi et al. [12] introduced an RLS method with multiple forgetting factors, accounting for varying rates of parameter changes, to achieve segment-wise stable estimates of vehicle mass. To address the significant impact of pulse interference (such as braking and gear shifting) on the accuracy of RLS-based methods, Chor et al. [13] proposed a robust multi-forgetting factor recursive least M-squared algorithm, which ensures reliable mass estimation even under pulse interference conditions and remains accurate at low sampling frequencies. Additionally, to mitigate sensor noise and leverage data from multiple integrated sensors, Kalman filtering algorithms are extensively applied for vehicle mass estimation. SUN et al. [14] proposed a dual-layer estimation framework for electric buses based on their operational characteristics. This framework first estimates road slope using the Extended Kalman Filter (EKF) algorithm, and subsequently employs RLS and EKF algorithms to simultaneously estimate vehicle mass. The estimated results are then combined with weighting. Yang et al. [15], leveraging the explicit correlation between road roughness and the suspension system, introduced an adaptive Extended Kalman Filter–unified inverse (AEKF-UI) algorithm that can concurrently estimate vehicle mass changes and unknown road roughness inputs. Zhang et al. [16] developed a dual robust embedded cubic Kalman filter (RECKF) algorithm, which accounts for unknown measurement noise, for joint estimation of vehicle mass and center of gravity, thereby significantly improving estimation accuracy.
In recent years, with the rapid advancement of artificial intelligence technology and its widespread application across various industries, deep learning has emerged as a powerful tool for state estimation due to its ability to model complex nonlinear systems. Vehicle dynamics, being inherently nonlinear, presents significant challenges for accurate state estimation using traditional dynamic methods. Korayem et al. [17] addressed this challenge by analyzing the system and selecting appropriate feature parameters. They employed a deep neural network (DNN) approach to estimate the total vehicle mass, achieving an estimation error of less than 10%. The results were compared with those obtained from dynamic methods, demonstrating the superiority of the deep learning-based approach. Zhang et al. [18] proposed a dynamic total vehicle mass estimation framework based on bidirectional gated recurrent units (BiGRUs), which significantly improved the accuracy of deep neural network estimations. However, deep learning methods require substantial amounts of data for training, which can be prohibitively expensive for applications involving buses. Consequently, there has been a growing trend toward integrating dynamic model-based methods with deep learning techniques for state estimation. Jin et al. [8] combined the square-root cubature Kalman filter (SCKF) method based on longitudinal dynamics with the BiLSTM method from deep learning, thereby enhancing both the accuracy and stability of total vehicle mass estimation. Zhang et al. [19] initially used a feedforward neural network (FFNN) to learn the correlations between total vehicle mass and other state parameters such as longitudinal speed and acceleration. Subsequently, they applied the recursive least squares (RLS) algorithm for mass estimation and designed a fuzzy logic system to integrate the two methods. This hybrid approach exhibited superior robustness and stability.
Despite the significant achievements of both dynamic-based and deep-learning-based methods in vehicle mass estimation, each approach has its limitations and can exhibit high error rates under certain conditions. For example, during normal driving scenarios such as braking and gear shifting, the dynamic model may become misaligned, leading to substantial inaccuracies in mass estimation [20]. To address this issue, it is common to impose strict initialization conditions on the algorithms; however, adding too many constraints can slow down convergence and hinder real-time estimation capabilities [21]. Furthermore, non-Gaussian noise can severely disrupt dynamic-based methods, resulting in larger estimation errors [22]. While deep-learning-based methods are powerful, they require extensive datasets for training. Collecting such data must consider various factors, including different load distributions, driving behaviors, and environmental conditions, which poses significant challenges [23]. Additionally, when encountering unknown or unseen data, deep-learning models may experience rapid degradation in estimation accuracy, leading to instability in the results, which can critically impact driving safety.
To address the aforementioned challenges, this paper proposes a hybrid estimation method that integrates the EKF with Robust Forgetting Factor Recursive Least Squares (Robust FFRLS), focusing on buses as the research object. Initially, the total vehicle mass is estimated independently using EKF and Robust FFRLS. Subsequently, a weighted hybrid approach is employed to combine the outputs from both methods, leveraging their respective advantages under different operating conditions to achieve faster convergence and lower error rates. Finally, the proposed algorithm is validated in a simulation environment. Importantly, all sensor data required for this method can be obtained from existing vehicle sensors, eliminating the need for additional hardware and providing a cost-effective solution for whole-vehicle mass estimation.
The structure of this paper is organized as follows. Section 2 describes the modeling process of the bus dynamic model. Section 3 outlines the hybrid estimation framework, detailing the derivation of the total vehicle mass estimation using EKF and Robust FFRLS, followed by an explanation of the weighted hybrid method. Section 4 presents the validation of the hybrid algorithm under three typical loading conditions: empty, half-loaded, and fully loaded.

2. Bus Model Building

2.1. Bus Longitudinal Dynamics Model

During operation, buses primarily operate on structured roads such as urban streets and highways. The longitudinal dynamic model of a large bus, constructed based on Newton’s second law, is illustrated in Figure 1. In this model, the driving force propels the vehicle forward by overcoming four main resistances: air resistance, rolling resistance, grade resistance, and inertial resistance due to acceleration.
Aerodynamic resistance arises from the pressure and frictional forces exerted on the vehicle by the air during operation. Rolling resistance originates from the deformation and friction between the tires and the road surface when they are in contact. Grade resistance is caused by the component of gravitational force acting on the vehicle when it travels uphill or downhill. The longitudinal dynamics equation of the vehicle can be expressed as follows:
M v ˙ x = F t ( F w + F i + F f )
where M represents the vehicle mass, v ˙ x represents the longitudinal acceleration, F t represents the driving force, F w represents the air resistance, F i represents the grade resistance, and F f represents the rolling resistance.
The driving force is obtained by calculating the engine torque T t q transmitted through the power transmission system to the driven wheels. The formula is:
F t = T t q i g i 0 η T r
where T t q represents the engine torque transmitted to the wheels, i g is the gearbox transmission ratio, i 0 is the transmission ratio of the main reduction gear, η T is the mechanical efficiency of the transmission system, and r is the rolling radius of the tires. T t q and i g can be obtained through the CAN bus signal.
If the vehicle is traveling under no wind conditions, then the air resistance F w is:
F w = 1 2 C D ρ A v x 2
where C D is the coefficient of air resistance, ρ is the density of air, v x is the traveling speed, and A is the frontal area, which is the projected area of the vehicle in the direction of travel. v x can be obtained through the CAN bus signal.
When driving uphill, the grade resistance force F i that the vehicle experiences is the component of its weight force along the slope direction:
F i = M g s i n α
The rolling resistance coefficient f of a vehicle’s tire is approximately linearly related to the vehicle speed v x , and f can be expressed as f = f 0 + f 1 v x . Therefore, the rolling resistance F f is:
F f = M g f 0 + f 1 v x cos α
In this equation, g is the gravitational acceleration, α is the slope angle, f 0 and f 1 are the speed-dependent coefficients of rolling resistance, f 0 is the constant term and f 1 is the coefficient of the first-order term, and M is the mass, including the vehicle’s loaded mass M Z and the vehicle’s curb mass M C .
In fact, according to the road grade index specified in the reference standard for highway route design, the maximum grade of a road is 8%. Since the road grade for bus operation is generally smaller, it can be assumed that:
sin α tan α = α cos α 1
Then the grade resistance F i and rolling resistance F f are:
F i = M g α F f = M g f 0 + f 1 v x
By decomposing the various forces, Equation (1) can be further expressed as:
M v ˙ x = T t q i g i 0 η T r 1 2 C D ρ A v x 2 + M g α + M g f 0 + f 1 v x

2.2. Kinematic Model Based on IMU Sensor

With the advancement of automotive intelligence, IMU and other sensors have been extensively deployed to accurately measure the vehicle’s acceleration along three axes and angular velocity about these axes [24]. When the vehicle is driving uphill, the acceleration sensor measures values of a s e n x on the X axis and a s e n z on the Z axis. The measured value of a s e n x by the acceleration sensor is not only related to the instantaneous driving acceleration v ˙ x , but also affected by the current slope angle α . a s e n x is the sum of the vehicle’s driving acceleration v ˙ x , and the component of gravity acceleration g along the slope g sin α . If we consider cornering conditions, the following equation applies:
a s e n x = g sin α + v ˙ x φ ˙ v y
In this equation, a s e n x is the longitudinal acceleration measured by the IMU sensor, v y is the lateral velocity, and φ ˙ is the yaw rate.
a s e n z is the component of gravity acceleration g that is perpendicular to the slope:
a s e n z = g cos α
When the vehicle is traveling in a straight line, Equation (9) can be further simplified as:
a s e n x = g sin α + v ˙ x
Further, by combining the longitudinal kinematic model based on IMU sensors with the longitudinal dynamic model, i.e., by combining Equation (8) with Equation (11), and assuming a small slope assumption, the longitudinal dynamic expression based on velocity sensor can be obtained as follows:
M a s e n x = T t q i g i 0 η T r 1 2 C D ρ A v 2 + M g α + M g f 0 + f 1 v

3. Vehicle Mass Estimation Approach Using a Hybrid Algorithm Combining Variable-Structure EKF and Robust FFRLS

3.1. Mass Estimation Based on Robust FFRLS

The RLS algorithm, based on the principle of least squares, recursively updates parameters to adapt to changes in input signals in real time. Due to its fast convergence rate and superior performance, it is widely employed for identifying vehicle state parameters. The FFRLS algorithm enhances the traditional RLS by incorporating a forgetting factor, which assigns greater weight to new data compared to older data. This modification addresses the issue of excessive reliance on historical data in traditional RLS algorithms, thereby improving adaptability in non-stationary environments [25]. Given that buses operate in dynamic and non-stationary conditions, employing FFRLS for estimating the total vehicle mass can more rapidly accommodate new data and information, ensuring reliable performance. The standard form of the FFRLS formula can be expressed as:
y = φ T θ + e
Combining Equation (13) with Equation (12), the individual parameters can be expressed specifically as follows:
y = T t q i g i 0 η T / r 0.5 C D ρ A ν x 2 φ = a s e n x + ( f 0 + f 1 v x + α ) g θ = M
In the above equation: y is the output variable, φ is the measurable data, θ is the identification parameter, and e is Gaussian white noise.
Considering that RLS uses the minimization of residual squared error, it is sensitive to abnormal measurement data [26], abnormal measurement data input will have a significant impact on the accuracy of the overall vehicle mass estimation. In order to reduce the influence of sensor abnormal error on the accuracy of the overall vehicle mass estimation, the idea of the Huber function is introduced into FFRLS to enhance the robustness of the algorithm. The standard form of FFRLS after time discretization is as follows:
θ ^ k = θ ^ k 1 + K k ( y k φ k T θ ^ k 1 ) K k = P k 1 φ k T λ k + φ k T P k - 1 φ k 1 P k P k = ( P k 1 ( I L k φ k T ) ) / λ k
where P k is the covariance matrix, K k is the gain matrix, and λ k is the forgetting factor, which takes values in the range 0.9 < λ < 1, used to attenuate the influence of historical data on the current estimate.
Sensor noise and errors are inevitable in practical applications. When sensors produce abnormal errors, to enhance the robustness of FFRLS for estimating the total vehicle mass, M-estimation is integrated with FFRLS. The objective function is defined as follows:
J θ k = ρ r k
where r k = ( y k φ k T θ k ) , function is defined as [27]:
ρ r k = 0.5 r k 2 r k c c | r k | 0.5 r k 2 r k > c
In this equation, c is an adjustable parameter, and the derivative of the performance function J θ k with respect to c can be obtained as follows:
J ( θ k ) θ k = ρ ˙ ( r k ) r k x k = 0
Definition ψ k = ρ ˙ ( r k ) r k , ψ k is the weight value, as shown in the following equation:
ψ k = 1 r k c c r k r k > c
Introducing the weighting factor ψ k into the FFRLS, we obtain the Robust FFRLS, whose specific expression is:
θ ^ k = θ ^ k 1 + K k ψ k ( y k φ k T θ ^ k - 1 ) K k = P k 1 φ k T λ k + φ k T P k - 1 φ k 1 P k P k = ( P k 1 ( I L k φ k T ) ) / λ k
By introducing weight values ψ k , when the new measurement value r k exceeds the set value, the influence of noise and abnormal measurement data in the sensor at moment k on the overall vehicle mass estimation is weakened by updating the weight values ψ k , while also avoiding the influence of power fluctuations caused by gear shifts and braking on the overall vehicle mass estimation.

3.2. Mass Estimation Based on Robust EKF

The EKF algorithm is superior in dynamic estimation ability and adaptability to nonlinear systems, which can dynamically adjust the parameters in the state estimation process to adapt to different environmental and task requirements, ensuring the stability and reliability of state identification, thereby improving the accuracy and real-time performance of vehicle state parameter identification [28]. In addition, the EKF algorithm is favored for its capability to effectively handle nonlinear systems, such as tire characteristics and suspension dynamics, while maintaining superior real-time performance. This makes it particularly suitable for applications that require rapid response and accurate state estimation. By modeling and compensating for sensor noise and model uncertainties, the EKF mitigates error propagation and enhances the reliability of the results. Furthermore, it can efficiently manage multi-variable dynamic systems, such as acceleration and braking forces, without a significant increase in computational complexity or dimensionality. Compared to other algorithms like the Particle Filter (PF) and Unscented Kalman Filter (UKF), the EKF offers greater computational efficiency and ease of implementation in specific scenarios, especially when precise models are required for vehicle mass estimation. According to the longitudinal dynamic model established, the system’s state variables are set as shown in Equation (21):
x k = ( v k , α k , M k )
In this equation, v k represents the vehicle’s speed at the current time, α k represents the road slope angle at the current time, and M k represents the total vehicle mass at the current time.
When the vehicle is traveling steadily, the mass can be considered a constant. Assuming that the road slope angle, vehicle speed, and acceleration are continuous variables that do not undergo abrupt changes, the system prediction equation after discretizing over Δ t time is:
v k = v k 1 + v ˙ k 1 Δ t + w 1 ( k 1 ) α k = α k 1 + w 2 ( k 1 ) M k = M k 1 + w 3 ( k 1 )
In this equation, w 1 ( k 1 ) , w 2 ( k 1 ) , w 3 ( k 1 ) represent the process noise at the previous time step, and v ˙ k 1 represents the previous acceleration. They can be expressed as follows:
v ˙ k 1 = 1 δ T ( k 1 ) i g i t r η t M k 1 r g f C D A ρ v k 1 2 2 M k 1 g α k 1
The system state prediction equation can be rewritten in matrix form as follows:
x k = v k 1 + v ˙ k 1 Δ t α k 1 m k 1 + w k 1
The further system state transition equation can be expressed as:
x k = f ( u k 1 , x k 1 ) + w k 1
where u k 1 is the control vector from the previous time step.
In the measurement update, the vehicle speed can be calculated using wheel speed sensors, and the slope angle can be measured using IMU, so the measurement equation of the system is:
z k = H x k + o k = 1 0 0 0 1 0 x k + o k
In this equation, z k represents the measured value at the current time, H is the measurement matrix, and o k represents the measurement noise at the current time, which is assumed to be independent of w k and have a zero mean and a Gaussian white noise distribution.
Due to the strong nonlinearity of the system, the a priori estimate obtained by calculating the nonlinearization function f is not a unimodal Gaussian distribution, which does not meet the usage conditions of the EKF algorithm. A first-order Taylor series needs to be constructed to approximate the linear function. The first-order Taylor expansion at the previous estimate value x ^ k 1 can be expressed as:
x k = f ( u k 1 , x ^ k 1 ) + F k 1 ( u k 1 , x k 1 x ^ k 1 ) + w k 1
In this equation, x ^ k 1 represents the estimated value of the system at time x k 1 , and F k 1 represents the Jacobian matrix of the function f with respect to the state variables x k 1 , which can be expressed as:
F k 1 = 1 C D A ρ v k 1 δ M k 1 Δ t g δ Δ t C D A ρ v k 1 2 r 2 T ( k 1 ) 2 δ M k 1 2 r Δ t 0 1 0 0 0 1
The prediction update equation for the system’s a priori estimate can be obtained as follows:
x ^ k = f ( u k 1 , x ^ k 1 )
The covariance of the system’s prior estimate is:
P k = F k 1 P k 1 F k 1 T + Q
where Q is the covariance matrix of the process noise.
We further calculate the Kalman gain:
K k = P k H k T H k P k H k T + R k
Finally, the estimated value and error covariance are updated to obtain the final estimated value of the total vehicle mass:
x ^ k = x ^ k + K k ( z k H k x ^ k )
P k = ( I K k H k ) P k
The initial error covariance matrix P0, process noise Q, and measurement noise R significantly influence the convergence speed and estimation accuracy of the EKF algorithm in practical applications. The diagonal elements of the error covariance matrix represent the variances of the state variables, while the off-diagonal elements denote the covariances between these variables. When variables are uncorrelated, the off-diagonal covariance terms should be set to zero. The initial error covariance reflects the uncertainty in the initial values of the state variables and is typically initialized as an identity matrix. Process noise Q is closely associated with model accuracy, the degree of model linearization, and discretization-induced errors. Measurement noise R depends on the characteristics and precision of the selected sensors. In this study, R is determined based on sensor measurement accuracy, and Q is adjusted to optimize the estimation performance. The vehicle mass estimation process using the EKF algorithm is illustrated in Figure 2.

3.3. Hybrid Architecture for Vehicle Mass Estimation Based on EKF and Robust FFRLS

The hybrid architecture for vehicle mass estimation based on EKF and Robust FFRLS is illustrated in Figure 3. Once the vehicle begins operation, both methods concurrently initiate the estimation of the vehicle’s total mass. The initial estimate from the Robust FFRLS algorithm serves as the input to initialize the EKF algorithm, thereby enhancing the accuracy of the EKF-based estimation. Ultimately, the h function effectively hybridizes the estimates derived from the Robust FFRLS and EKF algorithms to produce a stable and accurate mass output.
The h function is a function of vehicle speed, serving as a proportional factor to weigh the two methods with weight coefficients. The value of h is shown in Figure 4.
Upon the commencement of measurements, the Robust FFRLS-based method exhibits a shorter convergence time compared to the EKF-based method. Specifically, at lower vehicle speeds with small excitations, the Robust FFRLS-based method achieves higher estimation accuracy. Conversely, after a certain period of operation, the EKF-based algorithm provides more accurate estimates of the vehicle’s total mass at high speeds and under large excitations. The hybrid vehicle mass estimate based on the h function can be expressed as:
M ^ = h M ^ 1 + ( 1 h ) M ^ 2
where M ^ 1 represents the vehicle mass value based on Robust FFRLS estimation, M ^ 2 represents the vehicle mass value based on EKF estimation, and M ^ represents the final vehicle mass estimate output by the hybrid algorithm.

4. Results and Analysis

4.1. Introduction of Test Vehicle and Test Platform

To verify the effectiveness and accuracy of the proposed bus vehicle mass estimation, a bus model was built in TruckSim (2019.0), and the algorithm was validated through joint simulation between TruckSim (2019.0) and Matlab (2022b)/Simulink (2019.0). The basic parameters of the bus are shown in Table 1.
The bus model in TruckSim (2019.0) provides gear shift signals, brake signals, acceleration signals, speed signals, and engine torque signals for the algorithm, and also provides test conditions. The simulation frequency was set to 0.01. The noise and accuracy of the IMU sensor have a direct impact on the reliability of the measured data. In order to alleviate this problem, this paper uses multiple sampling and data smoothing techniques to filter the signal to improve the signal quality.

4.2. Vehicle Mass Estimation Test Under No-Load Conditions

To verify the accuracy and effectiveness of the vehicle’s total mass estimation under empty load conditions, the bus was configured as empty in Trucksim(2019.0) to simulate a passenger-free scenario. The experimental condition involved a straight road with an adhesion coefficient of 0.85 and a true mass of 7000 kg. Data collection began immediately upon vehicle startup and continued through various driving conditions, including acceleration, constant speed, and braking, to introduce external disturbances. The experimental results are presented in Figure 5a, the vehicle speed in Figure 5b, the acceleration in Figure 5c, and the engine output torque in Figure 5d.
As shown in Figure 5a, the Robust FFRLS method does not have an initial value, so the total vehicle mass starts from 0 and rises, and the sudden braking at the rising process delays the convergence speed. The convergence starts at 21 s with an initial estimation error greater than 10%, and the error is less than 10% after convergence. The two braking events at 115 s and 147 s will cause fluctuations in the estimated value of the total vehicle mass. The EKF algorithm has an initial value, which can quickly converge to the true value, and the estimated value after convergence has good stability and is not affected by sudden external stimuli such as braking. The RMSE of the three estimation methods is shown in Table 2, and the proposed hybrid algorithm combines the advantages of the two methods by allocating and fusing them, resulting in a smaller estimation error.
Compared to the half-load and full-load conditions, the RMSE of mass estimation under no-load conditions is higher. This is due to the fact that under no-load conditions, the engine torque required for the vehicle to reach the target speed is significantly lower, resulting in reduced input excitation to the system, which adversely affects estimation accuracy. Nonetheless, the overall error remains within an acceptable range.
Finally, from the perspective of computational efficiency, the hybrid algorithm exhibits lower computational efficiency compared to both the EKF and the Robust FFRLS. This reduced efficiency is attributed to the integration of two distinct algorithms within the hybrid approach, along with the introduction of varying weighting factors, which collectively increase computational complexity. The EKF algorithm also demonstrates lower computational efficiency relative to Robust FFRLS, primarily due to its more intricate calculation steps and processes. In practical applications, appropriately sacrificing computational efficiency to enhance the accuracy of vehicle mass estimation holds significant practical value for improving vehicle safety and energy-saving performance.

4.3. Vehicle Mass Estimation Test Under Half-Load Conditions

To verify the accuracy and effectiveness of the vehicle’s total mass estimation under half-load conditions, the bus was set to half-load in Trucksim (2019.0), simulating the vehicle’s passenger situation. The test conditions were kept consistent with the empty condition, with the actual vehicle mass being 10,000 kg. The test results are shown in Figure 6.
As shown in Figure 6, both Robust FFRLS and EKF algorithms can converge to the true value, and the convergence speed of EKF is generally faster than that of Robust FFRLS. When affected by sudden external stimuli such as braking, the influence of Robust FFRLS is much greater than that of EKF, and the estimated error of Robust FFRLS gradually increases later. The RMSE of the three estimation methods is shown in Table 2, and the proposed hybrid algorithm integrates the advantages of both algorithms by allocating and fusing them. The estimated value converges to the true value to a great extent, and the RMSE is 100.95.
In the half-load condition, the mass estimation accuracy of the vehicle is significantly higher compared to the no-load and full-load conditions, being approximately twice as accurate. This enhanced accuracy can be attributed to the greater excitation obtained by the system under half-load conditions, which facilitates more precise estimations.
Finally, the computational efficiency of the method under above condition proposed in this paper is similar to that of the EKF algorithm, but lower than that of the FFRLS. However, under the half-load condition, the hybrid algorithm has the smallest RMSE among the three types of loads and achieves the best estimation effect.

4.4. Vehicle Mass Estimation Test Under Full-Load Conditions

To verify the vehicle’s overall mass estimation in the full load condition, the bus was set to full load in Trucksim (2019.0), simulating the vehicle reaching its maximum load capacity. The test conditions were kept consistent with the empty load, with the actual mass being 13,000 kg. The test results are shown in Figure 7.
As shown in Figure 7, the convergence rate of Robust FFRLS is much lower than that of the EKF algorithm, and the EKF algorithm demonstrates higher estimation accuracy and stability. The RMSE of the three estimation methods is shown in Table 2, and the proposed hybrid algorithm integrates the advantages of both methods by allocating and fusing them. The estimated value converges to the true value in the vicinity, with an RMSE of 228.91, which is smaller than the other two methods.
Under full load conditions, the accuracy of mass estimation is lower compared to that under half load. This reduction in accuracy can primarily be attributed to expanded model uncertainty, and more pronounced nonlinear effects within the system. Consequently, these factors diminish the effectiveness of the EKF algorithm in managing complex dynamics, which in turn impacts the precision of mass estimation.
Finally, under full-load conditions, despite the proposed method exhibiting lower computational efficiency, it achieves superior estimation accuracy, thus guaranteeing the active safety function and optimal braking force distribution of the vehicle. Furthermore, in practical applications, advancements in intelligent chassis technology can promote the integration of high-performance chips into chassis domain controllers, thereby significantly enhancing the computational efficiency of the proposed method.

5. Conclusions

This paper presents a hybrid estimation method for the bus mass, which integrates the estimated masses from Robust FFRLS and EKF-based methods using a proportional coordination factor. Specifically, by incorporating M-estimation with FFRLS, the algorithm enhances recognition accuracy during braking and gear-shifting conditions. The hybrid algorithm leverages the strengths of both estimation methods, enabling rapid convergence to the true value and ensuring stable estimation results. Simulation results demonstrate that, under three loading scenarios—empty, half-loaded, and fully loaded—the proposed algorithm exhibits smaller RMSE compared to single algorithms, thereby achieving superior estimation accuracy and stability.
Due to the constraints imposed by experimental conditions, the verification phase of this study was limited to simulation experiments. For future research, algorithm validation will be conducted in real-world environments using actual vehicle platforms. Moreover, lateral motion dynamics will be incorporated into vehicle mass estimation, leading to the development of a comprehensive estimator that integrates both longitudinal and lateral dynamic model.

Author Contributions

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

Funding

This research was funded by College Students’ Innovative Entrepreneurial Training Plan Program, grant number 202410710012 and Key Research and Development Program of Shaanxi, grant number 2023-YBGY-122.

Institutional Review Board Statement

Not applicable.

Informed Consent Statement

Not applicable.

Data Availability Statement

The raw data supporting the conclusions of this article will be made available by the authors on request.

Conflicts of Interest

The authors declare no conflicts of interest.

References

  1. Ritter, A.; Widmer, F.; Vetterli, B.; Onder, C.H. Optimization-based online estimation of vehicle mass and road grade: Theoretical analysis and experimental validation. Mechatronics 2021, 80, 102663. [Google Scholar] [CrossRef]
  2. Guo, H.; Cao, D.; Chen, H.; Lv, C.; Wang, H.; Yang, S. Vehicle dynamic state estimation: State of the art schemes and perspectives. IEEE/CAA J. Autom. Sin. 2018, 5, 418–431. [Google Scholar] [CrossRef]
  3. Jensen, K.M.; Santos, I.F.; Clemmensen, L.K.; Theodorsen, S.; Corstens, H.J. Mass estimation of ground vehicles based on longitudinal dynamics using IMU and CAN-bus data. Mech. Syst. Signal Process. 2022, 162, 107982. [Google Scholar] [CrossRef]
  4. Wang, B.; Wang, H.; Wu, L.; Cai, L.; Pi, D.; Wang, E. Truck mass estimation method based on the on-board sensor. Proc. Inst. Mech. Eng. Part D J. Automob. Eng. 2020, 234, 2429–2443. [Google Scholar] [CrossRef]
  5. Jeong, D.; Kim, S.; Lee, J.; Choi, S.B.; Kim, M.; Lee, H. Estimation of tire load and vehicle parameters using intelligent tires combined with vehicle dynamics. IEEE Trans. Instrum. Meas. 2020, 70, 9502712. [Google Scholar] [CrossRef]
  6. Korayem, A.H.; Khajepour, A.; Fidan, B. A review on vehicle-trailer state and parameter estimation. IEEE Trans. Intell. Transp. 2021, 23, 5993–6010. [Google Scholar] [CrossRef]
  7. Jin, Y.; Li, Y.; He, B.; Yang, X.; Zheng, L. Mass estimation of tractor-semitrailer systems: An approach of dynamics and data fusion-driven in real environments. Measurement 2024, 238, 115367. [Google Scholar] [CrossRef]
  8. Fathy, H.K.; Kang, D.; Stein, J.L. Online vehicle mass estimation using recursive least squares and supervisory data extraction. In Proceedings of the 2008 American Control Conference, Seattle, WA, USA, 11–13 June 2008; pp. 1842–1848. [Google Scholar]
  9. Feng, Y.; Xiong, L.; Yu, Z.; Qu, T. Recursive least square vehicle mass estimation based on acceleration partition. Chin. J. Mech. Eng. 2014, 27, 448–458. [Google Scholar] [CrossRef]
  10. Lingman, P.; Schmidtbauer, B. Road slope and vehicle mass estimation using Kalman filtering. Veh. Syst. Dyn. 2002, 37, 12–23. [Google Scholar] [CrossRef]
  11. Boada, B.L.; Boada, M.J.L.; Zhang, H. Sensor fusion based on a dual Kalman filter for estimation of road irregularities and vehicle mass under static and dynamic conditions. IEEE/ASME Trans. Mechatron. 2019, 24, 1075–1086. [Google Scholar] [CrossRef]
  12. Vahidi, A.; Stefanopoulou, A.; Peng, H. Recursive least squares with forgetting for online estimation of vehicle mass and road grade: Theory and experiments. Veh. Syst. Dyn. 2005, 43, 31–55. [Google Scholar] [CrossRef]
  13. Chor, W.T.; Tan, C.P.; Bakibillah, A.; Pu, Z.; Loo, J.Y. Robust Vehicle Mass Estimation Using Recursive Least M-Squares Algorithm for Intelligent Vehicles. IEEE Trans. Intell. Veh. 2023, 9, 165–177. [Google Scholar] [CrossRef]
  14. Sun, Y.; Li, L.; Yan, B.; Yang, C.; Tang, G. A hybrid algorithm combining EKF and RLS in synchronous estimation of road grade and vehicle’ mass for a hybrid electric bus. Mech. Syst. Signal Process. 2016, 68, 416–430. [Google Scholar] [CrossRef]
  15. Yang, H.; Kim, B.; Oh, J.; Kim, G. Simultaneous estimation of vehicle mass and unknown road roughness based on adaptive extended Kalman filtering of suspension systems. Electronics 2022, 11, 2544. [Google Scholar] [CrossRef]
  16. Zhang, Z.; Yin, G.; Wu, Z. Joint estimation of mass and center of gravity position for distributed drive electric vehicles using dual robust embedded cubature kalman filter. Sensors 2022, 22, 10018. [Google Scholar] [CrossRef]
  17. Korayem, A.H.; Khajepour, A.; Fidan, B. Trailer mass estimation using system model-based and machine learning approaches. IEEE Trans. Veh. Technol. 2020, 69, 12536–12546. [Google Scholar] [CrossRef]
  18. Zhang, H.; Yang, Z.; Shen, J.; Long, Z.; Xiong, H. Dynamic mass estimation framework for autonomous vehicle system via bidirectional gated recurrent unit. IET Control Theory Appl. 2023, 18, 2624–2634. [Google Scholar] [CrossRef]
  19. Zhang, Y.; Zhang, Y.; Ai, Z.; Feng, Y.; Hu, Z. A cross iteration estimator with base vector for estimation of electric mining haul truck’s mass and road grade. IEEE Trans. Ind. Inform. 2018, 14, 4138–4148. [Google Scholar] [CrossRef]
  20. Gao, L.; Wu, Q.; He, Y. Road slope estimation for heavy-duty vehicles under the influence of multiple source factors in real complex road environments. Mech. Syst. Signal Process. 2024, 208, 110973. [Google Scholar] [CrossRef]
  21. Zhong, S.; Zhao, Y.; Ge, L.; Shan, Z.; Ma, F. Vehicle state and bias estimation based on unscented kalman filter with vehicle hybrid kinematics and dynamics models. Automot. Innov. 2023, 6, 571–585. [Google Scholar] [CrossRef]
  22. Ewering, J.; Ziaukas, Z.; Ehlers, S.F.; Seel, T. Reliable State Estimation in a Truck-Semitrailer Combination using an Artificial Neural Network-Aided Extended Kalman Filter. In Proceedings of the 2024 European Control Conference (ECC), Stockholm, Sweden, 25–28 June 2024; pp. 456–463. [Google Scholar]
  23. Nam, K.; Oh, S.; Fujimoto, H.; Hori, Y. Estimation of sideslip and roll angles of electric vehicles using lateral tire force sensors through RLS and Kalman filter approaches. IEEE Trans. Ind. Electron. 2012, 60, 988–1000. [Google Scholar] [CrossRef]
  24. Saadeddin, K.; Abdel-Hafez, M.F.; Jarrah, M.A. Estimating vehicle state by GPS/IMU fusion with vehicle dynamics. J. Intell. Robot. Syst. 2014, 74, 147–172. [Google Scholar] [CrossRef]
  25. Wang, F.; Yin, G.; Shen, T.; Ren, Y.; Wang, Y.; Feng, B. Nonlinear Robust Hybrid Estimation of Centroid Sideslip Angle and Tire Lateral Forces for Four-wheel-drive Electric Vehicles. China Mech. Eng. 2022, 33, 2673. [Google Scholar]
  26. Yang, X.; Wu, C.; He, Y.; Lu, X.; Chen, T. A dynamic rollover prediction index of heavy-duty vehicles with a real-time parameter estimation algorithm using NLMS method. IEEE Trans. Veh. Technol. 2022, 71, 2734–2748. [Google Scholar] [CrossRef]
  27. Zhao, J.; Mili, L. A robust generalized-maximum likelihood unscented Kalman filter for power system dynamic state estimation. IEEE J. Sel. Top. Signal Process. 2018, 12, 578–592. [Google Scholar] [CrossRef]
  28. Katriniok, A.; Abel, D. Adaptive EKF-based vehicle state estimation with online assessment of local observability. IEEE Trans. Control Syst. Technol. 2015, 24, 1368–1381. [Google Scholar] [CrossRef]
Figure 1. Bus Longitudinal Dynamics Model.
Figure 1. Bus Longitudinal Dynamics Model.
Sensors 25 01741 g001
Figure 2. Vehicle mass estimation process based on EKF algorithm.
Figure 2. Vehicle mass estimation process based on EKF algorithm.
Sensors 25 01741 g002
Figure 3. Hybrid algorithm architecture for vehicle mass estimation.
Figure 3. Hybrid algorithm architecture for vehicle mass estimation.
Sensors 25 01741 g003
Figure 4. The process of proportional coordination factor with speed.
Figure 4. The process of proportional coordination factor with speed.
Sensors 25 01741 g004
Figure 5. The results of vehicle mass estimation under no-load condition: (a) Vehicle Mass Estimation Results; (b) Engine torque; (c) Vehicle speed; (d) Longitudinal acceleration.
Figure 5. The results of vehicle mass estimation under no-load condition: (a) Vehicle Mass Estimation Results; (b) Engine torque; (c) Vehicle speed; (d) Longitudinal acceleration.
Sensors 25 01741 g005
Figure 6. The results of vehicle mass estimation under half-load condition.
Figure 6. The results of vehicle mass estimation under half-load condition.
Sensors 25 01741 g006
Figure 7. The results of vehicle mass estimation under full-load conditions.
Figure 7. The results of vehicle mass estimation under full-load conditions.
Sensors 25 01741 g007
Table 1. Basic parameters of the test.
Table 1. Basic parameters of the test.
ParametersUnitValue
Vehicle mass (full-load)kg13,000
Vehicle mass (half-load)kg10,000
Vehicle mass (no-load)kg7000
Coefficient of air resistance CD-0.69
Windward area Am/s27.9
Air density ρKg/m31.206
Effective tire radius rm0.49
Coefficients of rolling resistance f 0.0005
Axle ratio i0-3.545
Mechanical efficiency η-0.95
Forgetting factor λ-0.999
Table 2. RMSE of different methods in no-load, half-load, and full-load state.
Table 2. RMSE of different methods in no-load, half-load, and full-load state.
ConditionMethodsRMSE (kg)Computational
Efficiency (s)
no-loadRobust FFRLS324.739.2
EKF299.2612.3
Hybrid algorithm273.8412.5
half-loadRobust FFRLS589.279.0
EKF389.1613.1
Hybrid algorithm100.9513.6
full-loadRobust FFRLS718.439.4
EKF275.4612.9
Hybrid algorithm228.9113.7
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

Du, J.; Wang, Q.; Yuan, X. Estimating Bus Mass Using a Hybrid Approach: Integrating Forgetting Factor Recursive Least Squares with the Extended Kalman Filter. Sensors 2025, 25, 1741. https://doi.org/10.3390/s25061741

AMA Style

Du J, Wang Q, Yuan X. Estimating Bus Mass Using a Hybrid Approach: Integrating Forgetting Factor Recursive Least Squares with the Extended Kalman Filter. Sensors. 2025; 25(6):1741. https://doi.org/10.3390/s25061741

Chicago/Turabian Style

Du, Jingyang, Qian Wang, and Xiaolei Yuan. 2025. "Estimating Bus Mass Using a Hybrid Approach: Integrating Forgetting Factor Recursive Least Squares with the Extended Kalman Filter" Sensors 25, no. 6: 1741. https://doi.org/10.3390/s25061741

APA Style

Du, J., Wang, Q., & Yuan, X. (2025). Estimating Bus Mass Using a Hybrid Approach: Integrating Forgetting Factor Recursive Least Squares with the Extended Kalman Filter. Sensors, 25(6), 1741. https://doi.org/10.3390/s25061741

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