SlideShare a Scribd company logo
1 of 25
Download to read offline
SBE 403 B: Bioelectronic Systems (Biomedical Robotics)
Lecture 03
Representing Position and
Orientation 2Orientation 2
Muhammad Rushdi
mrushdi@eng1.cu.edu.eg
Main Problems in Robotics
• What are the basic issues to be resolved and what must we
learn in order to be able to program a robot to perform its
tasks?
• Problem 1: Forward Kinematics
• Problem 2: Inverse Kinematics
• Problem 3: Velocity Kinematics Represent• Problem 3: Velocity Kinematics
• Problem 4: Path Planning
• Problem 5: Vision
• Problem 6: Dynamics
• Problem 7: Position Control
• Problem 8: Force Control
2
the position and orientation of
objects (e.g. robots, cameras,
workpieces, obstacles and
paths) in an environment.
Textbook
• Ch. 2 Representing
Position and
Orientation
Peter Corke:
Robotics, Vision and
Control - Fundamental
Algorithms in MATLAB®.
http://www.petercorke.com/RVC/
3
Representing Pose in 3D
• The 3D case is an extension of the 2D case.
• Add an extra coordinate axis, typically denoted by
z, that is orthogonal to both the x- and y-axes. The
direction of the z-axis obeys the right-hand rule
and forms a right-handed coordinate frame.
4
Euler’s rotation theorem
• Any two independent orthonormal coordinate
frames can be related by a sequence of rotations
(not more than three) about coordinate axes,
where no two successive rotations may be about
the same axis.
5
Example 3D Rotations
6
3D Rotations are Non-commutative
7
Representing 3D Rotations:
Orthonormal Rotation Matrix
• Each unit vector has three elements and they form
the columns of a 3 × 3 orthonormal matrix
• R is orthogonal and has a +1 determinant
• The matrix R belongs to the special orthogonal
group of dimension 3 or
8
Representing 3D Rotations:
Orthonormal Rotation Matrix
• The orthonormal rotation matrices for rotation
of θ about the x-, y- and z-axes are
9
Representing 3D Rotations:
Orthonormal Rotation Matrix
• The orthonormal rotation matrices give a
non-minimal representation:
• The orthonormal matrix has 9 elements but
they are not independent. The columnsthey are not independent. The columns
have unit magnitude which provides 3
constraints. The columns are orthogonal to
each other which provides another 3
constraints. Nine elements and six
constraints is effectively 3 independent
values. 10
Representing 3D Rotations:
Three-Angle Representations (Euler Angles)
• There are two classes of Euler Angle
rotation sequences:
• The Eulerian type involves repetition, but not
successive, of rotations about one particularsuccessive, of rotations about one particular
axis: XYX, XZX, YXY, YZY, ZXZ, or ZYZ.
• Example: ZYZ used commonly in
aeronautics and mechanics:
• The Cardanian type is characterized by
rotations about all three axes: XYZ, XZY,
YZX, YXZ, ZXY, or ZYX. 1112 possible sequences
Representing 3D Rotations:
Mapping between Rotation Matrices and Euler
Angles
• The mapping from rotation matrix to Euler angles is not
unique and always returns a positive angle for θ (See the
Matlab example pp. 29,30).
• For the case where θ =0, the rotation
reduces to
• For the inverse operation we can therefore only determine
this angle sum. This case represents a singularity, when
the rotational axis of the middle term in the sequence
becomes parallel to the rotation axis of the first or third term.
12
See also: Computing Euler angles from a rotation matrix
http://www.staff.city.ac.uk/~sbbh653/publications/euler.pdf
Representing 3D Rotations:
Three-Angle Representations (Euler Angles)
• Singularities and Gimbal Lock: Consider the situation
when the rotation angle of the middle gimbal (rotation about
the spacecraft’s z-axis) is 90° – the axes of the inner and
outer gimbals are aligned and they share the same rotation
axis. Instead of the original three rotational axes, since two
are parallel, there are now only two effective rotational axesare parallel, there are now only two effective rotational axes
– we say that one degree of freedom has been lost.
13
Representing 3D Rotations:
Three-Angle Representations (Euler Angles)
• Singularities and Gimbal Lock: All three-
angle representations of attitude, whether
Eulerian or Cardanian, suffer this problem of
gimbal lock when two consecutive axes
become aligned.
• The best that can be hoped for is that the
singularity occurs for an attitude which does
not occur during normal operation of the
vehicle – it requires judicious choice of angle
sequence and coordinate system.
• Singularities are an unfortunate consequence
of using a minimal representation. To
eliminate this problem we need to adopt
different representations of orientation: Add a
fourth parameter.
14
Representing 3D Rotations:
Two Vector Representation
• For arm-type robots it is useful to consider a coordinate
frame {E} attached to the end-effector. By convention the
axis of the tool is associated with the z-axis and is called
the approach vector. An orthogonal vector that provides
orientation, perhaps between the two fingers of the robot’s
gripper is called the orientation vector.
15
Representing 3D Rotations:
Rotation about an Arbitrary Vector (Angle-Axis)
• Two coordinate frames of arbitrary orientation are related
by a single rotation about some axis in space.
• This information is encoded in the eigenvalues and
eigenvectors of R.
• An orthonormal rotation matrix will always have one real
eigenvalue at λ = 1 and a complex pair λ =cosθ ±i sinθeigenvalue at λ = 1 and a complex pair λ =cosθ ±i sinθ
where θ is the rotation angle.
• From the definition of eigenvalues and eigenvectors we
recall that
where v is the eigenvector corresponding to λ. For the
case λ =1 then
which implies that the corresponding eigenvector v is
unchanged by the rotation. There is only one such vector
and that is the one about which the rotation occurs. 16
Representing 3D Rotations:
Rotation about an Arbitrary Vector (Angle-Axis)
• Converting from angle and vector to a rotation matrix is
achieved using Rodrigues’ rotation formula:
where S is a skew symmetric matrix:
• The angle-vector representation is minimal (if the rotation
vector is normalized) and efficient in terms of data storage
but is analytically problematic.
17
Representing 3D Rotations:
Unit Quaternions
• The quaternion is an extension of the complex number – a
hyper-complex number – and is written as a scalar plus a
vector
wherewhere
and
• We will denote a quaternion as
• Quaternions are elegant, powerful and computationally
straightforward and widely used for robotics, computer
vision, computer graphics and aerospace inertial
navigation applications. 18
Representing 3D Rotations:
Unit Quaternions
• To represent rotations we use unit-quaternions. These are
quaternions of unit magnitude, that is, those for which
• The unit-quaternion has the special property that it can be
considered as a rotation of θ about a unit vector which areconsidered as a rotation of θ about a unit vector which are
related to the quaternion components by
19
Representing 3D Rotations:
Unit Quaternions
• If we write the quaternion as a 4-
vector (s,v1,v2,v2) then
multiplication can be expressed as
a matrix-vector product where
• Quaternions form a group:• Quaternions form a group:
20
Combining Translation and Orientation in 3D
• Using Translation + Quaternions:
21
Combining Translation and Orientation in 3D
• Using homogeneous transformations:
• T is a 4 × 4 homogeneous transformation.
The matrix has a very specific structure and
belongs to the special Euclidean group of
dimension 3 or
22
Combining Translation and Orientation in 3D
• The 4 × 4 homogeneous transformations
form a group:
23
Summary: Pose Representations
24
Summary: Conversion between
Representations
25
Representing Attitude: Euler Angles, Unit Quaternions, and Rotation Vectors
https://www.astro.rug.nl/software/kapteyn/_downloads/attitude.pdf

More Related Content

What's hot

Chapter 2 robot kinematics
Chapter 2   robot kinematicsChapter 2   robot kinematics
Chapter 2 robot kinematics
nguyendattdh
 
Robotics: Cartesian Trajectory Planning
Robotics: Cartesian Trajectory PlanningRobotics: Cartesian Trajectory Planning
Robotics: Cartesian Trajectory Planning
Damian T. Gordon
 
57892883 geometric-modeling
57892883 geometric-modeling57892883 geometric-modeling
57892883 geometric-modeling
manojg1990
 

What's hot (19)

Inverse Kinematics Analysis for Manipulator Robot with Wrist Offset Based On ...
Inverse Kinematics Analysis for Manipulator Robot with Wrist Offset Based On ...Inverse Kinematics Analysis for Manipulator Robot with Wrist Offset Based On ...
Inverse Kinematics Analysis for Manipulator Robot with Wrist Offset Based On ...
 
Robotics position and orientation
Robotics position and orientationRobotics position and orientation
Robotics position and orientation
 
Robot forward and inverse kinematics research using matlab by d.sivasamy
Robot forward and inverse kinematics research using matlab by d.sivasamyRobot forward and inverse kinematics research using matlab by d.sivasamy
Robot forward and inverse kinematics research using matlab by d.sivasamy
 
Robot motion planning
Robot motion planningRobot motion planning
Robot motion planning
 
The inverse kinematics problem - Aiman Al-Allaq
The inverse kinematics problem - Aiman Al-AllaqThe inverse kinematics problem - Aiman Al-Allaq
The inverse kinematics problem - Aiman Al-Allaq
 
Inverse Kinematics
Inverse KinematicsInverse Kinematics
Inverse Kinematics
 
Robot Arm Kinematics
Robot Arm KinematicsRobot Arm Kinematics
Robot Arm Kinematics
 
Chapter 2 robot kinematics
Chapter 2   robot kinematicsChapter 2   robot kinematics
Chapter 2 robot kinematics
 
Exact Cell Decomposition of Arrangements used for Path Planning in Robotics
Exact Cell Decomposition of Arrangements used for Path Planning in RoboticsExact Cell Decomposition of Arrangements used for Path Planning in Robotics
Exact Cell Decomposition of Arrangements used for Path Planning in Robotics
 
IMPROVEMENTS OF THE ANALYSIS OF HUMAN ACTIVITY USING ACCELERATION RECORD OF E...
IMPROVEMENTS OF THE ANALYSIS OF HUMAN ACTIVITY USING ACCELERATION RECORD OF E...IMPROVEMENTS OF THE ANALYSIS OF HUMAN ACTIVITY USING ACCELERATION RECORD OF E...
IMPROVEMENTS OF THE ANALYSIS OF HUMAN ACTIVITY USING ACCELERATION RECORD OF E...
 
5 geometric-modeling-ppt-university-of-victoria
5 geometric-modeling-ppt-university-of-victoria5 geometric-modeling-ppt-university-of-victoria
5 geometric-modeling-ppt-university-of-victoria
 
FORWARD KINEMATIC ANALYSIS OF A ROBOTIC MANIPULATOR WITH TRIANGULAR PRISM STR...
FORWARD KINEMATIC ANALYSIS OF A ROBOTIC MANIPULATOR WITH TRIANGULAR PRISM STR...FORWARD KINEMATIC ANALYSIS OF A ROBOTIC MANIPULATOR WITH TRIANGULAR PRISM STR...
FORWARD KINEMATIC ANALYSIS OF A ROBOTIC MANIPULATOR WITH TRIANGULAR PRISM STR...
 
07 robot arm kinematics
07 robot arm kinematics07 robot arm kinematics
07 robot arm kinematics
 
Solution to Inverse Kinematics
Solution to Inverse KinematicsSolution to Inverse Kinematics
Solution to Inverse Kinematics
 
Jacobian inverse manipulator
Jacobian inverse manipulatorJacobian inverse manipulator
Jacobian inverse manipulator
 
Curves wire frame modelling
Curves wire frame modellingCurves wire frame modelling
Curves wire frame modelling
 
Robotics: Cartesian Trajectory Planning
Robotics: Cartesian Trajectory PlanningRobotics: Cartesian Trajectory Planning
Robotics: Cartesian Trajectory Planning
 
57892883 geometric-modeling
57892883 geometric-modeling57892883 geometric-modeling
57892883 geometric-modeling
 
Curves and surfaces
Curves and surfacesCurves and surfaces
Curves and surfaces
 

Similar to Robotics Representing Position & Orientation 1

Chapter_2_Representing Position and Orientation.pdf
Chapter_2_Representing Position and Orientation.pdfChapter_2_Representing Position and Orientation.pdf
Chapter_2_Representing Position and Orientation.pdf
ssuser060b2e1
 
Robotics: Forward and Inverse Kinematics
Robotics: Forward and Inverse KinematicsRobotics: Forward and Inverse Kinematics
Robotics: Forward and Inverse Kinematics
Damian T. Gordon
 

Similar to Robotics Representing Position & Orientation 1 (20)

Robotics Representing Position & Orientation
Robotics Representing Position & OrientationRobotics Representing Position & Orientation
Robotics Representing Position & Orientation
 
Chapter_2_Representing Position and Orientation.pdf
Chapter_2_Representing Position and Orientation.pdfChapter_2_Representing Position and Orientation.pdf
Chapter_2_Representing Position and Orientation.pdf
 
Kinematic models and constraints.ppt
Kinematic models and constraints.pptKinematic models and constraints.ppt
Kinematic models and constraints.ppt
 
Robotics: Forward and Inverse Kinematics
Robotics: Forward and Inverse KinematicsRobotics: Forward and Inverse Kinematics
Robotics: Forward and Inverse Kinematics
 
2A_ROBOT KINEMATICS.pptx
2A_ROBOT KINEMATICS.pptx2A_ROBOT KINEMATICS.pptx
2A_ROBOT KINEMATICS.pptx
 
3D Transformation in Computer Graphics
3D Transformation in Computer Graphics3D Transformation in Computer Graphics
3D Transformation in Computer Graphics
 
Lecture2
Lecture2Lecture2
Lecture2
 
Lecture 9-online
Lecture 9-onlineLecture 9-online
Lecture 9-online
 
FEM
FEMFEM
FEM
 
Industrial Robots
Industrial RobotsIndustrial Robots
Industrial Robots
 
Robot kinematics
Robot kinematicsRobot kinematics
Robot kinematics
 
Mathematical Structure of Kinematic Model
Mathematical Structure of Kinematic ModelMathematical Structure of Kinematic Model
Mathematical Structure of Kinematic Model
 
Stereo 3D Simulation of Rigid Body Inertia Ellipsoid for The Purpose of Unman...
Stereo 3D Simulation of Rigid Body Inertia Ellipsoid for The Purpose of Unman...Stereo 3D Simulation of Rigid Body Inertia Ellipsoid for The Purpose of Unman...
Stereo 3D Simulation of Rigid Body Inertia Ellipsoid for The Purpose of Unman...
 
lec 2 Robotics time & motion
lec 2 Robotics time & motionlec 2 Robotics time & motion
lec 2 Robotics time & motion
 
Introduction to Real Time Rendering
Introduction to Real Time RenderingIntroduction to Real Time Rendering
Introduction to Real Time Rendering
 
CO3303-1 Lecture 2.ppt
CO3303-1 Lecture 2.pptCO3303-1 Lecture 2.ppt
CO3303-1 Lecture 2.ppt
 
The Geometry of Virtual Worlds.pdf
The Geometry of Virtual Worlds.pdfThe Geometry of Virtual Worlds.pdf
The Geometry of Virtual Worlds.pdf
 
Vector calculus in Robotics Engineering
Vector calculus in Robotics EngineeringVector calculus in Robotics Engineering
Vector calculus in Robotics Engineering
 
Kinematic relationship of a object in space
Kinematic relationship of a object in spaceKinematic relationship of a object in space
Kinematic relationship of a object in space
 
Basics of Robotics
Basics of RoboticsBasics of Robotics
Basics of Robotics
 

More from cairo university

More from cairo university (20)

Tocci chapter 13 applications of programmable logic devices extended
Tocci chapter 13 applications of programmable logic devices extendedTocci chapter 13 applications of programmable logic devices extended
Tocci chapter 13 applications of programmable logic devices extended
 
Tocci chapter 12 memory devices
Tocci chapter 12 memory devicesTocci chapter 12 memory devices
Tocci chapter 12 memory devices
 
Tocci ch 9 msi logic circuits
Tocci ch 9 msi logic circuitsTocci ch 9 msi logic circuits
Tocci ch 9 msi logic circuits
 
Tocci ch 7 counters and registers modified x
Tocci ch 7 counters and registers modified xTocci ch 7 counters and registers modified x
Tocci ch 7 counters and registers modified x
 
Tocci ch 6 digital arithmetic operations and circuits
Tocci ch 6 digital arithmetic operations and circuitsTocci ch 6 digital arithmetic operations and circuits
Tocci ch 6 digital arithmetic operations and circuits
 
Tocci ch 3 5 boolean algebra, logic gates, combinational circuits, f fs, - re...
Tocci ch 3 5 boolean algebra, logic gates, combinational circuits, f fs, - re...Tocci ch 3 5 boolean algebra, logic gates, combinational circuits, f fs, - re...
Tocci ch 3 5 boolean algebra, logic gates, combinational circuits, f fs, - re...
 
A15 sedra ch 15 memory circuits
A15  sedra ch 15 memory circuitsA15  sedra ch 15 memory circuits
A15 sedra ch 15 memory circuits
 
A14 sedra ch 14 advanced mos and bipolar logic circuits
A14  sedra ch 14 advanced mos and bipolar logic circuitsA14  sedra ch 14 advanced mos and bipolar logic circuits
A14 sedra ch 14 advanced mos and bipolar logic circuits
 
A13 sedra ch 13 cmos digital logic circuits
A13  sedra ch 13 cmos digital logic circuitsA13  sedra ch 13 cmos digital logic circuits
A13 sedra ch 13 cmos digital logic circuits
 
A09 sedra ch 9 frequency response
A09  sedra ch 9 frequency responseA09  sedra ch 9 frequency response
A09 sedra ch 9 frequency response
 
5 sedra ch 05 mosfet.ppsx
5  sedra ch 05  mosfet.ppsx5  sedra ch 05  mosfet.ppsx
5 sedra ch 05 mosfet.ppsx
 
5 sedra ch 05 mosfet
5  sedra ch 05  mosfet5  sedra ch 05  mosfet
5 sedra ch 05 mosfet
 
5 sedra ch 05 mosfet revision
5  sedra ch 05  mosfet revision5  sedra ch 05  mosfet revision
5 sedra ch 05 mosfet revision
 
Fields Lec 2
Fields Lec 2Fields Lec 2
Fields Lec 2
 
Fields Lec 1
Fields Lec 1Fields Lec 1
Fields Lec 1
 
Fields Lec 5&6
Fields Lec 5&6Fields Lec 5&6
Fields Lec 5&6
 
Fields Lec 4
Fields Lec 4Fields Lec 4
Fields Lec 4
 
Fields Lec 3
Fields Lec 3Fields Lec 3
Fields Lec 3
 
Lecture 2 (system overview of c8051 f020) rv01
Lecture 2 (system overview of c8051 f020) rv01Lecture 2 (system overview of c8051 f020) rv01
Lecture 2 (system overview of c8051 f020) rv01
 
Lecture 1 (course overview and 8051 architecture) rv01
Lecture 1 (course overview and 8051 architecture) rv01Lecture 1 (course overview and 8051 architecture) rv01
Lecture 1 (course overview and 8051 architecture) rv01
 

Recently uploaded

FULL ENJOY Call Girls In Mahipalpur Delhi Contact Us 8377877756
FULL ENJOY Call Girls In Mahipalpur Delhi Contact Us 8377877756FULL ENJOY Call Girls In Mahipalpur Delhi Contact Us 8377877756
FULL ENJOY Call Girls In Mahipalpur Delhi Contact Us 8377877756
dollysharma2066
 
XXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXX
XXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXX
XXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXX
ssuser89054b
 
VIP Call Girls Ankleshwar 7001035870 Whatsapp Number, 24/07 Booking
VIP Call Girls Ankleshwar 7001035870 Whatsapp Number, 24/07 BookingVIP Call Girls Ankleshwar 7001035870 Whatsapp Number, 24/07 Booking
VIP Call Girls Ankleshwar 7001035870 Whatsapp Number, 24/07 Booking
dharasingh5698
 
Call Girls In Bangalore ☎ 7737669865 🥵 Book Your One night Stand
Call Girls In Bangalore ☎ 7737669865 🥵 Book Your One night StandCall Girls In Bangalore ☎ 7737669865 🥵 Book Your One night Stand
Call Girls In Bangalore ☎ 7737669865 🥵 Book Your One night Stand
amitlee9823
 
VIP Call Girls Palanpur 7001035870 Whatsapp Number, 24/07 Booking
VIP Call Girls Palanpur 7001035870 Whatsapp Number, 24/07 BookingVIP Call Girls Palanpur 7001035870 Whatsapp Number, 24/07 Booking
VIP Call Girls Palanpur 7001035870 Whatsapp Number, 24/07 Booking
dharasingh5698
 
Call Now ≽ 9953056974 ≼🔝 Call Girls In New Ashok Nagar ≼🔝 Delhi door step de...
Call Now ≽ 9953056974 ≼🔝 Call Girls In New Ashok Nagar  ≼🔝 Delhi door step de...Call Now ≽ 9953056974 ≼🔝 Call Girls In New Ashok Nagar  ≼🔝 Delhi door step de...
Call Now ≽ 9953056974 ≼🔝 Call Girls In New Ashok Nagar ≼🔝 Delhi door step de...
9953056974 Low Rate Call Girls In Saket, Delhi NCR
 

Recently uploaded (20)

Call for Papers - International Journal of Intelligent Systems and Applicatio...
Call for Papers - International Journal of Intelligent Systems and Applicatio...Call for Papers - International Journal of Intelligent Systems and Applicatio...
Call for Papers - International Journal of Intelligent Systems and Applicatio...
 
Intze Overhead Water Tank Design by Working Stress - IS Method.pdf
Intze Overhead Water Tank  Design by Working Stress - IS Method.pdfIntze Overhead Water Tank  Design by Working Stress - IS Method.pdf
Intze Overhead Water Tank Design by Working Stress - IS Method.pdf
 
NFPA 5000 2024 standard .
NFPA 5000 2024 standard                                  .NFPA 5000 2024 standard                                  .
NFPA 5000 2024 standard .
 
FULL ENJOY Call Girls In Mahipalpur Delhi Contact Us 8377877756
FULL ENJOY Call Girls In Mahipalpur Delhi Contact Us 8377877756FULL ENJOY Call Girls In Mahipalpur Delhi Contact Us 8377877756
FULL ENJOY Call Girls In Mahipalpur Delhi Contact Us 8377877756
 
data_management_and _data_science_cheat_sheet.pdf
data_management_and _data_science_cheat_sheet.pdfdata_management_and _data_science_cheat_sheet.pdf
data_management_and _data_science_cheat_sheet.pdf
 
XXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXX
XXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXX
XXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXXX
 
VIP Call Girls Ankleshwar 7001035870 Whatsapp Number, 24/07 Booking
VIP Call Girls Ankleshwar 7001035870 Whatsapp Number, 24/07 BookingVIP Call Girls Ankleshwar 7001035870 Whatsapp Number, 24/07 Booking
VIP Call Girls Ankleshwar 7001035870 Whatsapp Number, 24/07 Booking
 
BSides Seattle 2024 - Stopping Ethan Hunt From Taking Your Data.pptx
BSides Seattle 2024 - Stopping Ethan Hunt From Taking Your Data.pptxBSides Seattle 2024 - Stopping Ethan Hunt From Taking Your Data.pptx
BSides Seattle 2024 - Stopping Ethan Hunt From Taking Your Data.pptx
 
(INDIRA) Call Girl Aurangabad Call Now 8617697112 Aurangabad Escorts 24x7
(INDIRA) Call Girl Aurangabad Call Now 8617697112 Aurangabad Escorts 24x7(INDIRA) Call Girl Aurangabad Call Now 8617697112 Aurangabad Escorts 24x7
(INDIRA) Call Girl Aurangabad Call Now 8617697112 Aurangabad Escorts 24x7
 
KubeKraft presentation @CloudNativeHooghly
KubeKraft presentation @CloudNativeHooghlyKubeKraft presentation @CloudNativeHooghly
KubeKraft presentation @CloudNativeHooghly
 
Call Girls In Bangalore ☎ 7737669865 🥵 Book Your One night Stand
Call Girls In Bangalore ☎ 7737669865 🥵 Book Your One night StandCall Girls In Bangalore ☎ 7737669865 🥵 Book Your One night Stand
Call Girls In Bangalore ☎ 7737669865 🥵 Book Your One night Stand
 
UNIT - IV - Air Compressors and its Performance
UNIT - IV - Air Compressors and its PerformanceUNIT - IV - Air Compressors and its Performance
UNIT - IV - Air Compressors and its Performance
 
Call Girls Pimpri Chinchwad Call Me 7737669865 Budget Friendly No Advance Boo...
Call Girls Pimpri Chinchwad Call Me 7737669865 Budget Friendly No Advance Boo...Call Girls Pimpri Chinchwad Call Me 7737669865 Budget Friendly No Advance Boo...
Call Girls Pimpri Chinchwad Call Me 7737669865 Budget Friendly No Advance Boo...
 
Double rodded leveling 1 pdf activity 01
Double rodded leveling 1 pdf activity 01Double rodded leveling 1 pdf activity 01
Double rodded leveling 1 pdf activity 01
 
Call Girls Walvekar Nagar Call Me 7737669865 Budget Friendly No Advance Booking
Call Girls Walvekar Nagar Call Me 7737669865 Budget Friendly No Advance BookingCall Girls Walvekar Nagar Call Me 7737669865 Budget Friendly No Advance Booking
Call Girls Walvekar Nagar Call Me 7737669865 Budget Friendly No Advance Booking
 
VIP Call Girls Palanpur 7001035870 Whatsapp Number, 24/07 Booking
VIP Call Girls Palanpur 7001035870 Whatsapp Number, 24/07 BookingVIP Call Girls Palanpur 7001035870 Whatsapp Number, 24/07 Booking
VIP Call Girls Palanpur 7001035870 Whatsapp Number, 24/07 Booking
 
The Most Attractive Pune Call Girls Manchar 8250192130 Will You Miss This Cha...
The Most Attractive Pune Call Girls Manchar 8250192130 Will You Miss This Cha...The Most Attractive Pune Call Girls Manchar 8250192130 Will You Miss This Cha...
The Most Attractive Pune Call Girls Manchar 8250192130 Will You Miss This Cha...
 
Double Revolving field theory-how the rotor develops torque
Double Revolving field theory-how the rotor develops torqueDouble Revolving field theory-how the rotor develops torque
Double Revolving field theory-how the rotor develops torque
 
Call Now ≽ 9953056974 ≼🔝 Call Girls In New Ashok Nagar ≼🔝 Delhi door step de...
Call Now ≽ 9953056974 ≼🔝 Call Girls In New Ashok Nagar  ≼🔝 Delhi door step de...Call Now ≽ 9953056974 ≼🔝 Call Girls In New Ashok Nagar  ≼🔝 Delhi door step de...
Call Now ≽ 9953056974 ≼🔝 Call Girls In New Ashok Nagar ≼🔝 Delhi door step de...
 
VIP Model Call Girls Kothrud ( Pune ) Call ON 8005736733 Starting From 5K to ...
VIP Model Call Girls Kothrud ( Pune ) Call ON 8005736733 Starting From 5K to ...VIP Model Call Girls Kothrud ( Pune ) Call ON 8005736733 Starting From 5K to ...
VIP Model Call Girls Kothrud ( Pune ) Call ON 8005736733 Starting From 5K to ...
 

Robotics Representing Position & Orientation 1

  • 1. SBE 403 B: Bioelectronic Systems (Biomedical Robotics) Lecture 03 Representing Position and Orientation 2Orientation 2 Muhammad Rushdi mrushdi@eng1.cu.edu.eg
  • 2. Main Problems in Robotics • What are the basic issues to be resolved and what must we learn in order to be able to program a robot to perform its tasks? • Problem 1: Forward Kinematics • Problem 2: Inverse Kinematics • Problem 3: Velocity Kinematics Represent• Problem 3: Velocity Kinematics • Problem 4: Path Planning • Problem 5: Vision • Problem 6: Dynamics • Problem 7: Position Control • Problem 8: Force Control 2 the position and orientation of objects (e.g. robots, cameras, workpieces, obstacles and paths) in an environment.
  • 3. Textbook • Ch. 2 Representing Position and Orientation Peter Corke: Robotics, Vision and Control - Fundamental Algorithms in MATLAB®. http://www.petercorke.com/RVC/ 3
  • 4. Representing Pose in 3D • The 3D case is an extension of the 2D case. • Add an extra coordinate axis, typically denoted by z, that is orthogonal to both the x- and y-axes. The direction of the z-axis obeys the right-hand rule and forms a right-handed coordinate frame. 4
  • 5. Euler’s rotation theorem • Any two independent orthonormal coordinate frames can be related by a sequence of rotations (not more than three) about coordinate axes, where no two successive rotations may be about the same axis. 5
  • 7. 3D Rotations are Non-commutative 7
  • 8. Representing 3D Rotations: Orthonormal Rotation Matrix • Each unit vector has three elements and they form the columns of a 3 × 3 orthonormal matrix • R is orthogonal and has a +1 determinant • The matrix R belongs to the special orthogonal group of dimension 3 or 8
  • 9. Representing 3D Rotations: Orthonormal Rotation Matrix • The orthonormal rotation matrices for rotation of θ about the x-, y- and z-axes are 9
  • 10. Representing 3D Rotations: Orthonormal Rotation Matrix • The orthonormal rotation matrices give a non-minimal representation: • The orthonormal matrix has 9 elements but they are not independent. The columnsthey are not independent. The columns have unit magnitude which provides 3 constraints. The columns are orthogonal to each other which provides another 3 constraints. Nine elements and six constraints is effectively 3 independent values. 10
  • 11. Representing 3D Rotations: Three-Angle Representations (Euler Angles) • There are two classes of Euler Angle rotation sequences: • The Eulerian type involves repetition, but not successive, of rotations about one particularsuccessive, of rotations about one particular axis: XYX, XZX, YXY, YZY, ZXZ, or ZYZ. • Example: ZYZ used commonly in aeronautics and mechanics: • The Cardanian type is characterized by rotations about all three axes: XYZ, XZY, YZX, YXZ, ZXY, or ZYX. 1112 possible sequences
  • 12. Representing 3D Rotations: Mapping between Rotation Matrices and Euler Angles • The mapping from rotation matrix to Euler angles is not unique and always returns a positive angle for θ (See the Matlab example pp. 29,30). • For the case where θ =0, the rotation reduces to • For the inverse operation we can therefore only determine this angle sum. This case represents a singularity, when the rotational axis of the middle term in the sequence becomes parallel to the rotation axis of the first or third term. 12 See also: Computing Euler angles from a rotation matrix http://www.staff.city.ac.uk/~sbbh653/publications/euler.pdf
  • 13. Representing 3D Rotations: Three-Angle Representations (Euler Angles) • Singularities and Gimbal Lock: Consider the situation when the rotation angle of the middle gimbal (rotation about the spacecraft’s z-axis) is 90° – the axes of the inner and outer gimbals are aligned and they share the same rotation axis. Instead of the original three rotational axes, since two are parallel, there are now only two effective rotational axesare parallel, there are now only two effective rotational axes – we say that one degree of freedom has been lost. 13
  • 14. Representing 3D Rotations: Three-Angle Representations (Euler Angles) • Singularities and Gimbal Lock: All three- angle representations of attitude, whether Eulerian or Cardanian, suffer this problem of gimbal lock when two consecutive axes become aligned. • The best that can be hoped for is that the singularity occurs for an attitude which does not occur during normal operation of the vehicle – it requires judicious choice of angle sequence and coordinate system. • Singularities are an unfortunate consequence of using a minimal representation. To eliminate this problem we need to adopt different representations of orientation: Add a fourth parameter. 14
  • 15. Representing 3D Rotations: Two Vector Representation • For arm-type robots it is useful to consider a coordinate frame {E} attached to the end-effector. By convention the axis of the tool is associated with the z-axis and is called the approach vector. An orthogonal vector that provides orientation, perhaps between the two fingers of the robot’s gripper is called the orientation vector. 15
  • 16. Representing 3D Rotations: Rotation about an Arbitrary Vector (Angle-Axis) • Two coordinate frames of arbitrary orientation are related by a single rotation about some axis in space. • This information is encoded in the eigenvalues and eigenvectors of R. • An orthonormal rotation matrix will always have one real eigenvalue at λ = 1 and a complex pair λ =cosθ ±i sinθeigenvalue at λ = 1 and a complex pair λ =cosθ ±i sinθ where θ is the rotation angle. • From the definition of eigenvalues and eigenvectors we recall that where v is the eigenvector corresponding to λ. For the case λ =1 then which implies that the corresponding eigenvector v is unchanged by the rotation. There is only one such vector and that is the one about which the rotation occurs. 16
  • 17. Representing 3D Rotations: Rotation about an Arbitrary Vector (Angle-Axis) • Converting from angle and vector to a rotation matrix is achieved using Rodrigues’ rotation formula: where S is a skew symmetric matrix: • The angle-vector representation is minimal (if the rotation vector is normalized) and efficient in terms of data storage but is analytically problematic. 17
  • 18. Representing 3D Rotations: Unit Quaternions • The quaternion is an extension of the complex number – a hyper-complex number – and is written as a scalar plus a vector wherewhere and • We will denote a quaternion as • Quaternions are elegant, powerful and computationally straightforward and widely used for robotics, computer vision, computer graphics and aerospace inertial navigation applications. 18
  • 19. Representing 3D Rotations: Unit Quaternions • To represent rotations we use unit-quaternions. These are quaternions of unit magnitude, that is, those for which • The unit-quaternion has the special property that it can be considered as a rotation of θ about a unit vector which areconsidered as a rotation of θ about a unit vector which are related to the quaternion components by 19
  • 20. Representing 3D Rotations: Unit Quaternions • If we write the quaternion as a 4- vector (s,v1,v2,v2) then multiplication can be expressed as a matrix-vector product where • Quaternions form a group:• Quaternions form a group: 20
  • 21. Combining Translation and Orientation in 3D • Using Translation + Quaternions: 21
  • 22. Combining Translation and Orientation in 3D • Using homogeneous transformations: • T is a 4 × 4 homogeneous transformation. The matrix has a very specific structure and belongs to the special Euclidean group of dimension 3 or 22
  • 23. Combining Translation and Orientation in 3D • The 4 × 4 homogeneous transformations form a group: 23
  • 25. Summary: Conversion between Representations 25 Representing Attitude: Euler Angles, Unit Quaternions, and Rotation Vectors https://www.astro.rug.nl/software/kapteyn/_downloads/attitude.pdf