Autonomous Mobile Robots - ETH Z

36
| Autonomous Mobile Robots Roland Siegwart, Margarita Chli, Nick Lawrance ASL Autonomous Systems Lab Roland Siegwart, Margarita Chli, Nick Lawrance Locomotion Concepts - add ons 1 Mobile Robot Kinematics Autonomous Mobile Robots Spring 2020

Transcript of Autonomous Mobile Robots - ETH Z

Page 1: Autonomous Mobile Robots - ETH Z

|Autonomous Mobile RobotsRoland Siegwart, Margarita Chli, Nick Lawrance

ASLAutonomous Systems Lab

Roland Siegwart, Margarita Chli, Nick Lawrance

Locomotion Concepts - add ons 1

Mobile Robot KinematicsAutonomous Mobile Robots

Spring 2020

Page 2: Autonomous Mobile Robots - ETH Z

|Autonomous Mobile RobotsRoland Siegwart, Margarita Chli, Nick Lawrance

ASLAutonomous Systems Lab

Manipulator arms versus mobile robots Robot arms are fixed to the ground and usually comprised of a single chain of actuated links The motion of mobile robots is defined through rolling and sliding constraints taking effect at

the wheel-ground contact points

Locomotion Concepts - add ons 2

Mobile Robot Kinematics: Overview

C Willow GarageRide an ABB, https://www.youtube.com/watch?v=bxbjZiKAZP4

Page 3: Autonomous Mobile Robots - ETH Z

|Autonomous Mobile RobotsRoland Siegwart, Margarita Chli, Nick Lawrance

ASLAutonomous Systems Lab

Manipulator arms versus mobile robots Both are concerned with forward and inverse kinematics However, for mobile robots, encoder values don‘t map to unique robot poses And mobile robots can move unbound with respect to their environment There is no direct (=instantaneous) way to measure the robot’s position Position must be integrated over time, depends on path taken Leads to inaccuracies of the position (motion) estimate

Understanding mobile robot motion starts with understanding wheel constraints placed on the robot’s mobility

Locomotion Concepts - add ons 3

Mobile Robot Kinematics: Overview

Page 4: Autonomous Mobile Robots - ETH Z

|Autonomous Mobile RobotsRoland Siegwart, Margarita Chli, Nick Lawrance

ASLAutonomous Systems Lab

Non-holonomic systems differential equations are not integrable to the final position. the measure of the traveled distance of each wheel is not sufficient to calculate the final

position of the robot. One has also to know how this movement was executed as a function of time.

This is in strong contrast to actuator arms

Locomotion Concepts - add ons 4

Non-Holonomic Systems

2121

212121

,,,

yyxxssssss LLRR

s1L s1R

s2L

s2R

yI

xI

x1, y1

x2, y2

s1

s2

Page 5: Autonomous Mobile Robots - ETH Z

|Autonomous Mobile RobotsRoland Siegwart, Margarita Chli, Nick Lawrance

ASLAutonomous Systems Lab

Forward kinematics: Transformation from joint to physical space

Inverse kinematics Transformation from physical to joint space Required for motion control

Due to non-holonomic constraints in mobile robotics, we deal with differential (inverse) kinematics Transformation between velocities instead of positions Such a differential kinematic model of a robot has the following form:

Locomotion Concepts - add ons 5

Forward and Inverse Kinematics

(nonintegrable) Robot Model

(x,y,θ)(v,ω)-

Control law

Page 6: Autonomous Mobile Robots - ETH Z

|Autonomous Mobile RobotsRoland Siegwart, Margarita Chli, Nick Lawrance

ASLAutonomous Systems Lab

Wheels are the most appropriate solution for many applications

Three wheels are sufficient to guarantee stability

With more than three wheels an appropriate suspension is required

Selection of wheels depends on the application

Locomotion Concepts - add ons 6

Mobile Robots with Wheels

Page 7: Autonomous Mobile Robots - ETH Z

|Autonomous Mobile RobotsRoland Siegwart, Margarita Chli, Nick Lawrance

ASLAutonomous Systems Lab

a) Standard wheel: Two degrees of freedom; rotation around the (motorized) wheel axle and the contact point

b) Castor wheel: Three degrees of freedom; rotation around the wheel axle, the contact point and the castor axle

Locomotion Concepts - add ons 7

The Four Basic Wheels Types

Page 8: Autonomous Mobile Robots - ETH Z

|Autonomous Mobile RobotsRoland Siegwart, Margarita Chli, Nick Lawrance

ASLAutonomous Systems Lab

c) Swedish wheel: Three degrees of freedom; rotation around the (motorized) wheel axle, around the rollers and around the contact point

d) Ball or spherical wheel: Suspension technically not solved

Locomotion Concepts - add ons 8

The Four Basic Wheels Types

Page 9: Autonomous Mobile Robots - ETH Z

|Autonomous Mobile RobotsRoland Siegwart, Margarita Chli, Nick Lawrance

ASLAutonomous Systems Lab

Stability of a vehicle is be guaranteed with 3 wheels If center of gravity is within the triangle which is formed by the ground contact point of the

wheels. Stability is improved by 4 and more wheel however, this arrangements are hyper static and require a flexible suspension system.

Bigger wheels allow to overcome higher obstacles but they require higher torque or reductions in the gear box.

Most arrangements are non-holonomic (see chapter 3) require high control effort

Combining actuation and steering on one wheel makes the design complex and adds additional errors for odometry.

Locomotion Concepts - add ons 9

Characteristics of Wheeled Robots and Vehicles

Page 10: Autonomous Mobile Robots - ETH Z

|Autonomous Mobile RobotsRoland Siegwart, Margarita Chli, Nick Lawrance

ASLAutonomous Systems Lab

Two wheels

Three wheels

Locomotion Concepts - add ons 10

Different Arrangements of Wheels I

Omnidirectional Drive Synchro Drive

COG below axle

Page 11: Autonomous Mobile Robots - ETH Z

|Autonomous Mobile RobotsRoland Siegwart, Margarita Chli, Nick Lawrance

ASLAutonomous Systems Lab

All wheels are actuated synchronously by one motor defines the speed of the vehicle

All wheels steered synchronously by a second motor sets the heading of the vehicle

The orientation in spaceof the robot frame will always remain the same It is therefore not possible

to control the orientation of the robot frame.

Locomotion Concepts - add ons 11

Synchro Drive

C J. Borenstein

Page 12: Autonomous Mobile Robots - ETH Z

|Autonomous Mobile RobotsRoland Siegwart, Margarita Chli, Nick Lawrance

ASLAutonomous Systems Lab

Four wheels

Six wheels

Locomotion Concepts - add ons 12

Different Arrangements of Wheels II

Page 13: Autonomous Mobile Robots - ETH Z

|Autonomous Mobile RobotsRoland Siegwart, Margarita Chli, Nick Lawrance

ASLAutonomous Systems Lab

Four powered and actively steered wheels Results in omni-drive-like behavior Results in simplified high-level planning (see chapter 6)

Locomotion Concepts - add ons 13

Case Study: Willow Garage‘s PR2

C W

illow

Gar

age

Page 14: Autonomous Mobile Robots - ETH Z

|Autonomous Mobile RobotsRoland Siegwart, Margarita Chli, Nick Lawrance

ASLAutonomous Systems Lab

Movement in the plane has 3 DOF thus only three wheels can be independently controlled It might be better to arrange three Swedish wheels in a triangle

Locomotion Concepts - add ons 14

CMU Uranus: Omnidirectional Drive with 4 Wheels

Page 15: Autonomous Mobile Robots - ETH Z

|Autonomous Mobile RobotsRoland Siegwart, Margarita Chli, Nick Lawrance

ASLAutonomous Systems Lab

Purely friction based

Locomotion Concepts - add ons 15

Wheeled Rovers: Concepts for Object Climbing

Change of center of gravity(CoG)

Adapted suspension mechanism with

passive or active joints

Page 16: Autonomous Mobile Robots - ETH Z

|Autonomous Mobile RobotsRoland Siegwart, Margarita Chli, Nick Lawrance

ASLAutonomous Systems Lab

Passive locomotion concept 6 wheels two boogies on each side fixed wheel in the rear front wheel with spring

suspension Dimensions length: 60 cm height: 20 cm

Characteristics highly stable in rough terrain overcomes obstacles up to

2 times its wheel diameter

Locomotion Concepts - add ons 16

Climbing with Legs: Shrimp (ASL EPFL/ETH)

Page 17: Autonomous Mobile Robots - ETH Z

|Autonomous Mobile RobotsRoland Siegwart, Margarita Chli, Nick Lawrance

ASLAutonomous Systems Lab

Locomotion Concepts - add ons 17

Kinematic Constraints: Fixed Standard Wheel

y.

x.

. v = r .

Page 18: Autonomous Mobile Robots - ETH Z

|Autonomous Mobile RobotsRoland Siegwart, Margarita Chli, Nick Lawrance

ASLAutonomous Systems Lab

Locomotion Concepts - add ons 18

3 - Mobile Robot Kinematics

l

Robot chassis

v = r .

x.

x sin.

x cos.

A

.

y

.

y (cos

.

y sin

.

l).

(l)sin.

l)cos.

Rolling constraint →

Sliding constraint →

𝜉 𝑥 𝑦 𝜃

Page 19: Autonomous Mobile Robots - ETH Z

|Autonomous Mobile RobotsRoland Siegwart, Margarita Chli, Nick Lawrance

ASLAutonomous Systems Lab

Suppose that the wheel A is in position such that = 0 and = 0 This would place the contact point of the wheel on XI with the plane of the

wheel oriented parallel to YI. If = 0, then the sliding constraint reduces to:

Locomotion Concepts - add ons 19

Example

Page 20: Autonomous Mobile Robots - ETH Z

|Autonomous Mobile RobotsRoland Siegwart, Margarita Chli, Nick Lawrance

ASLAutonomous Systems Lab

Locomotion Concepts - add ons 20

Kinematic Constraints:

Page 21: Autonomous Mobile Robots - ETH Z

|Autonomous Mobile RobotsRoland Siegwart, Margarita Chli, Nick Lawrance

ASLAutonomous Systems Lab

Given a robot with M wheels each wheel imposes zero or more constraints on the robot motion only fixed and steerable standard wheels impose constraints

Suppose we have a total of N=Nf + Ns standard wheels We can develop the equations for the constraints in matrix forms: Rolling

Lateral movement

Locomotion Concepts - add ons 21

Kinematic Constraints: Complete Robot

1 )()(

)(

sf NNs

f

tt

t

3 1

11 )(

)(

sf NNss

fs J

JJ

)( 12 NrrdiagJ

3 1

11 )(

)(

sf NNss

fs C

CC

𝐽 𝛽 𝑅 𝜃 𝜉 𝐽 𝜑 0

𝐶 𝛽 𝑅 𝜃 𝜉 0

Page 22: Autonomous Mobile Robots - ETH Z

|Autonomous Mobile RobotsRoland Siegwart, Margarita Chli, Nick Lawrance

ASLAutonomous Systems Lab

The maneuverability of a mobile robot is the combination of the mobility available based on the sliding constraints plus additional freedom contributed by the steering

Three wheels is sufficient for static stability additional wheels need to be synchronized this is also the case for some arrangements with three wheels

It can be derived using the equation seen before Degree of mobility Degree of steerability Robots maneuverability

Locomotion Concepts - add ons 22

Mobile Robot Maneuverability

m

s

smM

Page 23: Autonomous Mobile Robots - ETH Z

|Autonomous Mobile RobotsRoland Siegwart, Margarita Chli, Nick Lawrance

ASLAutonomous Systems Lab

To avoid any lateral slip the motion vector has to satisfy the following constraints:

Mathematically: must belong to the null space of the projection matrix

Null space of is the space N such that for any vector n in N

Geometrically this can be shown by the Instantaneous Center of Rotation (ICR)

Locomotion Concepts - add ons 23

Mobile Robot Maneuverability: Degree of Mobility

)()(

1

11

ss

fs C

CC

)(1 sC

)(1 sC

0)(1 nC s

𝐶 𝑅 𝜃 𝜉 0𝐶 𝛽 𝑅 𝜃 𝜉 0

𝑅 𝜃 𝜉

𝑅 𝜃 𝜉

Page 24: Autonomous Mobile Robots - ETH Z

|Autonomous Mobile RobotsRoland Siegwart, Margarita Chli, Nick Lawrance

ASLAutonomous Systems Lab

Instantaneous center of rotation (ICR)

Ackermann Steering Bicycle

Locomotion Concepts - add ons 24

Mobile Robot Maneuverability: ICR

Page 25: Autonomous Mobile Robots - ETH Z

|Autonomous Mobile RobotsRoland Siegwart, Margarita Chli, Nick Lawrance

ASLAutonomous Systems Lab

Robot chassis kinematics is a function of the set of independent constraints

the greater the rank of the more constrained is the mobility

Mathematically no standard wheels all direction constrained

Examples: Unicycle: One single fixed standard wheel Differential drive: Two fixed standard wheels wheels on same axle wheels on different axle

Locomotion Concepts - add ons 25

Mobile Robot Maneuverability: More on Degree of Mobility

)( 1 sCrank

)()(

1

11

ss

fs C

CC

)(1 sC )( 3)( dim 11 ssm CrankCN

3)( 1 sCrank 0)( 1 sCrank

3)( 0 1 sCrank

𝐶 𝑅 𝜃 𝜉 0

𝐶 𝛽 𝑅 𝜃 𝜉 0

Page 26: Autonomous Mobile Robots - ETH Z

|Autonomous Mobile RobotsRoland Siegwart, Margarita Chli, Nick Lawrance

ASLAutonomous Systems Lab

Indirect degree of motion

The particular orientation at any instant imposes a kinematic constraint However, the ability to change that orientation can lead additional degree of maneuverability

Range of :

Examples: one steered wheel: Tricycle two steered wheels: No fixed standard wheel car (Ackermann steering): Nf = 2, Ns=2 -> common axle

Locomotion Concepts - add ons 26

Mobile Robot Maneuverability: Degree of Steerability

)( 1 sss Crank

20 ss

Page 27: Autonomous Mobile Robots - ETH Z

|Autonomous Mobile RobotsRoland Siegwart, Margarita Chli, Nick Lawrance

ASLAutonomous Systems Lab

Degree of Maneuverability

Two robots with same are not necessary equal Example: Differential drive and Tricycle (see MOOC video segment or book)

For any robot with the ICR is always constrained to lie on a line

For any robot with the ICR is not constrained and can be set to any point on the plane

The Synchro Drive example:

Locomotion Concepts - add ons 27

Mobile Robot Maneuverability: Robot Maneuverability

smM

2M

3M

211 smM

M

Page 28: Autonomous Mobile Robots - ETH Z

|Autonomous Mobile RobotsRoland Siegwart, Margarita Chli, Nick Lawrance

ASLAutonomous Systems Lab

Locomotion Concepts - add ons 28

Five Basic Types of Three-Wheel Configurations

Page 29: Autonomous Mobile Robots - ETH Z

|Autonomous Mobile RobotsRoland Siegwart, Margarita Chli, Nick Lawrance

ASLAutonomous Systems Lab

The objective of a kinematic controller is to follow a trajectory described by its position and/or velocity profiles as function of time.

Motion control is not straight forward because mobile robots are typically non-holonomic and MIMO systems.

Most controllers (including the one presented here) are not considering the dynamics of the system

Locomotion Concepts - add ons 29

Wheeled Mobile Robot Motion Control: Overview

Page 30: Autonomous Mobile Robots - ETH Z

|Autonomous Mobile RobotsRoland Siegwart, Margarita Chli, Nick Lawrance

ASLAutonomous Systems Lab

Trajectory (path) divided in motion segments of clearly Defined shape: straight lines and segments of a circle Dubins car, and Reeds-Shepp car

Control problem: pre-compute a smooth trajectory

based on line, circle (and clothoid) segments Disadvantages: It is not at all an easy task to pre-compute a feasible trajectory limitations and constraints of the robots velocities and accelerations does not adapt or correct the trajectory if dynamical changes

of the environment occur. The resulting trajectories are usually not smooth (in acceleration, jerk, etc.)

Locomotion Concepts - add ons 30

Motion Control: Open Loop ControlyI

xI

goal

Page 31: Autonomous Mobile Robots - ETH Z

|Autonomous Mobile RobotsRoland Siegwart, Margarita Chli, Nick Lawrance

ASLAutonomous Systems Lab

Find a control matrix K, if exists

with kij=k(t,e) such that the control of v(t) and (t)

drives the error e to zero

MIMO state feedback control

Locomotion Concepts - add ons 31

Motion Control: Feedback Control

232221

131211

kkkkkk

K

yx

KeKttv

R

)()(

yR

xR

goal

v(t)

(t)

start e

(nonintegrable) Robot Model

(x,y,θ)(v,ω)-

Control law

lim→

𝑒 𝑡 =0

Page 32: Autonomous Mobile Robots - ETH Z

|Autonomous Mobile RobotsRoland Siegwart, Margarita Chli, Nick Lawrance

ASLAutonomous Systems Lab

The kinematics of a differential drive mobile robot described in the inertial frame { xI, yI, } is given by,

where 𝑥 and 𝑦 are the linear velocities in the direction of the xI and yI of the inertial frame.

Let 𝛼 denote the angle between the xR axis of the robots reference frame and the vector connecting the center of the axle of the wheels with the final position.

Locomotion Concepts - add ons 32

Motion Control: Kinematic Position Control

y

𝑥𝑦𝜃

𝑐𝑜𝑠𝜃 0𝑠𝑖𝑛𝜃 0

0 1

𝑣𝜔

Page 33: Autonomous Mobile Robots - ETH Z

|Autonomous Mobile RobotsRoland Siegwart, Margarita Chli, Nick Lawrance

ASLAutonomous Systems Lab

y

Coordinates transformation into polar coordinates with its origin at goal position:

System description, in the new polar coordinates

Locomotion Concepts - add ons 33

Kinematic Position Control: Coordinates Transformation

for for

Page 34: Autonomous Mobile Robots - ETH Z

|Autonomous Mobile RobotsRoland Siegwart, Margarita Chli, Nick Lawrance

ASLAutonomous Systems Lab

y

The coordinates transformation is not defined at x = y = 0;

For the forward direction of the robot points toward the goal, for it is the backward direction.

By properly defining the forward direction of the robot at its initial configuration, it is always possible to have at t=0. However this does not mean that remains in I1 for all time t.

Locomotion Concepts - add ons 34

Kinematic Position Control: Remarks

Page 35: Autonomous Mobile Robots - ETH Z

|Autonomous Mobile RobotsRoland Siegwart, Margarita Chli, Nick Lawrance

ASLAutonomous Systems Lab

y

It can be shown, that with

the feedback controlled system

will drive the robot to The control signal v has always constant sign, the direction of movement is kept positive or negative during movement parking maneuver is performed always in the most natural way and without ever inverting its

motion.

Locomotion Concepts - add ons 35

Kinematic Position Control: The Control Law

𝜌,𝛼,𝛽 0, 0, 0

Page 36: Autonomous Mobile Robots - ETH Z

|Autonomous Mobile RobotsRoland Siegwart, Margarita Chli, Nick Lawrance

ASLAutonomous Systems Lab

The goal is in the center and the initial position on the circle.

Locomotion Concepts - add ons 36

Kinematic Position Control: Resulting Path

𝑘 𝑘 , 𝑘 ,𝑘 3, 8, 1.5