Next Article in Journal
CCESC: A Crisscross-Enhanced Escape Algorithm for Global and Reservoir Production Optimization
Previous Article in Journal
Bio-Inspired Design of Mechanical Properties of Hybrid Topological Cellular Honeycomb Structures
 
 
Font Type:
Arial Georgia Verdana
Font Size:
Aa Aa Aa
Line Spacing:
Column Width:
Background:
Article

Real-Time Cascaded State Estimation Framework on Lie Groups for Legged Robots Using Proprioception

School of Mechatronical Engineering, Beijing Institute of Technology, Beijing 100811, China
*
Author to whom correspondence should be addressed.
Biomimetics 2025, 10(8), 527; https://doi.org/10.3390/biomimetics10080527
Submission received: 15 July 2025 / Revised: 6 August 2025 / Accepted: 7 August 2025 / Published: 12 August 2025
(This article belongs to the Section Locomotion and Bioinspired Robotics)

Abstract

This paper proposes a cascaded state estimation framework based on proprioception for robots. A generalized-momentum-based Kalman filter (GMKF) estimates the ground reaction forces at the feet through joint torques, which are then input into an error-state Kalman filter (ESKF) to obtain the robot’s prior state estimate. The system’s dynamic equations on the Lie group are parameterized using canonical coordinates of the first kind, and variations in the tangent space are mapped to the Lie algebra via the inverse of the right trivialization. The resulting parameterized system state equations, combined with the prior estimates and a sliding window, are formulated as a moving horizon estimation (MHE) problem, which is ultimately solved using a parallel real-time iteration (Para-RTI) technique. The proposed framework operates on manifolds, providing a tightly coupled estimation with higher accuracy and real-time performance, and is better suited to handle the impact noise during foot–ground contact in legged robots. Experiments were conducted on the BQR3 robot, and comparisons with measurements from a Vicon motion capture system validate the superiority and effectiveness of the proposed method.

1. Introduction

Legged robots have witnessed rapid advancements in recent years. Compared to traditional wheeled and tracked robots, their superior mobility and obstacle-negotiation capabilities exhibit significant potential across various task scenarios such as patrolling, search and rescue, and transportation [1,2,3]. State estimation plays a crucial role in the operations of legged robots. Accurate state estimation not only provides precise coordinates within the global frame but also supplies smooth and accurate signals to the controller. However, because legged robots are complex electromechanical systems, their variable working environments, continuous multi-support movement characteristics, underactuation, and nonlinear system properties pose considerable challenges to state estimation.
Various methods have been applied to the state estimation problem in legged robots. The Extended Kalman Filter (EKF) has been introduced for its lightweight nature and robustness; for instance, Sola et al. developed a quaternion-based QEKF [4]. Hartley, taking into account the right-invariant properties on Lie groups, developed a contact-aided invariant Extended Kalman Filter (IEKF) [5]. Li further incorporated dynamic characteristics into this framework, enhancing the estimator’s adaptability to contact slippage [6]. However, Kalman filter-based methods can only handle Gaussian noise and cannot adequately address constraints. Consequently, optimization-based tightly coupled methods have been introduced. Wisth et al. developed a state estimation framework based on factor graphs, which is often used for processing information from external sensors such as vision [7]. Although integrating multiple sensors brings excellent estimation performance, it also incurs high computational costs, posing challenges to real-time applications [8,9]. In addition, external sensors may be unstable and are prone to being affected by the environment. For example, under adverse weather conditions such as heavy rain, thick fog, and heavy snow, the accuracy of optical sensors will decrease because the propagation of light is hindered, resulting in blurred images or data being obtained. Therefore, proprioceptive estimation remains necessary [10].
Moving horizon estimation is the dual problem of Model Predictive Control (MPC) [11]. It integrates the system model over a finite past time horizon and fuses all observational information within this horizon to obtain the optimal state estimate sequence [12,13]. This method can handle non-Gaussian noise and constraints, making it well-suited for legged robots with frequent contact switches, thereby reducing noise impact at the moments of ground contact. While MHE theory has been extensively studied, its application to legged robots remains limited. For example, Khorshidi combined Dynamic Mode Decomposition (DMD) with MHE to estimate the centroidal states of a quadruped robot, but this method relies on neural networks for estimating centroidal dynamics, making it challenging to apply at high update frequencies on real hardware [14]. Kang proposed a distributed state estimation method combining EKF and MHE, where the nonlinear parts are separately estimated. While this method is fast, it does not fully utilize the advantages of MHE [15].
In previous studies, Euler angles and quaternions were commonly used to describe rigid body motion [4,10]. However, Euler angles suffer from gimbal lock, and quaternions have the issue of double coverage. To overcome these limitations, Lie group representations have been introduced [16,17]. Nevertheless, the over-parameterization of rotation matrices makes it challenging to directly construct the state equations. In optimal control, error dynamics based on variational methods are often employed [18,19], but extending these methods to MHE is difficult. This paper employs canonical coordinates of the first kind on the Special Euclidean Group ( S E ( 3 ) ) to parameterize rigid body motion [20], which naturally avoids tensor usage while preserving structural properties. The Cayley transform, as a third-order approximation of the exponential map, ensures both computational efficiency and sufficient accuracy.
MHE, being an optimization-based tightly coupled method, relies heavily on solving speed and update frequency for its performance. In nonlinear Model Predictive Control (NMPC), methods such as sequential quadratic programming (SQP) [21,22] and real-time iteration (RTI) [23,24,25] have been widely explored for real-time optimization, and these methods can easily be extended to MHE. RTI, known for its strong real-time capability, has already been shown to offer optimality under certain conditions.
The main contribution of this paper is the introduction of a proprioceptive tightly coupled state estimation framework based on Lie group representations. The framework first uses an ESKF to provide prior estimates of the robot’s state, followed by MHE to obtain the final state estimation. Our ESKF incorporates joint torque information, which not only improves the estimation accuracy compared to existing methods but also allows for the estimation of external forces acting on the robot. MHE is formulated using canonical coordinates of the first kind based on the Cayley transform in the right-trivialized tangent space of S E ( 3 ) , combining past observations and prior information from the ESKF to achieve tightly coupled estimation. To further reduce the delay caused by optimization, we propose a parallel RTI method, enabling high-speed state updates. Finally, experiments conducted on the BQR3 robot validate the effectiveness and superiority of the proposed method.
The paper is structured as follows. The system modeling on Lie group is described in Section 2. The prior estimation method of ESKF incorporating torque information is presented in Section 3. Section 4 discusses the implementation of the tightly coupled MHE framework and the Para-RTI solution method. Furthermore, Section 5 conducts experimental validation of the proposed framework, and finally the paper is concluded in Section 6.

2. System Modeling Using Canonical Coordinates of the First Kind

2.1. Cayley Map and Right-Trivialized Tangent

For dynamical systems, their configuration space can be represented on a Lie group G, with the corresponding tangent space referred to as the Lie algebra g . The Lie algebra can be mapped from the vector space R n using the hat operator · ^ : R n g , and the inverse mapping is represented by the vee map · : g R n . Retraction maps φ : g G are used to relate the Lie group to its corresponding Lie algebra and can be written as
g = φ ( ρ ^ )
where g G and ρ R 6 .
The exponential map exp can be used as a kind of retraction map, which is also called canonical coordinates of the first kind. The exponential map provides an exact representation of rigid body motion on a Lie group. However, due to its computational complexity, this paper considers a third-order approximation cay ( ρ ^ ) = exp ( ρ ^ ) + O ρ ^ 3 (which is only valid for the rigid motion groups like the Special Orthogonal Group ( S O ( 3 ) ) and S E ( 3 ) ), and the Cayley map is defined as follows:
g = cay ( ρ ^ ) = I ρ ^ / 2 1 I + ρ ^ / 2
ρ ^ = cay 1 ( g ) = 2 g I g + I 1
where I is the identity matrix.
The Cayley map does not involve transcendental functions and is easier to differentiate. For the twist ξ R n on the group, it has the Poisson relation g ˙ = g ξ ^ which is a differential equation. To solve the differential equation, use right-trivialized tangent d φ ρ : g T g G (Tangent space on g):
ξ ^ = g 1 g ˙ = g 1 d d t cay ( ρ ^ ) = g 1 cay ( ρ ^ ) dcay ρ ( ρ ^ ˙ ) = cay 1 ( ρ ^ ) cay ( ρ ^ ) dcay ρ ( ρ ^ ˙ ) = dcay ρ ( ρ ^ ˙ )
where d d t cay ( ρ ^ ) = cay ( ρ ^ ) dcay ρ ( ρ ^ ˙ ) is derived from the chain rule.
Then the local reconstruction equation can be obtained from the inverse of Equation (4):
ρ ^ ˙ = dcay ρ 1 ( ξ ^ )
The system model and mapping relationships on the manifold are illustrated in Figure 1.

2.2. Configuration of Rigid Body on Lie Groups

In our case, the rigid body motion evolves on the Special Euclidean group S E ( 3 ) , which represents the set of all rigid body transformations in three-dimensional space. It is a Lie group that combines rotation and translation, and it can be expressed as
T = r p 0 1 S E ( 3 )
where R is a rotation matrix in the Special Orthogonal Group S O ( 3 ) , and p R 3 is a translation vector. The tangent vector field at the identity element of a Lie group G is defined as the Lie algebra g .
For T S E ( 3 ) , the corresponding Lie algebra can be expressed in the following form:
ρ ^ = θ × r 0 0 se ( 3 ) , θ × = 0 θ 3 θ 2 θ 3 0 θ 1 θ 2 θ 1 0
where θ R 3 and r R 3 , while the operator · × : R 3 so ( 3 ) denotes the skew-symmetric matrix that maps from the Lie algebra to the vector space.
Because se ( 3 ) is obviously diffeomorphic to R 6 , we can get the parameterized equation from Equation (5):
ρ ˙ = dcay ρ 1 ( ξ ) , ρ = θ r R 6 , ξ = ω v R 6
where θ R 3 and r R 3 are angular and linear velocity, respectively, and the inverse Cayley tangent can be derived simply as [20]
dcay ( θ , r ) 1 = I 3 1 2 θ × + 1 4 θ θ T 0 3 1 2 I 3 1 2 θ × r × I 3 1 2 θ ×
The dynamic equation of a rigid body on S E ( 3 ) can be described by the Euler–Poincaré equation:
ξ ˙ = J b 1 ( ad ξ * J b ξ + u )
where J b is the mass–inertia matrix composed by inertia matrix I and mass m
J b = I b 0 0 m I 3 R 6 × 6
u is the system input and ad ξ is called the adjoint operator and is given by
ad ξ * = ad ξ T = ω × v × 0 ω ×
Combining Equation (8) and Equation (10), we can obtain the complete system equation of state:
x ˙ = ρ ˙ ξ ˙ = dcay ρ 1 ( ξ ) J b 1 ( ad ξ J b ξ + u ) f ( x , u )
Optimization problems for nonlinear models are often solved by linearizing the system state equations to the first order as follows:
x ˙ = A x + B u
where
A = f ( x , u ) x = dcay ρ 1 ξ ρ dcay ρ 1 0 J b 1 A d ξ T J b ξ ξ B = f ( x , u ) u = 0 J b 1

3. Error-State Kalman Filter with Joint Torque

In the previous section, we derived the state equations of the system. However, when modeling actual dynamical systems, it is essential to account for additional factors such as system noise. Within the framework proposed in this paper, it is necessary to model not only the basic state information but also the sensor noise and biases. Moreover, the identification of inputs to the dynamical system becomes crucial with the incorporation of dynamics. This section presents an estimator based on the ESKF to estimate the biases of the robot’s sensors and the external wrench acting on it.

3.1. GRF Reconstruction

Dynamical systems are typically complex and nonlinear, making it crucial to accurately account for system dynamics to achieve precise state estimation. In this paper, we simplify the dynamical system of a legged robot to a single rigid body model. The input u is a six-dimensional force vector [ M x , M y , M z , F x , F y , F z ] T acting on the torso, which generally consists of contact forces and gravitational forces. Contact forces arise from interactions with the environment, including the ground reaction forces (GRF) f c = [ f c x , f c y , f c z ] T at the foot and external interaction wrench u e = [ M e x , M e y , M e z , F e x , F e y , F e z ] T . Therefore, u in Equation (14) can be rewritten as
u = i = 1 n r i × I f c , i + u e + 0 m g
where g = [ 0 , 0 , 9.8 ] T is the gravity vector and n is the number of stance legs.
The reconstruction of GRF can be achieved through a Kalman filter using the generalized momentum equation for a single leg, which can be expressed as
h ˙ C ( q , q ˙ ) T q ˙ + G ( q ) = τ + J c T f c
where h = M ( q ) q ˙ is the generalized momentum, and M ( q ) , C ( q , q ˙ ) , and g ( q ) are the inertia matrix, Coriolis matrix, and gravity matrix, respectively. q and q ˙ are the joint position and joint velocity. τ is the vector of the actuated joint torques, and J c is the corresponding Jacobian.
The GRF can be modeled as random walk process f c ˙ = n f and n f is the Gaussian noise. The leg model can be obtained as
h ˙ f c ˙ = 0 J c T 0 0 A c h f c + I 0 B c u + n h
where u = C ( q , q ˙ ) T q ˙ G ( q ) + τ includes all the nonlinear dynamics.
As the generalized momentum h can be measured from joint encoders and with the high transparency joint, the GRF measurement can be obtained from joint torque. The measurement model can be defined as
h m f m z = H x + n m
where H is an identity matrix and n m is the Gaussian noise.
With Equations (18) and (19), the GRF f c can be obtained from a standard Kalman filter.
In practical applications, most mainstream legged robots today are equipped with high-performance planetary gearboxes, typically with a reduction ratio below 30. Extensive experimental evidence has shown that such gearboxes, when operating at low reduction ratios, can effectively reduce gearbox friction and non-ideal actuator effects, thus achieving high torque control transparency. Therefore, in the process of joint torque estimation and GRF reconstruction, it is reasonable to approximate that the output joint torque closely corresponds to the actual force applied.

3.2. Error-State Kalman Filter

Consider the equations of motion of a rigid body on the S E ( 3 ) group, which, unlike the modeling in vector space in the previous section, can be written as
g ˙ = g ξ ^ ξ ˙ = J b 1 ( ad ξ * J b ξ + u )
To incorporate the biases of the accelerometer and gyroscope in the IMU, as well as the external wrench acting on the system, the true state variables of the system can be expanded as
s : = g , ξ , B , u e
By modeling the biases and external wrench as random walk processes, the system’s true state equations can be formulated to reflect these stochastic components as follows:
g ˙ = g ξ ^ ξ ˙ = J b 1 ( ad ξ * J b ξ + u c + u e + u g ) + n u c b ˙ = n b u ˙ e = n u e
where n u c , n b , and n u e are the corresponding Gaussian noise.
Considering that the prediction in Kalman filter occurs only within a single time step, we approximate the infinitesimal transformation on the Lie group to linearize the system state equations:
δ g = d d ϵ ϵ = 0 g exp ( ϵ δ ζ ^ ) = g δ ζ ^
Using the feature of skew-symmetric matrix, a × b = a × b = b × a = b × a , a , b R 3 , the error-state model can be derived as
δ ζ ˙ δ ξ ˙ δ b ˙ δ u ˙ e = ad ξ I 0 0 0 J b 1 ( C ad ξ * J b ) 0 J b 1 0 0 0 0 0 0 0 0 δ ζ δ ξ δ b δ u e + 0 n u c n b n u e
where
C = ( I b ω ) × m v × m v × 0
Equation (24) can be easily rewritten to the discrete linearized form by using the forward Euler method. Then the error-state estimation is
δ s k = K k z k h s k
where
z k h s k = a m u c + u g + u e m + b a ω m ω + b g v m v log ( g 1 g m )
Then the measurement matrix H k can be derived by using the chain rule. The implementation details of the ESKF are given in Algorithm 1.
Algorithm 1 Error-state Kalman filter with joint torque.
Initialize the state variable and covariance matrix
s ˜ 0 = 0 , P ˜ 0 = I
repeat
   Compute state
    δ s k = A e , k δ s ˜ k 1
   Compute covariance estimation
    P k = A e , k P ˜ k 1 A e , k T + Q k
   Compute optimal Kalman gain
    K k = P k H k T H k P k H k T + R k 1
   Update state estimation with measurement
    δ s ˜ k = K k z k h ( s k )
   Update covariance estimation
    P ˜ k = I K k H k P k
until stop

4. MHE with Para-RTI

To enable accurate and real-time state estimation for nonlinear systems under constraints, MHE has emerged as a powerful optimization-based framework. However, its practical deployment is often hindered by high computational demands, especially in fast-sampling or resource-limited scenarios. To address this issue, we adopt an efficient implementation of MHE based on the parallelizable real-time iteration (Para-RTI) scheme, which exploits parallel computation across the estimation horizon to significantly reduce latency while preserving estimation accuracy. The whole state estimation framework is shown in Figure 2.

4.1. MHE

Although Kalman filter is simple and effective, with the advancement of onboard computational power, state estimation problems are no longer satisfied with using only the Kalman filter. Optimization-based methods can better handle complex nonlinear systems, constraints, and non-Gaussian noise, and they also facilitate multi-sensor fusion. Optimization-based methods can be seen as solving the Maximum A Posteriori (MAP) problem, where MHE achieves state estimation by minimizing a cost function over a finite time window. MHE is a recursive implementation of MAP estimation and can be written as
min X [ 0 : n ] 1 2 x 0 x ˜ 0 Q 2 + k = 0 n 1 1 2 e x , k P x 2 + k = 0 n 1 2 e y , k P y 2
s . t . x k + 1 = f x k , u k + e x , k
y k = h x k , u k + e y , k
g x k , u k 0 , k = 0 , , n
where X 0 : n = [ x 0 : n , e x , 0 : n , e y , 0 : n ] is a sequence that contains all state variables and error terms within the finite horizon, n is the number of time steps, Q , P x , and P y are corresponding weight matrices. Equations (28b) and (28c) represent the state equation and observation equation as constraints, respectively, while Equation (28d) represents the inequality constraints. The first term of the cost function is typically referred to as the arrival cost. Here, x ˜ 0 is the prior estimate, which, in this paper, is updated using the state estimate from the ESKF designed in the previous section. The other terms are the running cost, which quantify the process error and measurement error.
Unlike the weighted matrices in MPC, which can be freely adjusted, the weighting matrices in MHE have a significant impact on the estimation results. They are typically inversely proportional to the noise covariance of the system. The noise covariance can be obtained from the Kalman filter to ensure that the final estimation result approximates the maximum likelihood estimate.

4.2. Para-RTI

Nonlinear models typically impose significant computational burdens on the solution of MHE. As the dual problem of MPC, the solution methodologies for NMPC have become relatively mature, and the efficacy of RTI techniques has been validated. In this paper, we extend the application of RTI to the solution of MHE. RTI can be viewed as a specialized application of SQP. By performing a first-order linearization of the nonlinear system model and compressing the problem into a quadratic programming (QP) subproblem, RTI executes a single Newton step at each sampling time. Each individual RTI step is divided into a preparation phase and a feedback phase.
Algorithm 2 Para-RTI: Parallel real-time iteration for nonlinear MHE.
1:Initialization: Initialize Kalman Filter (KF), Preparation Thread, and Estimation Thread
2:Main Thread:
3:while true do
4:   Run Kalman Filters to obtain prior estimate x ^ 0 , bias b , and external wrench u e
5:   Send KF results to Preparation Thread
6:   Wait for sensor measurements y k and send sensor measurements to Estimation Thread
7:   Receive estimated values from Estimation Thread
8:   Update system state with estimated values
9:end while
10:Preparation Thread:
11:while true do
12:   Wait for prior results x ˜ 0 from Main Thread
13:   Evaluate objective in Equation (28a), constraints in Equations (28b)–(28d), and sensitive matrices A , B in Equation (15)
14:   Store evaluation results for Estimation Thread
15:end while
16:Estimation Thread:
17:while true do
18:   Wait for sensor measurements y k from Main Thread
19:   Retrieve evaluation results from Preparation Thread
20:   Solve QP problem using evaluation results
21:   Send estimated values to Main Thread
22:end while
During the preparation phase, which is executed before new measurement data is acquired, the system model is linearized, and the solution from the previous time step is used as the initial guess. The entire Nonlinear Programming (NLP) problem is then constructed into a QP subproblem. The feedback phase, which occurs immediately after new measurement data is available, involves solving the previously constructed QP problem. The last element in the resulting solution sequence is taken as the current state estimate to be sent to the controller.
To further accelerate the update frequency of MHE, we propose a Para-RTI method. Para-RTI is also divided into a preparation phase and an estimation phase. However, unlike standard RTI, the preparation and estimation phases are executed in two separate threads outside the main thread. A high-real-time Kalman Filter runs in the main thread, calculating the prior estimate, bias, and external wrench in each cycle. The preparation thread obtains the Kalman Filter results from the main thread in each cycle, and evaluates the objective, constraints, and corresponding sensitivities. The estimation thread then solves the QP problem using the results from the preparation thread each time sensor measurements are received from the main thread, and the estimated values are sent back to the main thread. The continuous execution of Para-RTI compresses the estimation time to the QP problem-solving time, thereby enhancing the estimation speed of NMHE. The structure of Para-RTI is shown in Figure 3.
In this paper, Equation (28b) adopts the linearized form presented in Equation (14), with the input u being computed within ESKF. Additionally, the observation equation incorporates the computed biases as
cay 1 ( g m , k ) ξ m , k + b g , k = ρ k ξ k
Without inequality constraints, the QP subproblem has the standard form as
min 1 2 X H X + h X s . t . C X = D .

5. Experiments

Experiments were conducted on a quadruped robot named BQR3, which weighs 50 kg and measures 0.8 m in length and 0.5 m in height. It is equipped with 12 joints, each integrated with absolute encoders, and an MTi-300 IMU mounted at the center of the torso. Thanks to the high transmission transparency of the joints, joint torques can be computed in real time using actuator current feedback. The proposed framework was deployed on a mini PC (SER07) powered by an AMD Ryzen R7 7840HS CPU (P-core 5.10 GHz, E-core 3.80 GHz).
To evaluate estimation accuracy, a Vicon motion capture system was used to record the absolute position and orientation of the robot’s center of mass.
Two sets of experiments were conducted: circular walking without disturbance (Figure 4) and with external disturbances (Figure 5). All experiments were carried out on a flat terrain within a confined area. The robot was teleoperated using velocity commands, including sudden stops and acceleration/deceleration. In disturbance experiments, random external perturbations were applied via a rope attached to the torso. The robot was controlled by an NMPC controller running at 200 Hz, the ESKF operated at 1000 Hz, and, enabled by the proposed parallel computing framework, and the MHE state estimator was updated at 333 Hz with a prediction horizon of 25 steps.
While many modern embedded platforms (such as those running Linux, RTOS, or equipped with multi-core processors) do support multi-threading, their computational resources and memory are usually much more limited compared to desktop systems. Multi-threading may introduce overhead from context switching and resource contention, and careful scheduling is needed to ensure that real-time performance is not compromised. For resource-constrained embedded platforms, it is often preferable to adopt state estimation methods with lower computational requirements, such as Kalman filter-based approaches, or to use the original RTI method instead of the parallelized Para-RTI scheme. These alternatives can help ensure reliable and timely state estimation without overloading the system.
To validate the superiority and effectiveness of the proposed method, comparisons were made not only with Vicon-based ground truth but also with ESKF and the IEKF method from [5]. Figure 6 presents the absolute position estimation results from different estimators under both experimental conditions. It is noteworthy that the ESKF output serves as prior input to the MHE, and the MHE weighting is set as the inverse of the ESKF noise covariance.
Figure 6a shows results under undisturbed conditions, including time-series data of the x and y positions and the 2D trajectory. The z-direction is not shown, as vertical drift is unacceptable for quadruped robots and is typically compensated using a weighted average of kinematic foot positions. The vertical position of the robot’s base is recalibrated at each step by computing a weighted average of the positions of the stance foot ends, ensuring that the base height is consistent with the ground contact constraints. The corresponding equation is as follows:
z base = 1 n i = 1 n · z foot , i
where w i is the weight for the i-th stance foot (with w i = 1 ), and z foot , i is the vertical position of the i-th stance foot end. This description has been integrated into the methodology for reproducibility.
Compared with the Vicon ground truth, the proposed method demonstrates superior tracking accuracy. ESKF and IEKF, due to their single-step optimal estimation nature, struggle to handle impact-induced noise during foot contact. Since the proposed state estimation framework relies entirely on proprioceptive sensors, drift is inevitable. Nevertheless, the MHE-based method achieves significantly lower drift levels.
Figure 6b presents the position estimation results under external disturbances, with the perturbed periods highlighted in pink. Compared to the undisturbed case, drift is more pronounced, but the proposed method still maintains higher accuracy and stronger robustness against disturbances.
Figure 7 compares the velocity estimation in three directions. As Vicon cannot directly measure velocity, ground truth was obtained by differentiating position data. Under disturbance conditions, the ground truth exhibits substantial noise. All three estimators effectively track velocity and filter noise, with the proposed method showing significantly lower noise levels.
Figure 8 compares rotational estimation. Vicon represents orientation using quaternions, while our estimator is based on Lie group representations. For clearer comparison and interpretation, all results were converted into Euler angles. Since the experiments were performed on flat terrain, the roll and pitch angles remained nearly constant and are omitted. At the beginning of the motion, both estimators closely match the ground truth yaw angle. However, with extended operation, drift becomes inevitable, although the proposed method exhibits slightly lower drift.
Figure 9 shows the computation time. With a rolling horizon of 25 steps, matrix preparation takes approximately 1.5 ms. The quadratic programming solver used is Proxsuite, with a typical solving time of around 2.5 milliseconds. To maintain a stable update rate for the state estimator, the computation is forcibly terminated if it exceeds 3 ms. In the original RTI method, the period is the sum of the preparation time and the solving time. In para-RTI, the period only depends on the solving time.
Table 1 presents the RMSE values of position, velocity, and orientation for the three methods across two different experiments. It can be seen that the proposed method achieves the lowest RMSE values in all cases.

6. Discussion

This paper presents a real-time proprioceptive state estimation framework for rigid body dynamics, formulated in the right trivialized tangent space of the S E ( 3 ) group using the Cayley transform. By integrating historical observation data with prior estimates from the ESKF, a receding horizon estimator is constructed, and the Para-RTI method is employed to efficiently update the nonlinear state estimates. Experimental results on a quadruped robot demonstrate that the proposed estimator effectively mitigates impact noise from ground contact and significantly reduces estimation drift. Furthermore, the framework exhibits strong potential for fusing multiple sensor inputs and incorporating physical constraints, providing a solid foundation for future research.
Nevertheless, long-term drift remains an inherent limitation of proprioceptive state estimation, primarily due to IMU integration errors and the cumulative effects of minor slippages during foot–ground impacts. The proposed method offers stability in scenarios where external sensing is limited, enabling the robot to maintain autonomous perception even in challenging environments. However, all current experiments are conducted indoors within a fixed area due to motion capture system constraints. In future work, we will further validate the effectiveness of the proposed approach in outdoor environments and incorporate neural network-based terrain estimation algorithms to enhance the robustness of the system. Overall, the results indicate that the proposed framework is a promising solution for robust and accurate state estimation in legged robots, especially under conditions with limited external sensing.

Author Contributions

B.L. conceived the idea and designed the experiments. F.M. supervised the project and provided critical feedback. Z.Z. and M.W. conducted the experiments and collected the data. T.W. contributed to the data analysis and interpretation. X.C. and Z.Y. assisted in reviewing the manuscript and provided additional technical support. All authors have read and agreed to the published version of the manuscript.

Funding

This work was supported by the National Natural Science Foundation of China under Grant No. 62088101.

Data Availability Statement

The original contributions presented in this study are included in the article. Further inquiries can be directed to the corresponding author.

Conflicts of Interest

The authors declare that they have no competing interests.

References

  1. Du, W.; Fnadi, M.; Benamar, F. Rolling based locomotion on rough terrain for a wheeled quadruped using centroidal dynamics. Mech. Mach. Theory 2020, 153, 103984. [Google Scholar] [CrossRef]
  2. Xu, K.; Wang, S.; Shi, L.; Li, J.; Yue, B. Horizon-stability control for wheel-legged robot driving over unknow, rough terrain. Mech. Mach. Theory 2025, 205, 105887. [Google Scholar] [CrossRef]
  3. Chen, L.; Ye, S.; Sun, C.; Zhang, A.; Deng, G.; Liao, T.; Sun, J. CNNs based foothold selection for energy-efficient quadruped locomotion over rough terrains. In Proceedings of the 2019 IEEE International Conference on Robotics and Biomimetics (ROBIO), Dali, China, 6–8 December 2019; pp. 1115–1120. [Google Scholar]
  4. Sola, J. Quaternion kinematics for the error-state Kalman filter. arXiv 2017, arXiv:1711.02508. [Google Scholar] [CrossRef]
  5. Hartley, R.; Ghaffari, M.; Eustice, R.M.; Grizzle, J.W. Contact-Aided Invariant Extended Kalman Filtering for Robot State Estimation. Int. J. Robot. Res. 2020, 39, 402–430. [Google Scholar] [CrossRef]
  6. Li, J.; Yuan, Z.; Sang, X.; Zhou, Q.; Zhang, J. Center of Mass Dynamics and Contact-Aided Invariant Filtering for Biped Robot State Estimation. IEEE Sens. J. 2023, 23, 27531–27539. [Google Scholar] [CrossRef]
  7. Wisth, D.; Camurri, M.; Fallon, M. VILENS: Visual, Inertial, Lidar, and Leg Odometry for All-Terrain Legged Robots. IEEE Trans. Robot. 2023, 39, 309–326. [Google Scholar] [CrossRef]
  8. Kim, Y.; Yu, B.; Lee, E.M.; Kim, J.h.; Park, H.w.; Myung, H. STEP: State estimator for legged robots using a preintegrated foot velocity factor. IEEE Robot. Autom. Lett. 2022, 7, 4456–4463. [Google Scholar] [CrossRef]
  9. Kang, J.; Kim, H.; Kim, K.S. VIEW: Visual-Inertial External Wrench Estimator for Legged Robot. IEEE Robot. Autom. Lett. 2023, 8, 8366–8373. [Google Scholar] [CrossRef]
  10. Yang, S.; Zhang, Z.; Bokser, B.; Manchester, Z. Multi-IMU Proprioceptive Odometry for Legged Robots. In Proceedings of the 2023 IEEE/RSJ International Conference on Intelligent Robots and Systems (IROS), Detroit, MI, USA, 1–5 October 2023; pp. 774–779. [Google Scholar] [CrossRef]
  11. Vukov, M.; Gros, S.; Horn, G.; Frison, G.; Geebelen, K.; Jørgensen, J.; Swevers, J.; Diehl, M. Real-Time Nonlinear MPC and MHE for a Large-Scale Mechatronic Application. Control Eng. Pract. 2015, 45, 64–78. [Google Scholar] [CrossRef]
  12. López-Negrete, R.; Biegler, L.T. A moving horizon estimator for processes with multi-rate measurements: A nonlinear programming sensitivity approach. J. Process Control 2012, 22, 677–688. [Google Scholar] [CrossRef]
  13. Diehl, M.; Ferreau, H.J.; Haverbeke, N. Efficient Numerical Methods for Nonlinear MPC and Moving Horizon Estimation. In Nonlinear Model Predictive Control; Morari, M., Thoma, M., Magni, L., Raimondo, D.M., Allgöwer, F., Eds.; Springer: Berlin/Heidelberg, Germany, 2009; Volume 384, pp. 391–417. [Google Scholar] [CrossRef]
  14. Khorshidi, S.; Dawood, M.; Bennewitz, M. Centroidal State Estimation based on the Koopman Embedding for Dynamic Legged Locomotion. arXiv 2024, arXiv:2403.13366. [Google Scholar] [CrossRef]
  15. Kang, J.; Wang, Y.; Xiong, X. Fast Decentralized State Estimation for Legged Robot Locomotion via EKF and MHE. arXiv 2024, arXiv:2405.20567. [Google Scholar] [CrossRef]
  16. Sola, J.; Deray, J.; Atchuthan, D. A micro Lie theory for state estimation in robotics. arXiv 2018, arXiv:1812.01537. [Google Scholar]
  17. Mangiacapra, G.; Wittal, M.; Capello, E.; Nazari, M. Unscented Kalman Filter and Control on TSE(3) with Application to Spacecraft Dynamics. Nonlinear Dyn. 2022, 108, 2127–2146. [Google Scholar] [CrossRef]
  18. Teng, S.; Chen, D.; Clark, W.; Ghaffari, M. An Error-State Model Predictive Control on Connected Matrix Lie Groups for Legged Robot Control. arXiv 2023, arXiv:2203.08728. [Google Scholar] [CrossRef]
  19. Agrawal, A.; Chen, S.; Rai, A.; Sreenath, K. Vision-Aided Dynamic Quadrupedal Locomotion on Discrete Terrain Using Motion Libraries. arXiv 2022, arXiv:2110.00891. [Google Scholar] [CrossRef]
  20. Müller, A. Review of the exponential and Cayley map on SE (3) as relevant for Lie group integration of the generalized Poisson equation and flexible multibody systems. Proc. R. Soc. A 2021, 477, 20210303. [Google Scholar] [CrossRef]
  21. Torrisi, G.; Grammatico, S.; Smith, R.S.; Morari, M. A Variant to Sequential Quadratic Programming for Nonlinear Model Predictive Control. In Proceedings of the 2016 IEEE 55th Conference on Decision and Control (CDC), Las Vegas, NV, USA, 12–14 December 2016; pp. 2814–2819. [Google Scholar] [CrossRef]
  22. Verschueren, R. Convex Approximation Methods for Nonlinear Model Predictive Control. Doctoral Dissertation, Albert-Ludwigs-Universität Freiburg im Breisgau, Freiburg, Germany, 2018. [Google Scholar]
  23. Gros, S.; Zanon, M.; Quirynen, R.; Bemporad, A.; Diehl, M. From Linear to Nonlinear MPC: Bridging the Gap via the Real-Time Iteration. Int. J. Control 2020, 93, 62–80. [Google Scholar] [CrossRef]
  24. Hespanhol, P.; Quirynen, R. A Real-Time Iteration Scheme with Quasi-Newton Jacobian Updates for Nonlinear Model Predictive Control. In Proceedings of the 2018 European Control Conference (ECC), Limassol, Cyprus, 12–15 June 2018; pp. 1517–1522. [Google Scholar] [CrossRef]
  25. Nurkanović, A.; Zanelli, A.; Albrecht, S.; Frison, G.; Diehl, M. Contraction Properties of the Advanced Step Real-Time Iteration for NMPC. IFAC-PapersOnLine 2020, 53, 7041–7048. [Google Scholar] [CrossRef]
Figure 1. Illustration of the system model on manifold. The system model evolves on the manifold S E ( 3 ) , denoted as G. The rigid body motion is mapped to the Lie algebra g through the Cayley map. dcay 1 maps the variations in the tangent space of the Lie group back to the Lie algebra, thereby parameterizing the system dynamics, which evolve on the Lie algebra. The parameterized system state is then mapped to Euclidean space via the vee map.
Figure 1. Illustration of the system model on manifold. The system model evolves on the manifold S E ( 3 ) , denoted as G. The rigid body motion is mapped to the Lie algebra g through the Cayley map. dcay 1 maps the variations in the tangent space of the Lie group back to the Lie algebra, thereby parameterizing the system dynamics, which evolve on the Lie algebra. The parameterized system state is then mapped to Euclidean space via the vee map.
Biomimetics 10 00527 g001
Figure 2. Cascaded state estimate framework. The joint torques from the robot are input into the first stage of the GMKF to compute the ground reaction forces at the feet. The resulting forces, along with kinematic data and IMU information, are then fed into the ESKF. The system’s prior state estimate, together with historical measurement data from the sliding window, is formulated as an MHE problem. Finally, the Para-RTI method is employed to solve the optimization problem, enabling high-speed updates of the state estimates.
Figure 2. Cascaded state estimate framework. The joint torques from the robot are input into the first stage of the GMKF to compute the ground reaction forces at the feet. The resulting forces, along with kinematic data and IMU information, are then fed into the ESKF. The system’s prior state estimate, together with historical measurement data from the sliding window, is formulated as an MHE problem. Finally, the Para-RTI method is employed to solve the optimization problem, enabling high-speed updates of the state estimates.
Biomimetics 10 00527 g002
Figure 3. The working principle of Para-RTI and comparison with standard RTI.
Figure 3. The working principle of Para-RTI and comparison with standard RTI.
Biomimetics 10 00527 g003
Figure 4. Experiment without disturbance snapshot. The robot operates within a 4 × 4 m area, and an external motion capture system composed of six Vicon cameras is used to obtain the robot’s position and orientation measurements.
Figure 4. Experiment without disturbance snapshot. The robot operates within a 4 × 4 m area, and an external motion capture system composed of six Vicon cameras is used to obtain the robot’s position and orientation measurements.
Biomimetics 10 00527 g004
Figure 5. Experiment with disturbance snapshot.
Figure 5. Experiment with disturbance snapshot.
Biomimetics 10 00527 g005
Figure 6. The comparison of absolute positions in the space. (a) shows results under undisturbed conditions, (b) presents the position estimation results under external disturbances.
Figure 6. The comparison of absolute positions in the space. (a) shows results under undisturbed conditions, (b) presents the position estimation results under external disturbances.
Biomimetics 10 00527 g006
Figure 7. The comparison of absolute positions in the space.
Figure 7. The comparison of absolute positions in the space.
Biomimetics 10 00527 g007
Figure 8. The comparison of absolute positions in the space.
Figure 8. The comparison of absolute positions in the space.
Biomimetics 10 00527 g008
Figure 9. The comparison of absolute positions in the space.
Figure 9. The comparison of absolute positions in the space.
Biomimetics 10 00527 g009
Table 1. RMSE comparison.
Table 1. RMSE comparison.
ProposedESKFIEKF
Position RMSE w/o disturbance (m)0.02920.04720.0539
Velocity RMSE w/o disturbance (m/s)0.05650.05920.0594
Angle RMSE w/o disturbance (rad)0.03760.06840.0687
Position RMSE w/ disturbance (m)0.12780.16010.1841
Velocity RMSE w/ disturbance (m/s)0.12320.12680.1262
Angle RMSE w/ disturbance (rad)0.06770.11650.1085
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

Liu, B.; Meng, F.; Zhang, Z.; Wang, M.; Wang, T.; Chen, X.; Yu, Z. Real-Time Cascaded State Estimation Framework on Lie Groups for Legged Robots Using Proprioception. Biomimetics 2025, 10, 527. https://doi.org/10.3390/biomimetics10080527

AMA Style

Liu B, Meng F, Zhang Z, Wang M, Wang T, Chen X, Yu Z. Real-Time Cascaded State Estimation Framework on Lie Groups for Legged Robots Using Proprioception. Biomimetics. 2025; 10(8):527. https://doi.org/10.3390/biomimetics10080527

Chicago/Turabian Style

Liu, Botao, Fei Meng, Zhihao Zhang, Maosen Wang, Tianqi Wang, Xuechao Chen, and Zhangguo Yu. 2025. "Real-Time Cascaded State Estimation Framework on Lie Groups for Legged Robots Using Proprioception" Biomimetics 10, no. 8: 527. https://doi.org/10.3390/biomimetics10080527

APA Style

Liu, B., Meng, F., Zhang, Z., Wang, M., Wang, T., Chen, X., & Yu, Z. (2025). Real-Time Cascaded State Estimation Framework on Lie Groups for Legged Robots Using Proprioception. Biomimetics, 10(8), 527. https://doi.org/10.3390/biomimetics10080527

Article Metrics

Back to TopTop