+ All Categories
Home > Documents > Simultaneous Contact, Gait and Motion Planning for Robust ... · Simultaneous Contact, Gait and...

Simultaneous Contact, Gait and Motion Planning for Robust ... · Simultaneous Contact, Gait and...

Date post: 10-Aug-2020
Category:
Upload: others
View: 3 times
Download: 0 times
Share this document with a friend
2
, Simultaneous Contact, Gait and Motion Planning for Robust Multi-Legged Locomotion via Mixed-Integer Convex Optimization Bernardo Aceituno-Cabezas 1 , Carlos Mastalli 2 , Hongkai Dai 3 , Michele Focchi 2 , Andreea Radulescu 2 , Darwin G. Caldwell 2 , Jos´ e Cappelletto 1 , Juan C. Grieco 1 , Gerardo Fern´ andez-L´ opez 1 , and Claudio Semini 2 1 Mechatronics Research Group, Sim´ on Bol´ ıvar University, Caracas, Venezuela 2 Dynamic Legged Systems Lab., Department of Advanced Robotics, Istituto Italiano di Tecnologia, Genova, Italy 3 Toyota Research Institute, Los Altos, California, USA , Introduction Reasoning about contacts and motions simultaneously is crucial for generating complex whole-body behaviors. We propose a mixed- integer convex formulation to plan simultaneously contact locations, gait transitions and motion, in a computationally efficient fashion. Approach Overview Optimal Plan Goal State Convex terrain segmentation Current State Command Simultaneous Contact and Motion Planner Whole-body Controller Trajectory Optimization We formulate a convex trajectory optimization: min r ,k o ,p l ,λ l g T + N X k =1 g (k ) (1) The running cost g (k ) maximizes the stability of the motion, while seeking for the fastest and smoothest gait: g (k )= k ¨ r k k Q v + kλ l ,k k Q F + q u U k + q t t k - q α α k , (2) 1 Minimize the CoM acceleration ¨ r. 2 Minimize the contact forces magnitude kλk. 3 Minimize the upper bound of quadratic terms U =(u - , u + ). 4 Maximize the stability margin α. 5 Minimize the execution time. The terminal cost g T biases the plan towards its goal (r G ): g T = kr T - r G k Q g (3) In practice, we add a small cost to k ˙ k k Q k in order to generate smoother motions. Whole-body Control Reference CoM acceleration (¨ r r R 3 ) and body angular acceleration ( ˙ ω r b R 3 ) through a virtual model : ¨ r r r d + K r (r d - r )+ D r r d - ˙ r ), ˙ ω r b ω d b + K θ e (R d b R T b )+ D θ (ω d b - ω b ), (4) where K r , D r , K θ , D θ R 3×3 are positive-definite diagonal matrices of propor- tional and derivative gains, respectively. We formulate the tracking problem using QP with the generalized accelerations and contact forces as decision variables, x = [¨ q T , λ T ] T R 6+n +3n l : x * = arg min x g err (x)+ kxk W ; Ax = b, d < Cx < ¯ d (5) g err (x)= ¨ r - ¨ r r ˙ ω b - ˙ ω r b S (6) The equality constraints Ax = b encodes dynamic consistency, stance condition and swing task. The inequality constraints d < Cx < ¯ d encode friction, torque, and kinematic limits [1]. We map the optimal solution x * into desired feed-forward joint torques τ * R n : τ * = M T bj M j ¨ q * + h j - J T cj λ * (7) These are summed with the joint PD torques (i.e. feedback torques τ fb ) to form the desired torque command τ d : τ d = τ * + PD (q d j , ˙ q d j ), (8) which is sent to a low-level joint-torque controller. Simultaneous Contact and Motion Planning A. Centroidal Dynamics m¨ r ˙ k = m g + n l l =1 λ l n l l =1 (p l - r ) × λ l , (9) I CoM position r I Angular Momentum k I Contact force of end-effector λ l I Position of end-effector p l where p l - r can be described as bilinear function [2] and decomposed as: ab = u + - u - 4 u + (a + b) 2 u - (a - b) 2 . (10) B. Gait Sequence A gait matrix [3] T ∈{0, 1} N f ×N t where T ij = 1 means that the robot will move to the i th contact location at the j th time-slot. I number of contacts N f I number of time slots N t Each contact location is reached once: N t j =1 T ij =1 , i =1, .., N f . C. Contact Location We constrain the contacts to lie within one of N r convex safe contact surfaces (each represented as a polygon R = {c R 3 |A r c b r }). After assigning the contact to swing, we optimize the contact locations f = (f x , f y , f z ) and we assign this contact to one of the N r using a binary matrix: N r X r=1 H i r =1, H i r A r f i b r (11) We approximate the kinematic limits as a bounding box with respect to the CoM: f i - r T (i ) + L i cos(θ i + φ i ) sin(θ i + φ i ) d lim , (12) I CoM position at i transition r T (i ) I Diagonal of the bounding box d lim I Distance from the trunk of leg L i (the trigonometric functions are decomposed in piecewise linear functions) [4]. D. End-effector Trajectories We define γ (j , t ) as swing reference trajectory, connected to adjacent contacts, where: I j indicates the time-slot I t [1,..., N k ] all the knots per time-slot The leg reaches the contact position f i at the end of the j slot: T ij p l (i )γ (j ,N k ) = f i , (13) where l (i ) is the leg number for the i th contact. To constrain that the leg remains stationary when there is no transition: X i C (l ) T ij =0 p l γ (j ,t ) = p l γ (j ,1) t [2,..., N k ], (14) where C (l ) are the contact indexes assigned to the l th leg. We ensure kinematic feasibility by constraining the CoM position with respect to the end-effectors (bounding box constraint): d - < r j - n l l =1 p lj n l < d + (15) https://dls.iit.it/
Transcript
Page 1: Simultaneous Contact, Gait and Motion Planning for Robust ... · Simultaneous Contact, Gait and Motion Planning for Robust Multi-Legged Locomotion via Mixed-Integer Convex Optimization

,

Simultaneous Contact, Gait and Motion Planningfor Robust Multi-Legged Locomotion via

Mixed-Integer Convex OptimizationBernardo Aceituno-Cabezas1, Carlos Mastalli2, Hongkai Dai3, Michele Focchi2,

Andreea Radulescu2, Darwin G. Caldwell2, Jose Cappelletto1, Juan C. Grieco1, GerardoFernandez-Lopez1, and Claudio Semini2

1Mechatronics Research Group, Simon Bolıvar University, Caracas, Venezuela2Dynamic Legged Systems Lab., Department of Advanced Robotics, Istituto Italiano di Tecnologia, Genova, Italy

3Toyota Research Institute, Los Altos, California, USA,

Introduction

Reasoning about contacts and motions simultaneously is crucial forgenerating complex whole-body behaviors. We propose a mixed-integer convex formulation to plan simultaneously contact locations,gait transitions and motion, in a computationally efficient fashion.

Approach Overview

Optimal

Plan

Goal

StateConvex terrain

segmentation

Current

State

Command

Simultaneous

Contact and Motion

Planner

Whole-body

Controller

Trajectory Optimization

We formulate a convex trajectory optimization:

minr,ko,pl ,λl

gT +N∑

k=1

g(k) (1)

The running cost g(k) maximizes the stability of the motion, while seeking forthe fastest and smoothest gait:

g(k) = ‖rk‖Qv+ ‖λl ,k‖QF

+ quUk + qttk − qααk, (2)

1 Minimize the CoM acceleration r.2 Minimize the contact forces magnitude ‖λ‖.3 Minimize the upper bound of quadratic terms U = (u−,u+).4 Maximize the stability margin α.5 Minimize the execution time.

The terminal cost gT biases the plan towards its goal (rG ):

gT = ‖rT − rG‖Qg(3)

In practice, we add a small cost to ‖k‖Qkin order to generate smoother motions.

Whole-body Control

Reference CoM acceleration (rr ∈ R3) and body angular acceleration (ωrb ∈ R3)

through a virtual model :

rr = rd + Kr(rd − r) + Dr(r

d − r),

ωrb = ωd

b + Kθe(RdbRT

b ) + Dθ(ωdb − ωb), (4)

where Kr,Dr,Kθ,Dθ ∈ R3×3 are positive-definite diagonal matrices of propor-tional and derivative gains, respectively.We formulate the tracking problem using QP with the generalized accelerationsand contact forces as decision variables, x = [qT ,λT ]T ∈ R6+n+3nl :

x∗ = arg minx

gerr(x) + ‖x‖W; Ax = b, d < Cx < d (5)

gerr(x) =

∥∥∥∥ r − rr

ωb − ωrb

∥∥∥∥S

(6)

The equality constraints Ax = b encodes dynamic consistency, stance conditionand swing task. The inequality constraints d < Cx < d encode friction, torque,and kinematic limits [1].We map the optimal solution x∗ into desired feed-forward joint torques τ ∗ff ∈Rn:

τ ∗ff =[MT

bj Mj

]q∗ + hj − JT

cjλ∗ (7)

These are summed with the joint PD torques (i.e. feedback torques τ fb) toform the desired torque command τ d :

τ d = τ ∗ff + PD(qdj , q

dj ), (8)

which is sent to a low-level joint-torque controller.

Simultaneous Contact and Motion Planning

A. Centroidal Dynamics[mrk

]=

[mg +

∑nl

l=1λl∑nl

l=1(pl − r)× λl

], (9)

I CoM position r

I Angular Momentum k

I Contact force of end-effector λl

I Position of end-effector plwhere pl − r can be described as bilinear function [2] and decomposed as:

ab =u+ − u−

4u+ ≥ (a + b)2 u− ≥ (a− b)2. (10)

B. Gait Sequence

A gait matrix [3] T ∈ {0, 1}Nf×Nt where Tij = 1 means that the robot willmove to the i th contact location at the j th time-slot.

I number of contacts Nf

I number of time slots Nt

Each contact location is reached once:∑Nt

j=1 Tij = 1 , ∀i = 1, ..,Nf .

C. Contact Location

We constrain the contacts to lie within one of Nr convex safe contact surfaces(each represented as a polygon R = {c ∈ R3|Arc ≤ br}).After assigning the contact to swing, we optimize the contact locations f =(fx, fy , fz, θ) and we assign this contact to one of the Nr using a binary matrix:

Nr∑r=1

Hir = 1, Hir⇒ Arfi ≤ br (11)

We approximate the kinematic limits as a bounding box with respect to theCoM: ∣∣∣∣fi −

[rT (i) + Li

(cos(θi + φi)sin(θi + φi)

)]∣∣∣∣ ≤ dlim, (12)

I CoM position at i transition rT (i)

I Diagonal of the bounding box dlim

I Distance from the trunk of leg Li

(the trigonometric functions are decomposed in piecewise linear functions) [4].

D. End-effector Trajectories

We define γ(j , t) as swing reference trajectory, connected to adjacent contacts,where:

I j indicates the time-slot

I t ∈ [1, . . . ,Nk] all the knots per time-slot

The leg reaches the contact position fi at the end of the j slot:

Tij ⇒ pl(i)γ(j ,Nk) = fi , (13)

where l(i) is the leg number for the i th contact.To constrain that the leg remains stationary when there is no transition:∑

i∈C (l)

Tij = 0⇒ plγ(j ,t) = plγ(j ,1) ∀t ∈ [2, . . . ,Nk], (14)

where C (l) are the contact indexes assigned to the l thleg.We ensure kinematic feasibility by constraining the CoM position with respectto the end-effectors (bounding box constraint):

d− < rj −∑nl

l=1 plj

nl< d+ (15)

https://dls.iit.it/

Page 2: Simultaneous Contact, Gait and Motion Planning for Robust ... · Simultaneous Contact, Gait and Motion Planning for Robust Multi-Legged Locomotion via Mixed-Integer Convex Optimization

,

Simultaneous Contact, Gait and Motion Planningfor Robust Multi-Legged Locomotion via

Mixed-Integer Convex OptimizationBernardo Aceituno-Cabezas1, Carlos Mastalli2, Hongkai Dai3, Michele Focchi2,

Andreea Radulescu2, Darwin G. Caldwell2, Jose Cappelletto1, Juan C. Grieco1, GerardoFernandez-Lopez1, and Claudio Semini2

1Mechatronics Research Group, Simon Bolıvar University, Caracas, Venezuela2Dynamic Legged Systems Lab., Department of Advanced Robotics, Istituto Italiano di Tecnologia, Genova, Italy

3Toyota Research Institute, Los Altos, California, USA,

Simultaneous Contact and Motion Planning

E. Contact Dynamics

If the l th leg is in swing mode, there is no contact force:∑i∈C (l)

Tij = 1⇒ λlγ(j ,t) = 0 , ∀t ∈ NC (j), (16)

where NC (j) is the set of knots in the j th slot used for the swing (comple-mentarity constraint [5]).

Stability in non-coplanar contact conditions:

λlj ∈ FCr⇒ λlj =

Ne∑e=1

ρevre, ρ1, . . . , ρNe

> 0,

where ρe are positive multipliers on each cone edge.

To add robustness to the motion, we maximize the distance between thenonlinear friction cone boundary and the force vector:

α = arg maxα

s.t λlj − αnr ∈ FCr,

We introduce the following linear constraint over each safe surface:

Tij and Hri ⇒ λl(i)γ(j) − αl(i)γ(j)nr ∈ FCr , α ≥ 0. (17)

Since the contact cone must not change when it is in stance phase, we alsoadd the constraint: ∑

l∈C (i)

∑t∈NS(j)

Tlt = 0,

⇒ λl(i)γ(j) − αl(i)γ(j)nr ∈ FCr, (18)

where NS(j) is the set of time-slots succeeding j .

G. Approximate Torque Limits

We approximate the torque limits using a quasi-static motion assumption:

JTl ,jλl ,j ≤ τmax, ⇒ J∗Tl ,jλl ,j ≤ τmax,

where Jl ,j ∈ R3×3 is the operational space foot Jacobian for the l th leg atthe j th knot, and τmax are the joint torque limits of the leg.

Experimental Validation

Approximate Torque Constraints

150

100

50

0

50

100

150

HFE t

orq

ue (

Nm

)

without approximate torque constraints

lims

cmd

0.0 0.5 1.0 1.5 2.0 2.5 3.0 3.5 4.0

time (s)

150

100

50

0

50

100

150

HFE

torq

ue (

Nm

)

with approximate torque constraints

lims

cmd

Automatic Gait Discovery

0 50 100 150 2000

0.5

α margin at each time-step

walk

mean

0 10 20 30 40 50 60 70 800

0.5

1

α

trot

mean

0 10 20 30 40 50 60 70 80 90 100

knot-points

0

0.5

1

α

optimal

mean

Top: Normalized α margin for different gaits. Bottom: Resulting optimal gait sequence for navigating in

roof-like terrain.

Computation Time

Experiment convex surfaces Gait mean time (s)

Exp. 1 3 Walk 0.47Exp. 2 3 Walk 0.64Exp. 3 4 Walk 0.44

Exp. 4 3 Walk 0.48Exp. 4 3 Trot 0.51Exp. 4 3 Free 1.62

Computation time in an un-optimized Matlab code.

Conclusions

We have presented a novel approach for simultaneously planning contacts and motions on multi-legged robots based on MICP. Our approach is able tohandle complex terrain, while also providing formal robustness guarantees on the plan and allows for automatic gait discovery. We employ botha state-of-the-art whole-body controller [1] and state estimation [6]. We demonstrate the approach’s capabilities by traversing challenging terrains withthe HyQ robot.

References

[1] C. Mastalli, I. Havoutis, M. Focchi, D. Caldwell, and C. Semini, “Motion planning for quadrupedal locomotion: coupled planning, terrain mapping and whole-body control.” working paper or preprint, Nov. 2017.

[2] B. Ponton, A. Herzog, S. Schaal, and L. Righetti, “A convex model of humanoid momentum dynamics for multi-contact motion generation,” in Humanoids, IEEE, 2016.

[3] B. Aceituno-Cabezas, H. Dai, J. Cappelletto, J. C. Grieco, and G. Fernandez-Lopez, “A mixed-integer convex optimization framework for robust multilegged robot locomotion planning over challenging terrain,” in IROS,

IEEE, 2017.

[4] R. Deits and R. Tedrake, “Footstep planning on uneven terrain with mixed-integer convex optimization,” in Humanoids, IEEE, 2014.

[5] M. Posa, C. Cantu, and R. Tedrake, “A direct method for trajectory optimization of rigid bodies through contact,” The International Journal of Robotics Research, vol. 33, no. 1, 2014.

[6] S. Nobili, M. Camurri, V. Barasuol, M. Focchi, D. Caldwell, C. Semini, and M. Fallon, “Heterogeneous sensor fusion for accurate state estimation of dynamic legged robots,” in RSS, 2017.

https://dls.iit.it/


Recommended