Abstract

The primary goal of this paper is to develop a formal foundation to design nonlinear feedback control algorithms that intrinsically couple legged robots with bio-inspired tails for robust locomotion in the presence of external disturbances. We present a hierarchical control scheme in which a high-level and real-time path planner, based on an event-based model predictive control (MPC), computes the optimal motion of the center of mass (COM) and tail trajectories. The MPC framework is developed for an innovative reduced-order linear inverted pendulum (LIP) model that is augmented with the tail dynamics. At the lower level of the control scheme, a nonlinear controller is implemented through the use of quadratic programming (QP) and virtual constraints to force the full-order dynamical model to track the prescribed optimal trajectories of the COM and tail while maintaining feasible ground reaction forces at the leg ends. The potential of the analytical results is numerically verified on a full-order simulation model of a quadrupedal robot augmented with a tail with a total of 20 degrees-of-freedom. The numerical studies demonstrate that the proposed control scheme coupled with the tail dynamics can significantly reduce the effect of external disturbances during quadrupedal locomotion.

1 Introduction

This paper presents a systematic approach to design a hierarchical control algorithm, based on reduced-order models, model predictive control (MPC), quadratic programming (QP), and virtual constraints, to intrinsically couple bio-inspired articulated tails with legged robots for robust locomotion. In the proposed approach, the high-level MPC computes an optimal center of mass (COM) trajectory for the body and an optimal tail trajectory in real-time. More specifically, we develop an MPC formulation for an innovative and augmented linear inverted pendulum (LIP) model which has been extended to consider the forces introduced by the tail dynamics. The high-level MPC is implemented in an event-based manner in the sense that it is solved at the beginning of each continuous-time domain subject to the predefined foot placements, the feasibility of the net ground reaction force (GRF), and the tail joint and actuation limits. In order to close the gap between the reduced-order model used by the high-level MPC and the full-order model of the robot augmented with a tail, a low-level nonlinear controller, based on convex QP and virtual constraints, is implemented to track the prescribed COM and tail trajectories while ensuring feasible GRFs at the contacting leg ends. The potential of the proposed control approach is numerically demonstrated through extensive full-order simulations of the Vision 60 quadruped augmented with a serpentine tail with a total of 20 degrees-of-freedom (DOFs) (see Fig. 1). It is shown that extending existing MPC frameworks for locomotion to consider additional dynamics induced by a tail can produce greater robustness to external disturbances during locomotion than a legged system without the addition of a tail like structure.

Fig. 1
(a) Vision 60 robot with 18DOFs whose full-order dynamical model will be used for the numerical simulations. (b)computer-aided design (CAD) representation of Vision 60 augmented with a 2DOF tail mechanism.
Fig. 1
(a) Vision 60 robot with 18DOFs whose full-order dynamical model will be used for the numerical simulations. (b)computer-aided design (CAD) representation of Vision 60 augmented with a 2DOF tail mechanism.
Close modal

1.1 Background, Motivation, and Challenges

1.1.1 Related Work on Legged Locomotion.

The most widely used control method for legged locomotion is based on a heuristic notion of gait stability, known as the zero moment point criterion [1,2]. This control methodology produces quasi-static gaits and assumes full-actuation. Alternatively, legged locomotion can be described by hybrid systems [3,4] with continuous-time domains (i.e., phases) to represent the Lagrangian dynamics and discrete-time transitions between continuous-time domains to represent the abrupt changes in the velocity components of the state vector during the infinitesimal period of the rigid impacts between the swing leg ends and the environment [529]. State-of-the-art nonlinear control algorithms that address the hybrid nature of legged locomotion to stabilize gait patterns include controlled symmetries [8], hybrid reduction [30,31], transverse linearization [10,32], and hybrid zero dynamics (HZD) [7,18,33,34]. Of these methods, only HZD and transverse linearization are capable of addressing the general case of underactuation inherent to dynamic locomotion. In the case of HZD, a set of kinematic constraints, referred to as virtual constraints [5,34], are enforced via input–output (I-O) feedback linearization [35] in order to impose coordinated motion among the limbs. Virtual constraint controllers have been validated both numerically and experimentally for the stable locomotion of bipedal robots [7,17,20,26,34,3639], quadrupedal robots [4042], lower extremity powered prostheses [4345], and exoskeletons [46]. The gait planning for virtual constraint controllers is typically performed offline by solving a nonlinear programming problem. While algorithms exist in which agile gait planning can be performed efficiently [26,47], these methods cannot be used in an online manner, thereby restricting the use of HZD methods for navigating complex environments.

A variety of QP- and MPC-based approaches also exist for locomotion, including LIP-based MPC path planning [42,4851], centroidal dynamics-based MPC [52,53], nonlinear MPC [54], policy-regularized MPC [55], and whole-body QP-based control [56,57], though LIP and centroidal methods have been studied most extensively. In LIP-based MPC, optimal COM and center of pressure (COP) trajectories are determined subject to the zero moment point conditions and feasible net GRF. This approach has the benefit of not requiring offline trajectory optimization and may be coupled with a number of different low-level control techniques to track the prescribed trajectories. While LIP-based MPC has primarily been applied to bipedal systems [4850], it has recently been extended to quadrupedal locomotion as well [42,58]. Centroidal-based MPC techniques determine optimal GRFs using reduced-order dynamics and have the primary benefit of considering the feasibility of GRFs at each contact point. While these optimization methods have shown to produce robust locomotion, it is a significant computational burden to solve the MPC at every time-step even considering the problems are typically formulated as convex QPs. For this reason, event-based optimization is of great interest [42,59]. This is especially true as the number of decision variables and constraints increase, as is the case when augmented with a serpentine tail.

1.1.2 Motivation and Related Work on Tails for Legged Locomotion.

Although the technology involved in the development of sophisticated quadrupedal machines is rapidly advancing, the knowledge regarding the synthesis of feedback control paradigms that intrinsically couple the motion of tails and legged robots for improved dynamic stability is lacking. The use of tails in nature has primarily been studied in terms of dynamic reorientation during leaps and falls [60,61], but there has been evidence that large cats use their tails for dynamic locomotion as well [62]. Similar to their biological counterpart, the use of biomimetic pendulum-like tails has been explored on bipedal [6366], quadrupedal [6769], and hexapedal [70] systems for stability. While these tails have been shown to negate external disturbances [67], perform aerial reorientation [6365,6971] in an effort to regain stability, and increase rapid accelerations [68], the dynamic stability of locomotion for quadrupeds augmented with biomimetic tails has been addressed in very few studies, see, e.g., Refs. [72] and [73]. These investigations primarily explore the use of tails during static stance [67], flight phase [6365,69,70], and gait initiation [68], allowing for simplified models and controllers which cannot easily be generalized to varying single- and multicontact domains present during quadrupedal locomotion. Additionally, control of legged systems with the addition of serpentine appendages (as opposed to pendulum-like appendages)–which greatly increases the nonlinearities present–has been largely unexplored.

1.1.3 Significant Challenges.

Existing nonlinear controller design approaches for legged locomotion are tailored specifically to systems without the addition of tails, and the integration of tails introduces significant overhead in terms of complexity and dimensionality of these already sophisticated machines. This, in turn, further complicates the design of robust nonlinear control algorithms. We aim to answer the following questions: (1) how can we extend the LIP dynamics to include external forces induced by a tail? (2) how can we systematically plan for the motion of the tail in real-time to ensure robust locomotion? and (3) how can we implement these reduced-order trajectories on a full-order model using nonlinear control approaches?

1.2 Goals, Objectives, and Contributions.

The overarching goal of this paper is to present a formal foundation to design real-time motion planning and nonlinear feedback control algorithms for robust locomotion of quadrupedal robots augmented with serpentine tails. The specific objectives and key contributions of the paper are as follows:

  1. We present an innovative reduced-order model, referred to as the extended LIP dynamics, for the real-time planning of the COM and tail motions. In particular, the presented reduced-order model integrates the LIP dynamics with the nonlinear tail dynamics to enable us to formulate an online optimal control problem.

  2. We present a hierarchical nonlinear control scheme for the motion control of quadrupedal robots with robotic tails. At the higher-level of the control scheme, we propose an MPC formulation for the real-time path planning of the reduced-order model to effectively generate the optimal trajectories for the robot's COM and tail joints. The MPC considers the feasibility of the tail motion, COP constraints, and the feasibility of the net GRF. As the proposed reduced-order model is nonlinear, we linearize the extended LIP model at the beginning of each continuous-time domain and then solve the MPC algorithm in an event-based manner to formulate a convex QP (see Fig. 2).

  3. At the lower-level of the control scheme, a nonlinear controller, based on QP and virtual constraints, is presented for the motion control of the full-order dynamical system to track the prescribed motions of the COM and tail while imposing feasibility of the GRFs at all contact points.

  4. We investigate the effect of robotic tails on quadrupedal locomotion intrinsically coupled with the proposed control algorithms. For this purpose, a series of extensive and full-order numerical simulations is presented to demonstrate the effectiveness and robustness of the proposed control approach for locomotion of a 20DOF advanced quadrupedal robot, Vision 60, augmented with a serpentine tail in the presence of external disturbances (see Fig. 1). We numerically show that the integration of the tail dynamics with the developed nonlinear feedback control algorithms can significantly reduce the effect of external disturbances on quadrupedal locomotion.

Fig. 2
Block diagram of the proposed hierarchical control scheme. A high-level and real-time planner, based on event-based MPC, computes the optimal COM and tail trajectories for a reduced-order model, referred to as the extended LIP dynamics, subject to the feasibility of the net GRF and tail motion. A low-level nonlinear controller, based on virtual constraints and QP, imposes the full-order dynamical model of locomotion to track the prescribed and reduced-order optimal trajectories subject to the feasibility of the GRFs at the contacting legends.
Fig. 2
Block diagram of the proposed hierarchical control scheme. A high-level and real-time planner, based on event-based MPC, computes the optimal COM and tail trajectories for a reduced-order model, referred to as the extended LIP dynamics, subject to the feasibility of the net GRF and tail motion. A low-level nonlinear controller, based on virtual constraints and QP, imposes the full-order dynamical model of locomotion to track the prescribed and reduced-order optimal trajectories subject to the feasibility of the GRFs at the contacting legends.
Close modal

References [72] and [73] have provided an interesting approach to address the dynamic stability of legged robots augmented with a single-DOF pendulum-like tail, but in both cases the controller used is a central pattern generator, where the trajectory is calculated offline and the robot is controlled in an open-loop manner. Reference [72] provided an analysis regarding the general design of the tail using a spring loaded inverted pendulum model, though it is not used as part of any control algorithm and only encompasses movement in the sagittal plane. Our work differs completely in that (1) we consider the use of a serpentine tail, (2) we propose real-time planning algorithms for both locomotion and the tail by using an extended LIP model, and (3) we track the generated reduced-order trajectories in a closed-loop manner through a QP-based virtual constraint controller. The work presented in the current paper also differs from the previous work [42] in that Ref. [42] did not address locomotion with tail dynamics. Here, we derive and use a novel extended LIP model in which additional external forces may be addressed. Furthermore, the current work includes the dynamics of the appendage in the path planner in order to increase gait stability and robustness as opposed to treating the appendage as a disturbance. We also extend the event-based MPC formulation of Ref. [42] to the nonlinear reduced-order model, arising from the extended LIP dynamics and plan for the optimal COM motion of the robot as well as the tail trajectory.

The paper is organized as follows. The full-order nonlinear models for quadrupedal locomotion with robotic tails are presented in Sec. 2. Section 3 presents the extended reduced-order model for real-time planning. Section 4 addresses the optimal control problem and formulation of the higher-level MPC for the extended LIP model. The lower-level nonlinear controller, based on QP and virtual constraints, for the whole-body motion control is presented in Sec. 5. Section 6 presents the numerical simulations for quadrupedal locomotion with tails to verify the effectiveness of the proposed control algorithms. Finally, Secs. 7 and 8 present discussion and concluding remarks, respectively.

2 Full-Order Nonlinear Model of Locomotion With Tail

2.1 Robot and Tail Model.

In this paper, we consider the full-order dynamical model for locomotion of the quadrupedal robot Vision 60, made by Ghost Robotics,2 augmented with a serpentine tail (see Fig. 1). Vision 60 can be modeled with 18DOFs, 12 of which consist of leg DOFs while the other six represent the absolute position and orientation of the floating base in an inertial world frame. Each leg of the robot consists of an actuated 2DOF hip joint (roll and extension) plus a 1DOF knee joint, ending with a point foot. The tail design used in this paper has 2DOFs—one allows for a rolling motion, while the other allows for yaw motion (see Fig. 3). The yaw portion of the tail consists of eight holonomically constrained gears which are driven by a single actuator. The gear ratio is held constant from one link to the next; therefore, each link is constrained to rotate by the same amount as the previous link in order to obtain uniform deformation along the length of the tail. This design is partially inspired by the designs found in Refs. [74] and [71]. To keep the tail mechatronics light and simple, each actuated joint uses a single Hebi Robotics3 actuator which will provide sufficient torque to drive the tail. We note that the total mass of the tail is approximately 1.51 (kg), in which the base, roll link, and individual yaw links are approximately 0.4 (kg), 0.68 (kg), and 0.053 (kg), respectively. Throughout this paper, the tail mechanism is assumed to be mounted on a point, referred to as the base of the robot (see Fig. 1).

Fig. 3
(a) Side view of the tail CAD design annotated with the axes of rotation. (b) Isometric view of the tail CAD design.
Fig. 3
(a) Side view of the tail CAD design annotated with the axes of rotation. (b) Isometric view of the tail CAD design.
Close modal

2.2 Nonlinear Dynamics.

The generalized coordinates for Vision 60 are expressed as qr:=col(pr,αr,qb)Qr18, in which the subscript “r” stands for the robot, pr3 and αr3 represent the absolute position and orientation of the body of the robot in the inertial world frame, respectively, and qb12 denotes the body angles (i.e., shape of the robot). The torque and force inputs applied to the robot are denoted by ur12,λc3nc, and λt6, which are the actuator torque inputs, the GRFs at the contacting leg ends, and the tail reaction wrench (forces and moments), respectively. In our notation, “col” represents the column vector and nc denotes the number of contacting legs with the ground. The evolution of the robot is then described by the Euler–Lagrange equations and principle of virtual work as follows:
(1)

where Dr(qr)18×18 is the symmetric and positive definite mass-inertia matrix, Hr(qr,q˙r)18 denotes the Coriolis, centrifugal, and gravitational terms, and Br18×12 is the input distribution matrix. In addition, Jc(qr)3nc×18 is the ground contact Jacobian matrix, and Jbr(qr):=pbrqr(qr)6×18 is the Jacobian of the base of the robot on which the tail is connected.

The tail is modeled with 8DOFs in total, where 6DOFs come from the floating base, and the additional 2DOFs are the internal roll and yaw motions of the tail. The generalized coordinates of the tail are then defined as qt:=col(pt,αt,θ)Qt8, where the subscript “t” stands for the tail, pt3 and αt3 represent the absolute position and orientation of the base of the tail in the inertial world frame, respectively, and θ:=col(θroll,θyaw)2 are the internal roll and yaw angles. Finally, τt:=col(τroll,τyaw)2 are the torque inputs to the tail roll and yaw actuators. The equations of motion can be described as follows:
(2)
where Dt(qt)8×8,Ht(qt,q˙t)8, and Bt8×2 denote the mass-inertia matrix, Coriolis, centrifugal, and gravitational forces, and input distribution matrix, respectively. Furthermore, Jbt(qt):=pbtqt(qt)6×8 is the Jacobian of the base of the tail in the tail inertial frame. The holonomic constraints between the robot and tail can be expressed as pbr(qr)=pbt(qt), in which pbr(qr)6 and pbt(qt)6 represent the absolute position and orientation of the base of the tail in qr and qt coordinates, respectively. Differentiating the holonomic constraints twice yields
(3)
Equations (1)(3) may then be put into a system of algebraic differential equations to solve for the acceleration of each body and the interacting forces between them, that is,
(4)
where 0 represents a matrix of zeros of the correct dimension. Note that the final equation in Eq. (4) ensures that there is a rigid connection between the tail and the quadruped. By eliminating the Lagrange multiplier λt (i.e., internal wrench), the equations of motion in the nonlinear coupled dynamics (4) can be expressed as an input-affine system as follows:
(5)

where z:=col(qr,qt,q˙r,q˙t) denotes the state vector and τ:=col(τr,τt) represents the control inputs.

3 Extended Linear Inverted Pendulum Model

The objective of this section is to derive a reduced-order model based on the LIP dynamics to study the equations of motion for the COM and the tail dynamics. The model, referred to as the extended LIP dynamics, will be utilized for the development of the real-time motion planning algorithm in Sec. 4.

The reduced-order LIP model can be described by [51]
(6)
where xcom and ycom represent the Cartesian coordinates of the COM with respect to the inertial world frame in the x and y directions, respectively, having been projected onto the xy-plane. In addition, zcom is the vertical height of the center of mass, which is assumed to remain constant throughout the duration of the gait, g0 is the gravitational constant, and ucop:=col(xcop,ycop)2 represents the Cartesian coordinates of the COP in the world frame. In order to include external forces in the LIP model, we consider the following dynamics:
(7)
where mtot is the total robot mass, Fx denotes the external force in the x direction applied by the tail, Fgx represents the GRF in the x direction, FMrx denotes the equivalent force in the x direction due to an external roll moment, FMpx represents the equivalent force in the x direction due to an external pitch moment, and FMyx denotes the equivalent force in the x direction due to an external yaw moment (see Fig. 4). The notation is defined similarly for both the y and z directions. In order to solve for the net GRF, we consider the equation of motion in the z direction as
(8)

and let z¨com=0 for the duration of the gait. For this purpose, we first study the components of the GRF and the equivalent forces due to moments according to the geometry of the model. In particular, it can be shown that Fgx=Fgxcomxcopl,Fgy=Fgycomycopl, and Fgz=Fgzcoml, where Fg denotes the net GRF and l:=(xcomxcop)2+(ycomycop)2+(zcom)2. In addition, we can easily translate the moments into equivalent forces as follows (see Fig. 4)

where xz:=(xcomxcop)2+(zcom)2 represents the distance between the COM and COP in the xz-plane, and similarly, yz:=(ycomycop)2+(zcom)2 and xy:=(xcomxcop)2+(ycomycop)2. These geometric relations together with Eq. (8) and z¨com=0 finally result in the following net GRF
(9)
Fig. 4
Free body diagram of the forces and moments induced by the tail on the LIP dynamics. Note that the zcop is always zero.
Fig. 4
Free body diagram of the forces and moments induced by the tail on the LIP dynamics. Note that the zcop is always zero.
Close modal
The GRF in Eq. (9) can then be combined with Eq. (7) to obtain the extended LIP dynamics which are nonlinear due to the addition of several nonlinear components, including Fz and the moments about the base of the tail (i.e., Mr, Mp, and My). Since the dominant external wrenches that are applied by the tail are assumed to be those involving Fx and Fy, the vertical force and the moments induced about the base of the tail are neglected for the purpose of planning, but all forces and moments are considered during the full-order controller and simulations (see Secs. 5 and 6). Furthermore, xy goes to zero as the COM approaches the COP which causes FMyx and FMyy to become undefined due to division by zero. We therefore plan only for the standard COP inputs (i.e., xcop and ycop) together with Fx and Fy which are to be applied by the tail. We can show that this assumption will reduce the nonlinear dynamics of the extended LIP model to the following linear dynamics
(10)

3.1 Addition of Tail Dynamics.

In order to properly plan for the movement of the tail in the high-level MPC, the nonlinear tail dynamics must be integrated with Eq. (10). For the sake of keeping the reduced-order model as simple as possible while capturing the overall dynamics, the tail is assumed to be attached to the geometric center of the robot, as shown in Fig. 5. Due to the nature of Bt and Jb, the equations of motion in Eq. (2) can be rewritten more concisely as
(11)

where λt=col(Ft,Mt) with Ft:=col(Fx,Fy,Fz)3 being the forces at the base of the tail in the x, y, and z directions, and Mt:=col(Mr,Mp,My)3 being the moments at the base of the tail in the roll, pitch, and yaw directions.

Fig. 5
Illustration of the reduced-order extended LIP model
Fig. 5
Illustration of the reduced-order extended LIP model
Close modal
Considering that we are only interested in the forces in the x and y directions, only the first two rows of Eq. (11) are used for the high-level MPC. We may then solve for the reaction forces caused by the tail in the x and y directions by noting the tail mass matrix, Dt, and nonlinear vector, Ht, may be decomposed into individual parts, denoted by Dij for 1i,j8 and Hi for 1i8, respectively. More specifically, we have
(12)
where θroll and θyaw denote the actuated roll and yaw angles (i.e., shape variables) of the tail. Here, we assume that the roll, pitch, and yaw of the quadruped (and the base of the tail) are zero, and zcom is constant. Hence, Eq. (12) does not contain the portions of the mass-inertia matrix pertaining to the orientation and height of the base of the tail. We further remark that D12=D21=04. Combining Eqs. (10) and (12), the LIP equations with external forces in the x and y directions may then be written as
(13)
Similarly, the dynamics for the shape of the tail (i.e., θ¨roll and θ¨yaw) may be written as
(14)
Combining Eqs. (13) and (14), and moving all acceleration terms to the left-hand side, we obtain the final equations for the reduced-order model as a set of algebraic differential equations of the form
(15)

where x:=col(xcom,ycom,θroll,θyaw,x˙com,y˙com,θ˙roll,θ˙yaw)8 and u:=col(xcop,ycop,τroll,τyaw)4 denote the state and control inputs, respectively. In addition, W(x)8×8 is a weighting matrix, A8×8 represents the state matrix, B4×8 denotes the input distribution matrix, and N(x)8 contains the remaining nonlinear terms.

3.2 Linearization of the Extended Linear Inverted Pendulum Model.

The final reduced-order Eq. (15) are linearized by taking the first order Taylor series expansion. Due to the complexity of symbolically inverting the W matrix, the Taylor series expansion is applied to both the left- and right-hand sides of the equation separately yielding
(16)
and
(17)
where x0, x˙0, and u0 are the operating points around which the system is linearized. Combining Eqs. (16) and (17) and solving for x˙, we obtain the linearized equations of motion
(18)
as G(x0,x˙0)=F(x0,u0). For future reference, one can rewrite Eq. (18) in a compact form as the following control affine system
(19)

where the subscript “” stand for the linearized dynamics.

The dynamics Eq. (19) are then discretized via an Euler formulation such that xk+1=xk+x˙kTs where kZ0 and Ts is the sampling time. Using Eq. (19), we are left with a set of difference equations of the form
(20)

where Ad8×8 and Bd8×4 are the discrete state and input distribution matrices, respectively, and d8 is a vector of constants. The aforementioned matrices and vector are constant for a given linearization/discretization, and will be reevaluated in an event-based manner for the real-time path planning problem (see Sec. 4).

4 High-Level Path Planner

The objective of this section is to formulate a real-time optimal control problem for the extended reduced-order model to compute an optimal trajectory for the COM and tail motions subject to the COP remaining within the support polygon created by the contacting leg ends, feasible net GRF, and joint and actuation limits of the tail. In particular, we formulate a high-level MPC problem to be solved in an event-based manner (i.e., beginning of each continuous-time domain) to drive the state of the extended reduced-order system from an arbitrary initial state, xi, to some final state, xf, over a finite number of continuous time domains, M1. We consider a general locomotion pattern with a graph G(V,E) with the vertices set V and the edges set EV×V (see Fig. 6). The vertices denote the continuous-time domains of locomotion including double-, triple-, and quadruple-contact phases, and edges represent the discrete-time transitions between the continuous-time domains. Each continuous-time domain is assumed to have Nd1 evenly temporally spaced grid points over which the trajectory is optimized. In order to indicate the continuous-time domain for every time sample, we define the index function as ζ:Z0{1,2,,M} by ζ[k]:=kNd+1 for all 0k<MNd and ζ[k]:=M for kMNd. In our notation, . represents the floor function.

Fig. 6
Snapshots of a nominal trot gait to illustrate the corresponding directed graph G(V,E) with M continuous-time domains. The first and last vertices of the graph represent quadruple-contact domains for starting and stopping, whereas the middle vertices represent double-contact domains. The contacting leg ends are depicted by the circles.
Fig. 6
Snapshots of a nominal trot gait to illustrate the corresponding directed graph G(V,E) with M continuous-time domains. The first and last vertices of the graph represent quadruple-contact domains for starting and stopping, whereas the middle vertices represent double-contact domains. The contacting leg ends are depicted by the circles.
Close modal

4.1 Model Predictive Control Formulation.

We formulate an event-based optimal control problem for the real-time planning of the extended reduced-order model. In particular, we first linearize the nonlinear extended LIP dynamics (15) about its current operating points at the event times (beginning of each continuous-time domain), that is, k=rNd for some rZ0. We then setup an MPC problem using the previously-mentioned linearization over a finite control horizon Nc=nNd for some n1. This reduces the optimal control problem of the nonlinear system into QP that can be solved in real-time. The optimal control inputs are then employed for Nd grid points of the current domain while we discard the remaining control inputs for the next domains. At the beginning of the next domain (i.e., new event), the Jacobian linearization is updated according to the current state of the nonlinear reduced-order model and a new MPC problem is solved. This iterative procedure continues for all future events.

To make this notion more precise, let us assume that we are at the event time k=rNd for some rZ0. We next evaluate the Jacobian matrices A and B together with the vector d as discussed in Sec. 3.2 for the following nonlinear dynamics
(21)
where xko,x˙ko, and uk1o represent the current state of the original reduced-order system, the time derivative of the state, and the optimal control input for the previous time sample, respectively. Furthermore, the superscript “o” stands for the original system. These matrices are then kept constant for the formulation of the optimal control problem. At the next event, the matrices will be reevaluated and will be utilized again for a new optimal control problem. We now consider the affine dynamics (20) with the initial condition xk=xko for all future times. The optimal control inputs must be constrained such that ukcop (i.e., COP components of the input) belongs to the convex hull of the contacting points with the ground, Uζ[k]2, for all domains. That is, ukcopUζ[k], ensuring that the COP is within the support polygon for all time samples. Additionally, we constrain the net GRF to remain within the friction cone. From the linearized extended LIP dynamics, the friction cone constraints can be given by
(22)

in which the subscript “f” stands for friction cone. More specifically, Af2×8 and Bf2×4 are the state and input matrices which are composed of the rows of A and B pertaining to the accelerations in the x and y directions. In a similar manner, df2 is composed of the appropriate rows of d. Finally, we define η:=1g0μ2 to represent the friction cone that the net GRF must stay within, where μ denotes the static friction coefficient, g0 represents the gravitational constant, and 1 is an appropriately sized vector of ones.

Finally, because the tail joint positions and torques are explicitly included in the path planning problem, we may bound them in order to ensure shape and input feasibility. We define τt,k2 and θk2 to be the tail torque inputs and the actuated tail configurations at the time-step k, respectively. We also define τtlb,τtub,θlb, and θub to denote the lower and upper bounds of the tail torque inputs and joint positions. We are now in a position to setup the MPC problem to be solved in an event-based manner (i.e., beginning of each continuous-time domain) in order to create an optimal sequence of inputs (i.e., COP and τt) which drives the system from x0 to xf over the control horizon. In particular, we consider the following optimal control problem at k=rNd
(23)

where Ukk+Nc1|k:=col(uk|k,,uk+Nc1|k) denotes the sequence of control inputs and xk+i|k is the predicted state vector at time k + i computed at time k subject to the dynamics xk+i+1|k=Adxk+i|k+Bduk+i|k+d with the initial condition xk|k:=xk. In a similar manner, we denote uk+i|k to be the COP and tail torque inputs at time k + i computed at time k. The terminal cost is expressed as p(xk+Nc|k):=||xk+Nc|kxk+Nc|kdes||P2 for some symmetric positive definite matrix P8×8. In this notation xk+i|kdes represents the desired state vector at time k + i which is a smooth trajectory beginning at xk and ending at xf, and ||x||P2:=xPx. The stage cost is also defined as L(xk+i|k,uk+i|k):=||xk+i|kxk+i|kdes||Q2+||uk+i|k||R2 where Q8×8 and R4×4 are symmetric positive definite matrices.

Remark 1. The matrices Ad and Bd together with the vector d are reevaluated at the beginning of each new continuous-time domain using the current state of the original system and the previous optimal input, and are held constant for the duration of the MPC. The same is true for the friction matrices Af and Bf, and the friction vector df. This reduces the MPC into QP that can be effectively solved in real-time (see Sec. 6 for more details).

Remark 2. The optimal COM and tail motions for the reduced-order model that are prescribed by the MPC for the current domain will be utilized as a reference trajectory for the full-order model in Sec. 5. In particular, the low-level nonlinear controller will impose the full-order dynamics to asymptotically track the optimal reduced-order trajectory while imposing all contact forces to remain within the friction cone.

5 Low-Level Nonlinear Controller

This section presents the low-level controller (i.e., whole-body motion controller), which is developed based on virtual constraints and QP to track the optimal reduced-order motions generated by the high-level path planner. Specifically, we derive a nonlinear control algorithm which tracks the COM and tail trajectories prescribed by the event-based MPC for the current domain. Here, we extend the low-level nonlinear control algorithm of Ref. [42] to locomotion with robotic tails. While the path planner directly provides torques for the tail, the torques are based upon the linearized model and are not likely to be accurate enough to use on the full-order system. In addition to tracking the trajectories of the COM and the tail, the low-level controller is responsible for coordinating the motion of the swing legs such that they arrive at the next desired foot placement while ensuring the feasibility of all GRFs at the contacting legs.

We consider the following time-varying virtual constraints:
(24)

where h0(q) represents a set of holonomic parameters to be controlled and hd(s,α) denotes the desired evolution of the holonomic outputs h0 on the gait. In particular, hd(s,α) is taken as a Bézier polynomial that passes through the discrete waypoints generated by the MPC path planner, in which s is a gait phasing variable taken as the normalized time and α represents the coefficients of the Bézier polynomial. The dimension of the outputs varies depending on the number of contact points with the ground. During quadruple-contact, h0 consists of 8 components including the COM position, body orientation (i.e., roll, pitch, and yaw), and two internal joints of the tail. The idea here is to impose the full-order system to track the prescribed COM and tail motions while regulating the Euler angles of the floating base. During triple- and double-contact domains, these controlled variables are augmented with the Cartesian coordinates of the swing legs ends for the foot placement. Here, we would like the swing leg ends follow a desired trajectory in the work space starting from the former foothold and ending at the next one. This would increase the dimension of the controlled variables to 11 and 14 during the triple- and double-contact domains, respectively.

Differentiating Eq. (24) along Eq. (5), we obtain the following output dynamics using I–O linearization:
(25)
where LgLfy,LwLfy, and Lf2y are Lie derivatives and KP and KD are positive definite gain matrices. Furthermore, because the GRFs cannot be measured on the quadruped, we estimate the GRFs through the use of a rigid contact model. This assumes that the acceleration of the foot remains zero after contact which may be expressed as p¨=Jc(qr)q¨r+qr(Jc(qr)q˙r)q˙r=0. This in tandem with Eq. (5) yields
(26)
Analogous to Ref. [42], we setup a convex QP to solve for the optimal joint-level torques τ for the robot as well as the tail, while imposing the feasibility of GRFs at all contacting legs. More precisely, we consider the following real-time QP
(27)

where FC denotes the friction cone, and τmin and τmax represent the lower and upper bounds for the torque inputs, respectively. By formulating the low-level controller in terms of a QP, the controller also becomes more robust to singularities that could arise from matrix inversions during I–O linearization. We remark that the low-level QP for nonlinear control is executed in real-time (e.g., 1 kHz) to compute the optimal torques for the full-order model of locomotion, while the higher-level MPC is solved at a slower rate (i.e., in an event-based manner) for trajectory replanning based on the extended LIP model.

6 Numerical Simulations

The objective of this section is to numerically verify the effectiveness of the proposed control algorithm for robust and stable quadrupedal locomotion with robotic tails. We present a multitude of full-order simulations to demonstrate the increased robustness that an articulated tail provides using the proposed control technique. In all cases, we consider a trot gait with start and stop conditions as shown in Fig. 6.

6.1 Controller Parameters and Nominal Closed-Loop Simulations.

The extended LIP model is discretized using a sampling time of Ts = 80 (ms). The high-level MPC computes the optimal reduced-order trajectory over a control horizon of n =2 domains, where each domain consists of Nd = 4 grid points. We utilize the optimal solution for the current domain, meaning that only the first four optimal trajectory points from the high-level MPC–that correspond to the current domain– are used as inputs to the low-level nonlinear controller. The rest of the parameters for the MPC are taken as P=diag(104,104,103,103,104,104,1,1),Q=diag(10,10,10,10,0.1,0.1,0.1,0.1), and R=I4×4, where I represents the identity matrix and “diag” denotes the diagonalization operator. Conceptually, we aim to give the MPC the ability to deviate from the desired tail trajectory (which is always 0) and prioritize tracking the desired COM motion. Additionally, we attempt to drive the tail back to zero at the end of the path planner to allow the tail to begin in an uncompromised position at the start of the next domain. However, we put relatively little weight on the velocity of the tail at the end of each domain, thereby allowing the tail to keep momentum. We begin by simulating the original and extended LIP models integrated with the proposed MPC approach to show the effectiveness of the higher-level controller in rejecting pulse-like disturbances, see Fig. 7. Here, we consider a forward trot gait with 20 domains subject to a pulse disturbance with a magnitude of 30 (N) in the lateral direction (i.e., y-axis), which is applied for the duration of two grid points, i.e., 2Ts=160 (ms), in domain 11. The reduced-order simulation is done in MATLAB and uses the Embedded Conoc Solver (ECOS) [75] in order to solve the QP arising from the event-based MPC. The stability of final target point for both the standard LIP (without tail) and the extended LIP (with tail) models subject to the event-based MPC is clear, but it is evident that the closed-loop system using the extended LIP model more adequately attenuates the disturbance. In particular, the system without the tail obtains a maximum displacement from the y-axis of approximately 9.7 (cm) while the system with the tail reaches a maximum displacement of 8 (cm) and settles back to steady-state faster.

Fig. 7
Reduced-order simulation of the event-based MPC acting on the standard LIP model (without tail) and the extended LIP model (with tail) for a forward trot with a 10 (cm) step length. Here, we consider a 30 (N) pulse disturbance in the lateral direction which is applied for the duration of two MPC grid points (i.e., 2Ts), starting at time sample 41.
Fig. 7
Reduced-order simulation of the event-based MPC acting on the standard LIP model (without tail) and the extended LIP model (with tail) for a forward trot with a 10 (cm) step length. Here, we consider a 30 (N) pulse disturbance in the lateral direction which is applied for the duration of two MPC grid points (i.e., 2Ts), starting at time sample 41.
Close modal

Full-order simulations are then done primarily in RaiSim [76], where we utilize qpSWIFT [77] to solve the high- and low-level QPs. Here, the MPC problem (23) is solved at the beginning of each continuous-time domain, that is approximately every 4Ts=320 (ms), whereas the low-level nonlinear control QP is solved at 1 kHz. We can show that the QP for the higher-level MPC has 120, 112, and 128 decision variables for the first, middle, and last continuous-time domains, respectively. In addition, the typical computation time of the MPC problem on a desktop computer with an Intel(R) Xeon(R) W-2125 CPU at 4.00 GHz (4 cores) and 16 GB of RAM is 0.32 (ms) to 0.42 (ms). The lower-level QP has 40 decision variables for both the double- and quadruple-contact domains of the trot gait with a typical computation time of 0.19 (ms) to 0.3 (ms).

RaiSim uses a universal robot description file (URDF) representation of the system. This presents a hurdle in that URDFs cannot represent holonomically constrained systems. In order to get around this, a URDF is created assuming that each yaw link in the tail is actuated instead of being holonomically constrained. In order to get the same dynamical behavior of the holonomically constrained tail in Fig. 3, the Rigid Body Dynamics Library (RBDL) [78] is then employed to compute the equivalent torque at each yaw joint of the tail via inverse dynamics by using τt and λt computed by the low-level QP.

We consider three nominal simulations, two of which are conducted in RaiSim, and the third in MATLAB. We consider multiple simulation environments in order to demonstrate the robustness of the closed-loop system against nonparametric uncertainties arising from different contact models. The robot hardware has a small compliant element at the toe, but the provided damping is assumed to be small and the rebound during impact is assumed to be zero. It is therefore reasonable to assume that the compliant dynamics at the toe are negligible when compared to the overall dynamics and impacts may be treated as rigid. For this reason, the majority of the simulations are conducted in RaiSim [76], where a rigid contact model between the leg ends and the ground is used, whereas few simulations are conducted in MATLAB, in which we utilize a LuGre model [79] to represent a compliant contact model. Figures 8(a) and 8(b) depict the output (i.e., virtual constraints) and torque profiles of the quadrupedal robot and tail for forward and diagonal trots in RaiSim. Figure 8(c) shows a full-order simulation of the system run in matlab/simulink subject to LuGre contact model. In addition, Fig. 8(c) illustrates the components of the ground reaction force experienced at one of the legs. For the purpose of this paper, we use a step length of 10 (cm) for the forward trot and step lengths of (7,4) (cm) in the x and y directions for the diagonal trot.

Fig. 8
(a) and (b) Time profiles of the outputs (i.e., virtual constraints) and joint torques for the forward and diagonal trot gaits in RaiSim. (c) Time profile of the virtual constraints and the GRF experienced at one of the leg ends during forward trot gait with a LuGre contact model in matlab. Here, we only plot the components of the virtual constraints that correspond to the absolute position of the COM (i.e., yx, yy, and yz), absolute orientation of the robot's floating base (i.e., yroll, ypitch, and yyaw), and shape variables of the tail (i.e., yroll,T and yyaw,T). Other components are not shown to simplify the illustration. For the torque plots, the subscripts “FH,” “FK,” “RH,” “RK,” and “T” stand for the front hip, front knee, rear hip, and rear knee of the left-hand-side of the robot as well as the tail, respectively. In addition, “roll” and “pitch” for the torque plots represent the roll and pitch motions of the joints.
Fig. 8
(a) and (b) Time profiles of the outputs (i.e., virtual constraints) and joint torques for the forward and diagonal trot gaits in RaiSim. (c) Time profile of the virtual constraints and the GRF experienced at one of the leg ends during forward trot gait with a LuGre contact model in matlab. Here, we only plot the components of the virtual constraints that correspond to the absolute position of the COM (i.e., yx, yy, and yz), absolute orientation of the robot's floating base (i.e., yroll, ypitch, and yyaw), and shape variables of the tail (i.e., yroll,T and yyaw,T). Other components are not shown to simplify the illustration. For the torque plots, the subscripts “FH,” “FK,” “RH,” “RK,” and “T” stand for the front hip, front knee, rear hip, and rear knee of the left-hand-side of the robot as well as the tail, respectively. In addition, “roll” and “pitch” for the torque plots represent the roll and pitch motions of the joints.
Close modal

6.2 Robustness Analysis.

In order to study the robustness of the closed-loop system against external disturbances, we consider two different trot gaits, namely forward and diagonal trots. The robustness simulations fall under two different categories, the first being a pulse-like disturbance and the latter being a time-varying disturbance.

6.2.1 Pulse Disturbance Rejection.

In order to analyze the closed-loop system's robustness, we investigate the effects of a pulse perturbation applied to the system for 200 (ms) at the COM. First we consider the forward trot gait with two different pulse disturbances—the first being 75 (N) in the lateral direction and the second being 100 (N) in the forward direction. The virtual constraints and joint-level torques for these simulations are depicted in Figs. 9(a) and 9(b). We also consider two additional simulations with the diagonal trot gait, where the first simulation is subject to a pulse disturbance directly opposing the direction of motion (i.e., along the unit vector (0.8682,0.4961,0)), and the second is subject to a pulse disturbance which is orthogonal to the direction of motion (i.e., along the unit vector (0.4961,0.8682,0)). The pulse-like forces in the latter two simulations have magnitudes of 75 (N) and 110 (N), respectively, and the corresponding virtual constraints and torques are shown in Figs. 9(c) and 9(d). The same disturbances were then applied to the system without the addition of the tail and the corresponding plots are provided in Fig. 10 to allow direct comparison. Figure 11 furthermore provides snapshots for the simulations found in Figs. 9(a) and 10(a). It is clear that the quadruped robot with the tail and the proposed control algorithm can successfully reach the final target in the presence of the aforementioned disturbance, whereas its counterpart without the tail cannot reach the target destination.

Fig. 9
Time profiles of the outputs (i.e., virtual constraints) and joint torques for quadrupedal locomotion with the robotic tail subject to various pulse disturbances, all beginning at 3.5 (s) and lasting 200 (ms). The proposed controller can successfully reject the effect of disturbances while keeping the output and input profiles bounded. (a) Closed-loop system's behavior for a forward trot gait subject to a pulse disturbance of −75 (N) in the y direction. (b) Closed-loop system's behavior for a forward trot gait subject to a pulse disturbance of 100 (N) in the forward direction. (c) Closed-loop system's behavior for a diagonal trot gait subject to a pulse disturbance of 75 (N) orthogonal to the direction of locomotion in the xy-plane. (d) Closed-loop system's behavior for a diagonal trot gait subject to a pulse disturbance of 110 (N) opposing the direction of locomotion.
Fig. 9
Time profiles of the outputs (i.e., virtual constraints) and joint torques for quadrupedal locomotion with the robotic tail subject to various pulse disturbances, all beginning at 3.5 (s) and lasting 200 (ms). The proposed controller can successfully reject the effect of disturbances while keeping the output and input profiles bounded. (a) Closed-loop system's behavior for a forward trot gait subject to a pulse disturbance of −75 (N) in the y direction. (b) Closed-loop system's behavior for a forward trot gait subject to a pulse disturbance of 100 (N) in the forward direction. (c) Closed-loop system's behavior for a diagonal trot gait subject to a pulse disturbance of 75 (N) orthogonal to the direction of locomotion in the xy-plane. (d) Closed-loop system's behavior for a diagonal trot gait subject to a pulse disturbance of 110 (N) opposing the direction of locomotion.
Close modal
Fig. 10
Time profiles of the outputs (i.e., virtual constraints) and joint torques for quadrupedal locomotion without the robotic tail subject to various pulse disturbances, all beginning at 3.5 (s) and lasting 200 (ms). Here, we use the same disturbances that are applied to the system with the robotic tail in Fig. 9. The instability of the gaits is clear. In particular, the outputs diverge after a while with the torques reaching the maximum values. (a) System's behavior for a forward trot gait subject to a pulse disturbance of −75 (N) in the y direction. (b) System's behavior for a forward trot gait subject to a pulse disturbance of 100 (N) in the forward direction. (c) System's behavior for a diagonal trot gait subject to a pulse disturbance of 75 (N) orthogonal to the direction of locomotion. (d) System's behavior for a diagonal trot gait subject to a pulse disturbance of 110 (N) opposing the direction of locomotion.
Fig. 10
Time profiles of the outputs (i.e., virtual constraints) and joint torques for quadrupedal locomotion without the robotic tail subject to various pulse disturbances, all beginning at 3.5 (s) and lasting 200 (ms). Here, we use the same disturbances that are applied to the system with the robotic tail in Fig. 9. The instability of the gaits is clear. In particular, the outputs diverge after a while with the torques reaching the maximum values. (a) System's behavior for a forward trot gait subject to a pulse disturbance of −75 (N) in the y direction. (b) System's behavior for a forward trot gait subject to a pulse disturbance of 100 (N) in the forward direction. (c) System's behavior for a diagonal trot gait subject to a pulse disturbance of 75 (N) orthogonal to the direction of locomotion. (d) System's behavior for a diagonal trot gait subject to a pulse disturbance of 110 (N) opposing the direction of locomotion.
Close modal
Fig. 11
Snapshots of the quadrupedal locomotion with and without robotic tails and subject to the pulse-like disturbance in RaiSim. (a) Snapshots for the closed-loop system's behavior with the robotic tail as simulated in Fig. 9(a). Here, we consider a forward trot gait subject to a pulse disturbance of −75 (N) in the y direction, starting at 3.5 (s) and lasting 200 (ms). (b) Snapshots for the system's behavior without the robotic tail and the same disturbance as simulated in Fig. 10(a). The arrow illustrates the disturbance. The instability of the gait without the tail is clear.
Fig. 11
Snapshots of the quadrupedal locomotion with and without robotic tails and subject to the pulse-like disturbance in RaiSim. (a) Snapshots for the closed-loop system's behavior with the robotic tail as simulated in Fig. 9(a). Here, we consider a forward trot gait subject to a pulse disturbance of −75 (N) in the y direction, starting at 3.5 (s) and lasting 200 (ms). (b) Snapshots for the system's behavior without the robotic tail and the same disturbance as simulated in Fig. 10(a). The arrow illustrates the disturbance. The instability of the gait without the tail is clear.
Close modal

It is important to note that the ability for the closed-loop system to reject a pulse disturbance is greatly influenced by when the disturbance is applied. Specifically, it depends on what point in the gait cycle the robot is currently in, and the state of the tail at that point. With this in mind, we aim to quantify the level of improvement the tail adds by considering a forward trot with a lateral pulse, where the pulse is applied at different times. In this regard, twelve different simulations were conducted, where in each simulation the pulse was applied 0.1 (s) later than the previous simulation. During each test, the largest magnitude pulse that the system was able to withstand while still reaching the target destination was recorded. On average, the system including the tail was able to sustain 61.7 (N) while still being able to reach the target destination which is an increase of 32.6% compared to its tailless counterpart. A similar procedure was done for the diagonal trot but was instead subject to a disturbance orthogonal to the direction of locomotion (i.e., along the unit vector (0.4961,0.8682,0)). The system with the tail could reject a pulse of 83.4 (N) on average. This is a 25.6% increase in magnitude compared to the system without the tail.

6.2.2 Time-Varying Disturbance Rejection.

In this section, we consider four additional simulations in which the system is subject to a persistent time-varying disturbance. Similar to the pulse disturbances, we first investigate two forward trots, and then two diagonal trots, each subject to a different persistent disturbance. For each simulation, we note the largest magnitude at which the system can walk for 80 continuous-time domains both with and without the tail in order to compare the results. In the first scenario, we consider a forward trot gait with a lateral disturbance of the form βsin(4t), where the largest magnitude the system with the tail could withstand was β=21.5 (N), which is 35.2% larger than the system without the tail. We then consider a second simulation of the forward trot gait subject to a disturbance of the form β(sin(4t),cos(4t)) in the x and y directions. In this case, the system with the tail could reject a maximum of β = 11 (N) while still being able to walk for 80 domains, up from β=7.4 (N) without the tail. Figures 12(a) and 12(b) depict the closed-loop system's behavior for the forward trot gait subject to the aforementioned time-varying disturbances. Finally, we consider two different simulations with a diagonal trot, where each system is subject to a disturbance of the form βsin(4t) but in different directions. During the first diagonal simulation, the disturbance acts along the direction of motion (i.e., along the unit vector (0.8682,0.4961,0)), and in the latter, the disturbance acts along the unit vector (0.8682,0.4961,0). During these simulations, the system could reject β=14.3 and β = 18 (N), which is an increase of 20.2% and 73% compared to the tailless system, respectively. Figures 12(c) and 12(d) illustrate the time profiles of the virtual constraints and joint torques for these simulations. In order to demonstrate the robustness of the closed-loop system with the tail mechanism, Fig. 13 contains the same simulations having been performed on the system without the tail. In addition, Figs. 14(a) and 14(b) provide snapshots of the simulations corresponding to Figs. 12(b) and 13(b), respectively. Animations of these simulations can be found online.5

Fig. 12
Time profiles of the outputs (i.e., virtual constraints) and joint torques for quadrupedal locomotion with the robotic tail subject to various sinusoidal disturbances. The proposed controller can successfully reject the effect of time-varying disturbances while keeping the output and input profiles bounded. (a) Closed-loop system's behavior for a forward trot gait subject to a disturbance of the form 18 sin(4t) (N) in the y direction. (b) Closed-loop system's behavior for a forward trot gait subject to a disturbance of the form (8.5 sin(4t),8.5 cos(4t)) (N) in the x and y directions, respectively. (c) Closed-loop system's behavior for a diagonal trot gait subject to a disturbance of the form 13 sin(4t) (N) along the direction of locomotion. (d) Closed-loop system's behavior for a diagonal trot gait subject to a disturbance of the form 13 sin(4t) (N) along the unit vector (0.8682,−0.4961,0).
Fig. 12
Time profiles of the outputs (i.e., virtual constraints) and joint torques for quadrupedal locomotion with the robotic tail subject to various sinusoidal disturbances. The proposed controller can successfully reject the effect of time-varying disturbances while keeping the output and input profiles bounded. (a) Closed-loop system's behavior for a forward trot gait subject to a disturbance of the form 18 sin(4t) (N) in the y direction. (b) Closed-loop system's behavior for a forward trot gait subject to a disturbance of the form (8.5 sin(4t),8.5 cos(4t)) (N) in the x and y directions, respectively. (c) Closed-loop system's behavior for a diagonal trot gait subject to a disturbance of the form 13 sin(4t) (N) along the direction of locomotion. (d) Closed-loop system's behavior for a diagonal trot gait subject to a disturbance of the form 13 sin(4t) (N) along the unit vector (0.8682,−0.4961,0).
Close modal
Fig. 13
Time profiles of the outputs (i.e., virtual constraints) and joint torques for quadrupedal locomotion without the robotic tail subject to various sinusoidal disturbances. Here, we utilize the same time-varying disturbances that are applied to the system augmented with the robotic tail in Fig. 12. The instability of the gaits is clear. In particular, the outputs diverge after a while with the torques reaching the maximum values. (a) System's behavior for a forward trot gait subject to a disturbance of the form 18 sin(4t) (N) in the y direction. (b) System's behavior for a forward trot gait subject to a disturbance of the form (8.5 sin(4t),8.5 cos(4t)) (N) in the x and y directions, respectively. (c) System's behavior for a diagonal trot gait subject to a disturbance of the form 13 sin(4t) (N) along the direction of locomotion. (d) System's behavior for a diagonal trot gait subject to a disturbance of the form 13 sin(4t) (N) along the unit vector (0.8682,−0.4961,0).
Fig. 13
Time profiles of the outputs (i.e., virtual constraints) and joint torques for quadrupedal locomotion without the robotic tail subject to various sinusoidal disturbances. Here, we utilize the same time-varying disturbances that are applied to the system augmented with the robotic tail in Fig. 12. The instability of the gaits is clear. In particular, the outputs diverge after a while with the torques reaching the maximum values. (a) System's behavior for a forward trot gait subject to a disturbance of the form 18 sin(4t) (N) in the y direction. (b) System's behavior for a forward trot gait subject to a disturbance of the form (8.5 sin(4t),8.5 cos(4t)) (N) in the x and y directions, respectively. (c) System's behavior for a diagonal trot gait subject to a disturbance of the form 13 sin(4t) (N) along the direction of locomotion. (d) System's behavior for a diagonal trot gait subject to a disturbance of the form 13 sin(4t) (N) along the unit vector (0.8682,−0.4961,0).
Close modal
Fig. 14
Snapshots of the quadrupedal locomotion with and without robotic tails and subject to a persistent sinusoidal disturbance in RaiSim. (a) Snapshots for the closed-loop system's behavior with the robotic tail as simulated in Fig. 12(b). Here, we consider a forward trot gait subject to a time-varying disturbance of the form (8.5 sin(4t),8.5 cos(4t)) (N) in the x and y directions. (b) Snapshots for the system's behavior without the robotic tail and the same disturbance as simulated in Fig. 13(b). The arrow illustrates the disturbance. The instability of the gait without the tail is clear.
Fig. 14
Snapshots of the quadrupedal locomotion with and without robotic tails and subject to a persistent sinusoidal disturbance in RaiSim. (a) Snapshots for the closed-loop system's behavior with the robotic tail as simulated in Fig. 12(b). Here, we consider a forward trot gait subject to a time-varying disturbance of the form (8.5 sin(4t),8.5 cos(4t)) (N) in the x and y directions. (b) Snapshots for the system's behavior without the robotic tail and the same disturbance as simulated in Fig. 13(b). The arrow illustrates the disturbance. The instability of the gait without the tail is clear.
Close modal

7 Discussion

The numerical studies and full-order simulations of this paper show significant improvements in rejecting both pulse-like and time-varying disturbances during quadrupedal locomotion integrated with robotic tails and the proposed control algorithms. The amount of improvements depends largely on the gait and the properties of the disturbance applied. The tail mechanism integrated with the proposed hierarchical control algorithm has been shown to allow the closed-loop system to withstand pulse-like disturbances up to 32.6% and 25.6% greater in magnitude during forward and diagonal trots when compared to a system without a tail. Furthermore, the tailed closed-loop system was able to withstand persistent perturbations up to 21.5% and 73% greater in magnitude during forward and diagonal trots, respectively.

It is noteworthy that the tail does not produce aggressive motions in order to reject disturbances. However, because of the nonlinearities of the tail dynamics, it only takes a small angular deflection at the base of the yaw links to deflect the end effector of the tail greatly. In addition, the gaits provided are quasi-static gaits where it stands to reason that the tail motions would be quasi-static as well. In a more aggressive gait, the tail would likely produce faster motions of larger amplitude. Furthermore, the roll of the tail remains relatively constant throughout the gait which indicates that the yaw portion of the tail is more important in maintaining robust and stable locomotion on flat ground.

While increasing the complexity of the reduced-order model to a nonlinear template model such as the inverted pendulum model [80] or spring-loaded inverted pendulum model [19] could potentially offer increased performance, it comes at the cost of increased computational demand. More specifically, these templates necessitate solving a nonlinear programming in real-time for path planning which significantly increases the computational demand compared to working with a linearized model. Furthermore, in the case of quasi-static quadrupedal locomotion, the assumption that the COM height remains constant is a very good approximation as shown by simulation results above, making the LIP model a suitable choice for the reduced-order model. During more agile locomotion where these assumptions might be violated, a more complex reduced-order model could play a larger role in increasing robustness. However, for the quasi-static case with multicontact domains considered here, the additional tail hardware can play a larger role in attenuating disturbance forces applied to the robot than increasing model complexity due to the tails ability to directly apply forces to the body of the robot to reject said disturbances.

The numerical results above have shown that the event-based framework coupled with the assumption that the roll, pitch, and yaw of the body are zero, along with the height of the COM being constant, leads to robust locomotion when maneuvering over flat, even terrain. In particular, under these conditions, linearizing the extended LIP model once per domain is sufficient due to the quasi-static nature of the gait and small deflections of the tail. However, the high-level path planner in its current form would likely need to be altered in order to address more complex environments wherein the terrain is unknown or unstructured. This is largely due to several reasons, the first being that in the current framework the desired foot locations are calculated offline, the second being that moving up or down slopes would inherently violate the assumptions regarding the COM height and body orientation, and finally, the event-based linearization/planning may not be sufficient to adequately plan for locomotion along unstructured terrain considering higher planning rates are typically required when the environment is not well known.

8 Conclusion

This paper presented a formal foundation to design hierarchical and nonlinear feedback control algorithms that effectively couple bio-inspired articulated tails with legged robots to produce robust locomotion patterns in the presence of external disturbances. The proposed control approach utilizes a high-level and real-time path planner, based on an event-based MPC, to compute the optimal robot's COM and tail trajectories for an innovative reduced-order model, referred to as the extended LIP dynamics. The MPC problem considers the feasibility of the net GRF and the tail's motion during the steering problem of the extended LIP model. A nonlinear whole-body motion controller, based on virtual constraints and QP, is then utilized in the lower-level of the control scheme to impose the full-order dynamical model of locomotion to track the optimal and reduced-order trajectories prescribed by the MPC, while ensuring the feasibility of the GRFs at the contacting legs. The potential of the proposed control approach was demonstrated through a variety of full-order simulations for an 18DOF quadruped robot augmented with a 2DOF serpentine tail. It is shown that the proposed control solution integrated with the tail dynamics can significantly reduce the effect of disturbances on quadrupedal locomotion.

For future research, we will extend the framework to more agile gaits wherein the tail could have an even greater impact on the overall stability of locomotion. We will also study alternative tail designs with different structures and DOF to further investigate the effects of tails on quadrupedal locomotion. Moreover, we will experimentally employ the developed control algorithms for locomotion of the Vision 60 platform coupled with a robotic tail. Finally, we will consider extending the proposed framework to uneven, unstructured, and sloped terrain to allow for greater versatility.

Acknowledgment

This material is based upon work supported by the National Science Foundation (NSF) under Grant Numbers CMMI-1906727 and CMMI-1923216. The content is solely the responsibility of the authors and does not necessarily represent the official views of the NSF.

Funding Data

  • National Science Foundation (NSF) (Grant Nos. CMMI-1906727 and CMMI-1923216; Funder ID: 10.13039/100000001).

Nomenclature

B(.),Jb(.) =

input distribution matrix, Jacobian matrix at the base of the tail

D(.),H(.) =

mass inertia matrix, nonlinear vector (i.e. Coriolis, centrifugal, and gravitational terms)

(f, g, w) =

vector fields of the affine continuous-time dynamics

Ft, Mt =

forces at the base of the tail, moments at the base of the tail

Fx, Fy, Fz =

forces in the x, y, and z directions

LgLf,LwLf,Lf2 =

lie derivatives along the continuous-time dynamics

M, n =

total number of continuous-time domains, number of continuous-time domains to plan over

Mr, Mp, My =

moments in the roll, pitch, and yaw directions

Nd, Nc, Ts =

number of grid points to plan over, control horizon, time-step between grid points

qr, qt, z =

configuration and state variables for the robot, the tail, and the augmented system

W, A(.), N, d =

extended LIP weighting matrix, state matrix, nonlinear vector function, and vector of constants

x, u =

state variables for the extended LIP model including tail dynamics, and inputs to the extended LIP model including tail dynamics

x0, x˙0, u0 =

operating points around which the augmented LIP model is linearized

xko,x˙ko,uko =

state and input variables for the original and extended reduced-order system at time k

y, h0, hd =

holonomic output function, holonomic control variables, and desired evolution of controlled variables

ζ[k],Uζ[k] =

current domain function, convex hull formed by stance legs

θroll,θyaw =

internal roll and yaw angles of the tail

λc, λt =

ground reaction forces, tail wrench

τroll,τyaw =

torques applied to the roll and yaw actuators of the tail

τr, τt, τ =

inputs to the robot, the tail, and the augmented system

(.)com,(.)cop =

variables corresponding to the COM having been projected onto the xy-plane, and variables corresponding to the center of pressure (COP)

(.)r,(.)t =

variables corresponding to the robot, and variables corresponding to the tail

(.),(.)d =

variables corresponding to the linearized system, and variables corresponding to the discretized system

Footnotes

4

Due to the nature of the floating base coordinates, the upper-left 3 × 3 block of the D matrix is diagonalized.

References

1.
Vukobratović
,
M.
,
Borovac
,
B.
, and
Surla
,
D.
,
1990
,
Dynamics of Biped Locomotion
,
Springer
,
Berlin
.
2.
Goswami
,
A.
,
1999
, “
Postural Stability of Biped Robots and the Foot-Rotation Indicator (FRI) Point
,”
Int. J. Rob. Res.
,
18
(
6
), pp.
523
533
.10.1177/02783649922066376
3.
Haddad
,
W.
,
Chellaboina
,
V.
, and
Nersesov
,
S.
,
2006
,
Impulsive and Hybrid Dynamical Systems: Stability, Dissipativity, and Control
,
Princeton University Press
,
Princeton, NJ
.
4.
Goebel
,
R.
,
Sanfelice
,
R.
, and
Teel
,
A.
,
2012
,
Hybrid Dynamical Systems: Modeling, Stability, and Robustness
,
Princeton University Press
,
Princeton, NJ
.
5.
Grizzle
,
J.
,
Abba
,
G.
, and
Plestan
,
F.
,
2001
, “
Asymptotically Stable Walking for Biped Robots: Analysis Via Systems With Impulse effects
,”
IEEE Trans. Autom. Control
,
46
(
1
), pp.
51
64
.10.1109/9.898695
6.
Chevallereau
,
C.
,
Grizzle
,
J.
, and
Shih
,
C.-L.
,
2009
, “
Asymptotically Stable Walking of a five-Link Underactuated 3-D Bipedal Robot
,”
IEEE Trans. Rob.
,
25
(
1
), pp.
37
50
.10.1109/TRO.2008.2010366
7.
Ames
,
A.
,
Galloway
,
K.
,
Sreenath
,
K.
, and
Grizzle
,
J.
,
2014
, “
Rapidly Exponentially Stabilizing Control Lyapunov Functions and Hybrid Zero Dynamics
,”
IEEE Trans. Autom. Control
,
59
(
4
), pp.
876
891
.10.1109/TAC.2014.2299335
8.
Spong
,
M.
, and
Bullo
,
F.
,
2005
, “
Controlled Symmetries and Passive Walking
,”
IEEE Trans. Autom. Control
,
50
(
7
), pp.
1025
1031
.10.1109/TAC.2005.851449
9.
Spong
,
M.
,
Holm
,
J.
, and
Lee
,
D.
,
2007
, “
Passivity-Based Control of Bipedal Locomotion
,”
IEEE Rob. Autom. Mag.
,
14
(
2
), pp.
30
40
.10.1109/MRA.2007.380638
10.
Manchester
,
I.
,
Mettin
,
U.
,
Iida
,
F.
, and
Tedrake
,
R.
,
2011
, “
Stable Dynamic Walking Over Uneven Terrain
,”
Int. J. Rob. Res.
,
30
(
3
), pp.
265
279
.10.1177/0278364910395339
11.
Dai
,
H.
, and
Tedrake
,
R.
,
2013
, “
L 2-Gain Optimization for Robust Bipedal Walking on Unknown Terrain
,”
IEEE International Conference on Robotics and Automation
, Karlsruhe, Germany, May 6–10, pp.
3116
3123
.10.1109/ICRA.2013.6631010
12.
Song
,
G.
, and
Zefran
,
M.
,
2006
, “
Underactuated Dynamic Three-Dimensional Bipedal Walking
,”
IEEE International Conference on Robotics and Automation
, Orlando, FL, May 15–19, pp.
854
859
.10.1109/ROBOT.2006.1641816
13.
Gregg
,
R.
, and
Righetti
,
L.
,
2013
, “
Controlled Reduction With Unactuated Cyclic Variables: Application to 3D Bipedal Walking With Passive Yaw Rotation
,”
IEEE Trans. Autom. Control
,
58
(
10
), pp.
2679
2685
.10.1109/TAC.2013.2256011
14.
Byl
,
K.
, and
Tedrake
,
R.
,
2008
, “
Approximate Optimal Control of the Compass Gait on Rough Terrain
,”
IEEE
International Conference on Robotics and Automation, Pasadena, CA, May 19–23, pp.
1258
1263
.10.1109/ROBOT.2008.4543376
15.
Akbari Hamed
,
K.
, and
Gregg
,
R. D.
,
2019
, “
Decentralized Event-Based Controllers for Robust Stabilization of Hybrid Periodic Orbits: Application to Underactuated 3D Bipedal Walking
,”
IEEE Trans. Autom. Control
,
64
(
6
), pp.
2266
2281
.10.1109/TAC.2018.2863184
16.
Akbari Hamed
,
K.
, and
Grizzle
,
J.
,
2014
, “
Event-Based Stabilization of Periodic Orbits for Underactuated 3-D Bipedal Robots With Left-Right Symmetry
,”
IEEE Trans. Rob.
,
30
(
2
), pp.
365
381
.10.1109/TRO.2013.2287831
17.
Chevallereau
,
C.
,
Abba
,
G.
,
Aoustin
,
Y.
,
Plestan
,
F.
,
Westervelt
,
E.
,
Canudas-de Wit
,
C.
, and
Grizzle
,
J.
,
2003
, “
RABBIT: A Testbed for Advanced Control Theory
,”
IEEE Control Syst. Mag.
,
23
(
5
), pp.
57
79
.10.1109/MCS.2003.1234651
18.
Morris
,
B.
, and
Grizzle
,
J.
,
2009
, “
Hybrid Invariant Manifolds in Systems With Impulse Effects With Application to Periodic Locomotion in Bipedal Robots
,”
IEEE Trans. Autom. Control
,
54
(
8
), pp.
1751
1764
.10.1109/TAC.2009.2024563
19.
Poulakakis
,
I.
, and
Grizzle
,
J.
,
2009
, “
The Spring Loaded Inverted Pendulum as the Hybrid Zero Dynamics of an Asymmetric Hopper
,”
IEEE Trans. Autom. Control
,
54
(
8
), pp.
1779
1793
.10.1109/TAC.2009.2024565
20.
Sreenath
,
K.
,
Park
,
H.-W.
,
Poulakakis
,
I.
, and
Grizzle
,
J. W.
,
2011
, “
Compliant Hybrid Zero Dynamics Controller for Achieving Stable, Efficient and Fast Bipedal Walking on MABEL
,”
Int. J. Rob. Res.
,
30
(
9
), pp.
1170
1193
.10.1177/0278364910379882
21.
Collins
,
S.
,
Ruina
,
A.
,
Tedrake
,
R.
, and
Wisse
,
M.
,
2005
, “
Efficient Bipedal Robots Based on Passive-Dynamic Walkers
,”
Science
,
307
(
5712
), pp.
1082
1085
.10.1126/science.1107799
22.
Johnson
,
A. M.
,
Burden
,
S. A.
, and
Koditschek
,
D. E.
,
2016
, “
A Hybrid Systems Model for Simple Manipulation and Self-Manipulation Systems
,”
Int. J. Rob. Res.
,
35
(
11
), pp.
1354
1392
.10.1177/0278364916639380
23.
Burden
,
S. A.
,
Sastry
,
S. S.
,
Koditschek
,
D. E.
, and
Revzen
,
S.
,
2016
, “
Event–Selected Vector Field Discontinuities Yield Piecewise–Differentiable Flows
,”
SIAM J. Appl. Dyn. Syst.
,
15
(
2
), pp.
1227
1267
.10.1137/15M1016588
24.
Vasudevan
,
R.
,
2017
,
Hybrid System Identification Via Switched System Optimal Control for Bipedal Robotic Walking
,
Springer International Publishing
,
Cham, Switzerland
, pp.
635
650
.
25.
Veer
,
S.
,
Rakesh
., and
Poulakakis
,
I.
,
2019
, “
Input-to-State Stability of Periodic Orbits of Systems With Impulse Effects Via Poincaré Analysis
,”
IEEE Trans. Autom. Control
,
64
(
11
), pp.
4583
4598
.10.1109/TAC.2019.2909684
26.
Hereid
,
A.
,
Hubicki
,
C. M.
,
Cousineau
,
E. A.
, and
Ames
,
A. D.
,
2018
, “
Dynamic Humanoid Locomotion: A Scalable Formulation for HZD Gait Optimization
,”
IEEE Trans. Rob.
,
34
(
2
), pp.
370
387
.10.1109/TRO.2017.2783371
27.
Posa
,
M.
,
Tobenkin
,
M.
, and
Tedrake
,
R.
,
2016
, “
Stability Analysis and Control of Rigid-Body Systems With Impacts and Friction
,”
IEEE Trans. Autom. Control
,
61
(
6
), pp.
1423
1437
.10.1109/TAC.2015.2459151
28.
Hurmuzlu
,
Y.
, and
Marghitu
,
D. B.
,
1994
, “
Rigid Body Collisions of Planar Kinematic Chains With Multiple Contact Points
,”
Int. J. Rob. Res.
,
13
(
1
), pp.
82
92
.10.1177/027836499401300106
29.
Akbari Hamed
,
K.
,
Safaee
,
B.
, and
Gregg
,
R. D.
,
2019
, “
Dynamic Output Controllers for Exponential Stabilization of Periodic Orbits for Multi-Domain Hybrid Models of Robotic Locomotion
,”
ASME J. Dyn. Syst. Meas. Control
,
141
(
12
), p.
121011
.10.1115/1.4044618
30.
Ames
,
A. D.
,
Gregg
,
R. D.
,
Wendel
,
E. D. B.
, and
Sastry
,
S.
,
2007
, “
On the Geometric Reduction of Controlled Three-Dimensional Bipedal Robotic Walkers
,”
Lagrangian and Hamiltonian Methods for Nonlinear Control
,
Springer
,
Berlin, pp.
183
196
.
31.
Gregg
,
R. D.
, and
Spong
,
M. W.
,
2010
, “
Reduction-Based Control of Three-Dimensional Bipedal Walking Robots
,”
Int. J. Rob. Res.
,
29
(
6
), pp.
680
702
.10.1177/0278364909104296
32.
Shiriaev
,
A.
,
Freidovich
,
L.
, and
Gusev
,
S.
,
2010
, “
Transverse Linearization for Controlled Mechanical Systems With Several Passive Degrees of Freedom
,”
IEEE Trans. Autom. Control
,
55
(
4
), pp.
893
906
.10.1109/TAC.2010.2042000
33.
Westervelt
,
E.
,
Grizzle
,
J.
, and
Koditschek
,
D.
,
2003
, “
Hybrid Zero Dynamics of Planar Biped Walkers
,”
IEEE Trans. Autom. Control
,
48
(
1
), pp.
42
56
.10.1109/TAC.2002.806653
34.
Westervelt
,
E.
,
Grizzle
,
J.
,
Chevallereau
,
C.
,
Choi
,
J.
, and
Morris
,
B.
,
2007
,
Feedback Control of Dynamic Bipedal Robot Locomotion
,
Taylor & Francis/CRC
,
Boca Raton, FL
.
35.
Isidori
,
A.
,
1995
,
Nonlinear Control Systems
, 3rd ed.,
Springer
,
Verlag, London
.
36.
Sreenath
,
K.
,
Park
,
H.-W.
,
Poulakakis
,
I.
, and
Grizzle
,
J.
,
2013
, “
Embedding Active Force Control Within the Compliant Hybrid Zero Dynamics to Achieve Stable, Fast Running on MABEL
,”
Int. J. Rob. Res.
,
32
(
3
), pp.
324
345
.10.1177/0278364912473344
37.
Martin
,
A. E.
,
Post
,
D. C.
, and
Schmiedeler
,
J. P.
,
2014
, “
The Effects of Foot Geometric Properties on the Gait of Planar Bipeds Walking Under HZD-Based Control
,”
Int. J. Rob. Res.
,
33
(
12
), pp.
1530
1543
.10.1177/0278364914532391
38.
Ramezani
,
A.
,
Hurst
,
J. W.
,
Akbari Hamed
,
K.
, and
Grizzle
,
J. W.
,
2014
, “
Performance Analysis and Feedback Control of ATRIAS, A Three-Dimensional Bipedal Robot
,”
ASME J. Dyn. Syst. Meas. Control
,
136
(
2
), p.
021012
.10.1115/1.4025693
39.
Akbari Hamed
,
K.
,
Buss
,
B.
, and
Grizzle
,
J.
,
2016
, “
Exponentially Stabilizing Continuous-Time Controllers for Periodic Orbits of Hybrid Systems: Application to Bipedal Locomotion With Ground Height Variations
,”
Int. J. Rob. Res.
,
35
(
8
), pp.
977
999
.10.1177/0278364915593400
40.
Akbari Hamed
,
K.
,
Ma
,
W.
, and
Ames
,
A. D.
,
2019
, “
Dynamically Stable 3D Quadrupedal Walking With Multi-Domain Hybrid System Models and Virtual Constraint Controllers
,” American Control Conference (
ACC
), Philadelphia, PA, July 10–12, pp.
4588
4595
.10.23919/ACC.2019.8815085
41.
Cao
,
Q.
, and
Poulakakis
,
I.
,
2016
, “
Quadrupedal Running With a Flexible Torso: Control and Speed Transitions With Sums-of-Squares Verification
,”
Artif. Life Rob.
,
21
(
4
), pp.
384
392
.10.1007/s10015-016-0330-5
42.
Akbari Hamed
,
K.
,
Kim
,
J.
, and
Pandala
,
A.
,
2020
, “
Quadrupedal Locomotion Via Event-Based Predictive Control and QP-Based Virtual Constraints
,”
IEEE Rob. Autom. Lett.
,
5
(
3
), pp.
4463
4470
.10.1109/LRA.2020.3001471
43.
Gregg
,
R.
, and
Sensinger
,
J.
,
2014
, “
Towards Biomimetic Virtual Constraint Control of a Powered Prosthetic Leg
,”
IEEE Trans. Control Syst. Technol.
,
22
(
1
), pp.
246
254
.10.1109/TCST.2012.2236840
44.
Zhao
,
H.
,
Horn
,
J.
,
Reher
,
J.
,
Paredes
,
V.
, and
Ames
,
A. D.
,
2017
, “
First Steps Toward Translating Robotic Walking to Prostheses: A Nonlinear Optimization Based Control Approach
,”
Auton. Rob.
,
41
(
3
), pp.
725
742
.10.1007/s10514-016-9565-1
45.
Martin
,
A. E.
, and
Gregg
,
R. D.
,
2017
, “
Stable, Robust Hybrid Zero Dynamics Control of Powered Lower-Limb Prostheses
,”
IEEE Trans. Autom. Control
,
62
(
8
), pp.
3930
3942
.10.1109/TAC.2017.2648040
46.
Agrawal
,
A.
,
Harib
,
O.
,
Hereid
,
A.
,
Finet
,
S.
,
Masselin
,
M.
,
Praly
,
L.
,
Ames
,
A.
,
Sreenath
,
K.
, and
Grizzle
,
J.
,
2017
, “
First Steps Towards Translating HZD Control of Bipedal Robots to Decentralized Control of Exoskeletons
,”
IEEE Access
,
5
, pp.
9919
9934
.10.1109/ACCESS.2017.2690407
47.
Hereid
,
A.
, and
Ames
,
A. D.
,
2017
, “
FROST: Fast Robot Optimization and Simulation Toolkit
,”
IEEE/RSJ International Conference on Intelligent Robots and Systems
, Vancouver, BC, Canada, Sept. 24–28, pp.
719
726
.10.1109/IROS.2017.8202230
48.
Griffin
,
R. J.
,
Wiedebach
,
G.
,
Bertrand
,
S.
,
Leonessa
,
A.
, and
Pratt
,
J.
,
2017
, “
Walking Stabilization Using Step Timing and Location Adjustment on the Humanoid Robot, Atlas
,”
IEEE/RSJ International Conference on Intelligent Robots and Systems
, Vancouver, BC, Canada, Sept. 24–28, pp.
667
673
.10.1109/IROS.2017.8202223
49.
Pratt
,
J.
,
Carff
,
J.
,
Drakunov
,
S.
, and
Goswami
,
A.
,
2006
, “
Capture Point: A Step Toward Humanoid Push Recovery
,”
Sixth IEEE-RAS International Conference on Humanoid Robots
, Genoa, Italy, Dec. 4–6, pp.
200
207
.10.1109/ICHR.2006.321385
50.
Englsberger
,
J.
,
Ott
,
C.
,
Roa
,
M. A.
,
Albu-Schäffer
,
A.
, and
Hirzinger
,
G.
,
2011
, “
Bipedal Walking Control Based on Capture Point Dynamics
,”
IEEE/RSJ International Conference on Intelligent Robots and Systems
, San Francisco, CA, Sept. 25–30, pp.
4420
4427
.10.1109/IROS.2011.6094435
51.
Kajita
,
S.
,
Kanehiro
,
F.
,
Kaneko
,
K.
,
Fujiwara
,
K.
,
Harada
,
K.
,
Yokoi
,
K.
, and
Hirukawa
,
H.
,
2003
, “
Biped Walking Pattern Generation by Using Preview Control of Zero-Moment Point
,”
IEEE International Conference on Robotics and Automation
, Vol.
2
, Taipei, Taiwan, Sept. 14–19, pp.
1620
1626.
10.1109/ROBOT.2003.1241826
52.
Di Carlo
,
J.
,
Wensing
,
P. M.
,
Katz
,
B.
,
Bledt
,
G.
, and
Kim
,
S.
,
2018
, “
Dynamic Locomotion in the MIT Cheetah 3 Through Convex Model-Predictive Control
,”
IEEE/RSJ International Conference on Intelligent Robots and Systems
, Madrid, Spain, Oct. 1–5, pp.
1
9
.10.1109/IROS.2018.8594448
53.
Ding
,
Y.
,
Pandala
,
A.
, and
Park
,
H.
,
2019
, “
Real-Time Model Predictive Control for Versatile Dynamic Motions in Quadrupedal Robots
,”
International Conference on Robotics and Automation
, Montreal, QC, Canada, May 20–24, pp.
8484
8490
.10.1109/ICRA.2019.8793669
54.
Neunert
,
M.
,
Stäuble
,
M.
,
Giftthaler
,
M.
,
Bellicoso
,
C. D.
,
Carius
,
J.
,
Gehring
,
C.
,
Hutter
,
M.
, and
Buchli
,
J.
,
2018
, “
Whole-Body Nonlinear Model Predictive Control Through Contacts for Quadrupeds
,”
IEEE Rob. Autom. Lett.
,
3
(
3
), pp.
1458
1465
.10.1109/LRA.2018.2800124
55.
Bledt
,
G.
,
Wensing
,
P. M.
, and
Kim
,
S.
,
2017
, “
Policy-Regularized Model Predictive Control to Stabilize Diverse Quadrupedal Gaits for the Mit Cheetah
,”
IEEE/RSJ International Conference on Intelligent Robots and Systems
, Vancouver, BC, Canada, Sept. 24–28, pp.
4102
4109
.10.1109/IROS.2017.8206268
56.
Fahmi
,
S.
,
Mastalli
,
C.
,
Focchi
,
M.
, and
Semini
,
C.
,
2019
, “
Passive Whole-Body Control for Quadruped Robots: Experimental Validation Over Challenging Terrain
,”
IEEE Rob. Autom. Lett.
,
4
(
3
), pp.
2553
2560
.10.1109/LRA.2019.2908502
57.
Kuindersma
,
S.
,
Permenter
,
F.
, and
Tedrake
,
R.
,
2014
, “
An Efficiently Solvable Quadratic Program for Stabilizing Dynamic Locomotion
,”
IEEE International Conference on Robotics and Automation
, Hong Kong, China, pp.
2589
2594
.
58.
Winkler
,
A. W.
,
Farshidian
,
F.
,
Pardo
,
D.
,
Neunert
,
M.
, and
Buchli
,
J.
,
2017
, “
Fast Trajectory Optimization for Legged Robots Using Vertex-Based ZMP Constraints
,”
IEEE Rob. Autom. Lett.
,
2
(
4
), pp.
2201
2208
.10.1109/LRA.2017.2723931
59.
Lehmann
,
D.
,
Henriksson
,
E.
, and
Johansson
,
K. H.
,
2013
, “
Event-Triggered Model Predictive Control of Discrete-Time Linear Systems Subject to Disturbances
,” European Control Conference (
ECC
), Zurich, Switzerland, July 17–18, pp.
1156
1161
.10.23919/ECC.2013.6669580
60.
Libby
,
T.
,
Moore
,
T. Y.
,
Chang-Siu
,
E.
,
Li
,
D.
,
Cohen
,
D. J.
,
Jusufi
,
A.
, and
Full
,
R. J.
,
2012
, “
Tail-Assisted Pitch Control in Lizards, Robots and Dinosaurs
,”
Nature
,
481
(
7380
), pp.
181
187
.10.1038/nature10710
61.
Jusufi
,
A.
,
Kawano
,
D. T.
,
Libby
,
T.
, and
Full
,
R. J.
,
2010
, “
Righting and Turning in Mid-Air Using Appendage Inertia: Reptile Tails, Analytical Models and Bio-Inspired Robots
,”
Bioinspirat. Biomimet.
,
5
(
4
), p. 045001.10.1088/1748-3182/5/4/045001
62.
Attenborough
,
D.
,
2002–2003
, “The Life of Mammals: The Complete Series—Episode 5: Meat Eaters,” BBC Documentary.
63.
Brill
,
A. L.
,
De
,
A.
,
Johnson
,
A. M.
, and
Koditschek
,
D. E.
,
2015
, “
Tail-Assisted Rigid and Compliant Legged Leaping
,”
IEEE/RSJ International Conference on Intelligent Robots and Systems
, Hamburg, Germany, Sept. 28–Oct. 2, pp.
6304
6311
.10.1109/IROS.2015.7354277
64.
Zhao
,
J.
,
Zhao
,
T.
,
Xi
,
N.
,
Cintrón
,
F. J.
,
Mutka
,
M. W.
, and
Xiao
,
L.
,
2013
, “
Controlling Aerial Maneuvering of a Miniature Jumping Robot Using Its Tail
,”
IEEE/RSJ International Conference on Intelligent Robots and Systems
, Tokyo, Japan, Nov. 3–7, pp.
3802
3807
.10.1109/IROS.2013.6696900
65.
De
,
A.
, and
Koditschek
,
D. E.
,
2015
, “
Parallel Composition of Templates for Tail-Energized Planar Hopping
,”
IEEE International Conference on Robotics and Automation
, IEEE, Seattle, WA, May 26–30, pp.
4562
4569
.10.1109/ICRA.2015.7139831
66.
Wenger
,
G.
,
De
,
A.
, and
Koditschek
,
D. E.
,
2016
, “
Frontal Plane Stabilization and Hopping With a 2dof Tail
,”
IEEE/RSJ International Conference on Intelligent Robots and Systems
, Daejeon, Korea, Oct. 9–14, pp.
567
573
.10.1109/IROS.2016.7759110
67.
Briggs
,
R.
,
Lee
,
J.
,
Haberland
,
M.
, and
Kim
,
S.
,
2012
, “
Tails in Biomimetic Design: Analysis, Simulation, and Experiment
,”
IEEE/RSJ International Conference on Intelligent Robots and Systems, IEEE
, Vilamoura, Algarve, Portugal, Oct. 7–12, pp.
1473
1480
.10.1109/IROS.2012.6386240
68.
Patel
,
A.
, and
Braae
,
M.
,
2015
, “
An Actuated Tail Increases Rapid Acceleration Manoeuvres in Quadruped Robots
,”
Innovations and Advances in Computing, Informatics, Systems Sciences, Networking and Engineering
,
Springer
,
Cham
, pp.
69
76
.
69.
Machairas
,
K.
, and
Papadopoulos
,
E.
,
2015
, “
On Quadruped Attitude Dynamics and Control Using Reaction Wheels and Tails
,”
European Control Conference
, Linz, Austria, pp.
753
758
.
70.
Libby
,
T.
,
Johnson
,
A. M.
,
Chang-Siu
,
E.
,
Full
,
R. J.
, and
Koditschek
,
D. E.
,
2016
, “
Comparative Design, Scaling, and Control of Appendages for Inertial Reorientation
,”
IEEE Trans. Rob.
,
32
(
6
), pp.
1380
1398
.10.1109/TRO.2016.2597316
71.
Rone
,
W. S.
,
Saab
,
W.
,
Kumar
,
A.
, and
Ben-Tzvi
,
P.
,
2019
, “
Controller Design, Analysis, and Experimental Validation of a Robotic Serpentine Tail to Maneuver and Stabilize a Quadrupedal Robot
,”
ASME J. Dyn. Syst. Meas. Control
,
141
(
8
), p.
081002
.10.1115/1.4042948
72.
Heim
,
S. W.
,
Ajallooeian
,
M.
,
Eckert
,
P.
,
Vespignani
,
M.
, and
Ijspeert
,
A. J.
,
2016
, “
On Designing an Active Tail for Legged Robots: Simplifying Control Via Decoupling of Control Objectives
,”
Ind. Rob. Int. J.
,
43
(
3
), pp.
338
346
.10.1108/IR-10-2015-0190
73.
Zhang
,
X.
,
Gong
,
J.
, and
Yao
,
Y.
,
2016
, “
Effects of Head and Tail as Swinging Appendages on the Dynamic Walking Performance of a Quadruped Robot
,”
Robotica
,
34
(
12
), pp.
2878
2891
.10.1017/S0263574716000011
74.
Mishima
,
Y.
, and
Ozawa
,
R.
,
2014
, “
Design of a Robotic Finger Using Series Gear Chain Mechanisms
,”
IEEE/RSJ International Conference on Intelligent Robots and Systems
, Vol.
1
, Chicago, IL, pp.
2898
2903
.
75.
Domahidi
,
A.
,
Chu
,
E.
, and
Boyd
,
S.
,
2013
, “
ECOS: An SOCP Solver for Embedded Systems
,”
European Control Conference
, Zurich, Switzerland, pp.
3071
3076
.
76.
Hwangbo
,
J.
,
Lee
,
J.
, and
Hutter
,
M.
,
2018
, “
Per-Contact Iteration Method for Solving Contact Dynamics
,”
IEEE Rob. Autom. Lett.
,
3
(
2
), pp.
895
902
.10.1109/LRA.2018.2792536
77.
Pandala
,
A. G.
,
Ding
,
Y.
, and
Park
,
H.
,
2019
, “
qpSWIFT: A Real-Time Sparse Quadratic Program Solver for Robotic Applications
,”
IEEE Rob. Autom. Lett.
,
4
(
4
), pp.
3355
3362
.10.1109/LRA.2019.2926664
78.
Felis
,
M. L.
,
2017
, “
RBDL: An Efficient Rigid-Body Dynamics Library Using Recursive Algorithms
,”
Auton. Rob.
,
41
(
2
), pp.
495
511
.10.1007/s10514-016-9574-0
79.
De Wit
,
C.
,
Olsson
,
H.
,
Astrom
,
K.
, and
Lischinsky
,
P.
,
1995
, “
A New Model for Control of Systems With Friction
,”
IEEE Trans. Autom. Control
,
40
(
3
), pp.
419
425
.10.1109/9.376053
80.
Vanderborght
,
B.
,
Verrelst
,
B.
,
Van Ham
,
R.
,
Van Damme
,
M.
, and
Lefeber
,
D.
,
2008
, “
Objective Locomotion Parameters Based Inverted Pendulum Trajectory Generator
,”
Rob. Auton. Syst.
,
56
(
9
), pp.
738
750
.10.1016/j.robot.2008.01.003