Pose2D [geometry_msgs/Pose2D]: float64 x float64 y float64 theta.

Slides:



Advertisements
Similar presentations
Transformations Ed Angel Professor Emeritus of Computer Science
Advertisements

Kinematics Pose (position and orientation) of a Rigid Body
Chris Hall Aerospace and Ocean Engineering
Linear Transformations
Computer Graphics Recitation 2. 2 The plan today Learn about rotations in 2D and 3D. Representing rotations by quaternions.
Ch. 2: Rigid Body Motions and Homogeneous Transforms
3-D Geometry.
6 1 Linear Transformations. 6 2 Hopfield Network Questions.
Rotations. Space and Body  Space coordinates are an inertial system. Fixed in spaceFixed in space  Body coordinates are a non- inertial system. Move.
Transformations CS4395: Computer Graphics 1 Mohan Sridharan Based on slides created by Edward Angel.
Computer Animation Rick Parent Computer Animation Algorithms and Techniques Technical Background.
An Introduction to Robot Kinematics
ME/ECE Professor N. J. Ferrier Forward Kinematics Professor Nicola Ferrier ME Room 2246,
1 C01 – Advanced Robotics for Autonomous Manipulation Department of Mechanical EngineeringME 696 – Advanced Topics in Mechanical Engineering.
1 Kinematics ( 運動學 ) Primer Jyun-Ming Chen Fall 2009.
Rotations and Translations
CS 480/680 Computer Graphics Transformations Dr. Frederick C Harris, Jr.
Kinematics of Robot Manipulator
Chapter 2 Robot Kinematics: Position Analysis
Rotations and Translations
Rick Parent - CIS681 ORIENTATION Use Quaternions Interpolating rotations is difficult.
Advanced Computer Graphics Spring 2014
1 Fundamentals of Robotics Linking perception to action 2. Motion of Rigid Bodies 南台科技大學電機工程系謝銘原.
Transformations Angel Angel: Interactive Computer Graphics5E © Addison-Wesley
T. Bajd, M. Mihelj, J. Lenarčič, A. Stanovnik, M. Munih, Robotics, Springer, 2010 GEOMETRIC DESCRIPTION OF THE ROBOT MECHANISM T. Bajd and M. Mihelj.
Kinematics Jehee Lee Seoul National University. Kinematics How to animate skeletons (articulated figures) Kinematics is the study of motion without regard.
Robot Kinematics: Position Analysis 2.1 INTRODUCTION  Forward Kinematics: to determine where the robot ’ s hand is? (If all joint variables are known)
What is Kinematics. Kinematics studies the motion of bodies.
Rotation matrices 1 Constructing rotation matricesEigenvectors and eigenvalues 0 x y.
Kinematics. The function of a robot is to manipulate objects in its workspace. To manipulate objects means to cause them to move in a desired way (as.
The Spinning Top Chloe Elliott. Rigid Bodies Six degrees of freedom:  3 cartesian coordinates specifying position of centre of mass  3 angles specifying.
Chapter 2: Description of position and orientation Faculty of Engineering - Mechanical Engineering Department ROBOTICS Outline: Introduction. Descriptions:
Comparing Two Motions Jehee Lee Seoul National University.
Euler Angles This means, that we can represent an orientation with 3 numbers Assuming we limit ourselves to 3 rotations without successive rotations about.
Computer Graphics I, Fall 2010 Transformations.
Forward Kinematics Where is my hand ?. Examples Denavit-Hartenberg Specialized description of articulated figures (joints) Each joint has only one degree.
1 Introduction to Computer Graphics with WebGL Ed Angel Professor Emeritus of Computer Science Founding Director, Arts, Research, Technology and Science.
1 Angel: Interactive Computer Graphics 4E © Addison-Wesley 2005 Transformations Ed Angel Professor of Computer Science, Electrical and Computer Engineering,
Sect. 4.5: Cayley-Klein Parameters 3 independent quantities are needed to specify a rigid body orientation. Most often, we choose them to be the Euler.
Robotic Arms and Matrices By Chris Wong and Chris Marino.
Robotics Chapter 3 – Forward Kinematics
CS682, Jana Kosecka Rigid Body Motion and Image Formation Jana Kosecka
Objectives Introduce standard transformations Introduce standard transformations Derive homogeneous coordinate transformation matrices Derive homogeneous.
Kinematics 제어시스템 이론 및 실습 조현우
Computer Animation Algorithms and Techniques
CPSC 641: Computer Graphics Rotation Representation and Interpolation
Spatcial Description & Transformation
Transformations Objectives
3D Kinematics Consists of two parts
Ch. 2: Rigid Body Motions and Homogeneous Transforms
Problem 1.5: For this problem, we need to figure out the length of the blue segment shown in the figure. This can be solved easily using similar triangles.
F o r w a r d K i n e m a t i c s.
CHAPTER 2 FORWARD KINEMATIC 1.
Direct Kinematic Model
Mobile Robot Kinematics
CSE4421/5324: Introduction to Robotics
Homogeneous Transformation Matrices
CHAPTER 2 FORWARD KINEMATIC 1.
Manipulator Dynamics 2 Instructor: Jacob Rosen
Rigid Body Transformations
Transformations Ed Angel
Geometric Objects and Transformations (II)
Robotics and Perception
Transformations Ed Angel Professor Emeritus of Computer Science
Isaac Gang University of Mary Hardin-Baylor
UNIVERSITY OF ILLINOIS AT URBANA-CHAMPAIGN
Rigid Body Transformations
Rotation and Orientation: Fundamentals
Physics 319 Classical Mechanics
Screw Rotation and Other Rotational Forms
Presentation transcript:

Pose2D [geometry_msgs/Pose2D]: float64 x float64 y float64 theta

Flight Dynamics

The Six Degrees of Freedom

Axes of Rotation

Euler's Theorem (1776) Euler states the theorem as follows: When a sphere is moved around its centre it is always possible to find a diameter whose direction in the displaced position is the same as in the initial position. http://en.wikipedia.org/wiki/Euler%27s_rotation_theorem

Euler's Theorem Any rotation or sequence of rotations of a rigid body or coordinate system about a fixed point is equivalent to a single rotation by a given angle θ about a fixed axis (called Euler axis) that runs through the fixed point http://en.wikipedia.org/wiki/Quaternions_and_spatial_rotation

Quaternions Given an axis K = [kx, ky, kz] T and an angle θ, one can compute the Euler parameters or unit quaternion: with

Intuition for the vector-angle representation Compute the eigenvectors and eigenvalues of the rotation matrix R R v = λ v with v the eigenvector corresponding to λ Since R is an orthonormal matrix, it has three eigenvectors: λ1 = 1 λ2, = cosθ + i sin θ λ3, = cosθ - i sin θ For λ = 1 the eigenvector is unchanged by the transformation R. Thus v is the actual axis of rotation. The angle θ can be inferred from the complex pair.

Example r = (0.1, 0.2, 0.0.3)

Multiplication of two rotation matrices Two quaternions εi and εi’ are multiplied as follows:

Right Hand Rule X Y Z

Quaternions x y z w 0 0 0 1

Quaternions x y z w 1 0 0 1 .707 0 0 .707

Quaternions x y z w 0 1 0 1 0 .707 0 .707

Quaternions x y z w 0 0 1 1 0 0 .707 .707

Quaternions x y z w 1 0 0 -0.5 0.894 0.000 0.000 -0.447

Strike a Pose [geometry_msgs/Pose]: geometry_msgs/Point position float64 x float64 y float64 z geometry_msgs/Quaternion orientation float64 w

Translating Quaternions from tf.transformations import * $ print euler_from_quaternion([0.06146, 0, 0, 0.99810] [0.123, 0, 0] $ print quaternion_from_euler(1, 2, 3, 'ryxz') [0.310622, -0.718287, 0.444435, 0.435953]

Transformations (tf)

URDF <?xml version="1.0"?> <robot name="myfirst"> <link name="base_link"> <visual> <geometry> <cylinder length="0.6" radius="0.2"/> </geometry> </visual> </link> </robot>

URDF <?xml version="1.0"?> <robot name="multipleshapes"> <link name="base_link"> ... </link> <link name="right_leg"> <visual> <geometry> <box size="0.6 .2 .1"/> </geometry></visual></link> <joint name="base_to_right_leg" type="fixed"> <parent link="base_link"/> <child link="right_leg"/> </joint> </robot>

URDF <link name="right_leg"> <visual> <geometry> <box size="0.6 .2 .1"/> </geometry> <origin rpy="0 1.57075 0" xyz="0 0 -0.3"/> </visual> </link> <joint name="base_to_right_leg" type="fixed"> <parent link="base_link"/> <child link="right_leg"/> <origin xyz="0.22 0 .25"/> </joint>

Rotation

Rotation

Rotation

Robot Geometry Pipeline URDF Joint State Publisher Robot State Publisher Joint States Transforms (tf) urdf: XML parameter /robot_description joint states: topic sensor_msgs/JointState TF: topic /tf

tf Library

rviz