SlideShare una empresa de Scribd logo
1 de 13
Robotics lec 6
BY : Mahmoud Hussein
The idea of motion
 To move a robot smoothly from one pose to another, we need smooth and
coordinated motion of all of its joints.
 we begin by looking at how to create smooth paths for the robot end effector
moving from one pose to another. There are two approaches we will introduce you
to. The first is what’s called a joint interpolated trajectory where we take the initial
pose and final pose and we use inverse kinematics to determine the initial and final
sets of joint values; then, we smoothly interpolate between those two sets.
 The second approach is to compute a Cartesian interpolated trajectory and what
we do here is interpolate between the initial and final end effector poses. Then, for
each interpolated pose, we compute the inverse kinematics to find the joint values
that are appropriate at that particular time step.
Interpolation of a scalar
 We want to make our robot to move from A to B , when the motion start, the end
effector of the robot arm is at a position or (pose) A and at the end of the motion ,
the end effector of the robot arm is at a position or (Pose)B , during the motion the
robot's position is changing smoothly and ideally the shortest path.
 We’ll start in a simple way and see how this works for a point moving along a
number line, and then apply those principles to two common approaches for
robotic motion: joint interpolation and Cartesian interpolation.
 Consider A and B are two points in real number line and we wish to move smoothly
between them. We can construct a function
 X(t) = A +(B - A) t
Interpolation of a scalar
 Such that the time variable t varies from 0 to 1 , that o<= t <=1.you should
convince your self that X(0)=A and X(1)=B we call this a trajectory a set of times
and points(ti , x(i)) that defines how the point moves as a function of time We can
choose to divide the time interval into as many steps, time steps, as we desire. This
is commonly known as linear interpolation and does the job very nicely, but has the
drawback that the motion is not totally smooth - let’s examine why.
 The point is initially not moving, and then at t=0 it starts to move with a velocity of
(B - A) since it has to cover the distance from A to B which is (B - A) in 1 second.
When it arrives at B it suddenly stops. The sudden changes in velocity at the start
and at the end mean massive accelerations– this is not a problem when moving a
mathematical point (which has no mass) along a number line but it is a very real
problem for the motors of a real robot.
Interpolation of a scalar
 What we need is a way for our point to smoothly accelerate at the beginning of the
motion and then smoothly decelerate at the end. Fortunately the Toolbox has a
function that does just this. Consider the problem of moving smoothly from X= - 2
to X = 3 n fifty steps. Using the Toolbox the solution is tpoly(-2,3,50)
 If you want to create vector we can do it
 X=tpoly(-2,3,50)
Joint interpolation in 2 D
 we learned how to interpolate a scalar smoothly between two values. Now, we
want to do this for the robot’s joint values, which are a vector.
 We define qA as a vector of the joint values (angles or lengths) at the robot’s initial
position (or pose). For a robot with N oints, this will be a vector of length N .
 Similarly , qB s a vector of the joint values (angles or lengths) at the robot’s final
position (or pose), and is the same length as qA
 Now we want to find a series of vectors that move smoothly between the values qA
and qB . Consider that qA=(-0.3 , 0.5) and qB=(0.5 ,0.2)
 qA=[-0.3 0.5]
 qB=[0.5 0.2]
 q=jtraj(qA,qB,50)
Cartesian interpolation in 2 D
 Now we have made our non-physical robot move as its joint angles followed a
trajectory – it moved from A to B. However, as we saw in the last step, close
scrutiny shows that between points A and B, the robot’s end effector does not
follow a straight line.
 For many robot applications, this is not important and joint interpolated motion is
adequate and easy to compute. However, there are some applications where
following a straight line is important – perhaps the robot is doing a cutting or
welding task. The solution we require is called Cartesian interpolation, and involves
interpolating points in the 2-dimensional (2D) Cartesian coordinate frame rather
than the 2D robot joint space. Consider two points in the 2D Cartesian coordinate
frame
 qA=[-0.3 0.5]
 qB=[0.5 0.2]
 q=mjtraj(@tpoly,qA,qB,50)
Motion in 3D
 Mdl_puma560
Motion in 3 D
Motion in 3 D
 Figure
 qplot(tg)
Cartesian interpolation in 3D
 Ts=ctraj(TA,TB,50);
 Ts(:,:,1)
 Ts(:,:,2)
 And so on
Cartesian interpolation in 3D
Cartesian interpolation in 3D
 Figure
 qplot(ts)

Más contenido relacionado

La actualidad más candente

La actualidad más candente (20)

End effectors
End effectorsEnd effectors
End effectors
 
Robotics and Automation Introduction
Robotics and Automation IntroductionRobotics and Automation Introduction
Robotics and Automation Introduction
 
Manipulator kinematics
Manipulator kinematicsManipulator kinematics
Manipulator kinematics
 
Grippers
GrippersGrippers
Grippers
 
Robotics - unit-2 - end effector
Robotics - unit-2 - end effectorRobotics - unit-2 - end effector
Robotics - unit-2 - end effector
 
Robot programming
Robot programmingRobot programming
Robot programming
 
Hydraulic and Pneumatic Drive System
Hydraulic and Pneumatic Drive SystemHydraulic and Pneumatic Drive System
Hydraulic and Pneumatic Drive System
 
Inverse Kinematics
Inverse KinematicsInverse Kinematics
Inverse Kinematics
 
Robotics End Effector
Robotics End EffectorRobotics End Effector
Robotics End Effector
 
Robotics Endeffectors
Robotics EndeffectorsRobotics Endeffectors
Robotics Endeffectors
 
Chapter 8 - Robot Control System
Chapter 8 - Robot Control SystemChapter 8 - Robot Control System
Chapter 8 - Robot Control System
 
Actuators
ActuatorsActuators
Actuators
 
Dek3223 chapter 3 industrial robotic
Dek3223 chapter 3 industrial roboticDek3223 chapter 3 industrial robotic
Dek3223 chapter 3 industrial robotic
 
Unit-I Robotics
Unit-I RoboticsUnit-I Robotics
Unit-I Robotics
 
Electric drive systems in Robotics
Electric drive systems in RoboticsElectric drive systems in Robotics
Electric drive systems in Robotics
 
ROBOTICS - Introduction to Robotics
ROBOTICS -  Introduction to RoboticsROBOTICS -  Introduction to Robotics
ROBOTICS - Introduction to Robotics
 
Robot joints PDF
Robot joints PDFRobot joints PDF
Robot joints PDF
 
Robotics or Robot Technology
Robotics or Robot Technology Robotics or Robot Technology
Robotics or Robot Technology
 
Denavit Hartenberg Algorithm
Denavit Hartenberg AlgorithmDenavit Hartenberg Algorithm
Denavit Hartenberg Algorithm
 
Robotics unit4 slides
Robotics unit4 slidesRobotics unit4 slides
Robotics unit4 slides
 

Destacado (9)

Robotics lec7
Robotics lec7Robotics lec7
Robotics lec7
 
Dh parameter application
Dh parameter applicationDh parameter application
Dh parameter application
 
Automation lecture5
Automation lecture5Automation lecture5
Automation lecture5
 
Automation lec4
Automation lec4Automation lec4
Automation lec4
 
Automation lec4
Automation lec4Automation lec4
Automation lec4
 
Pneumatic control
Pneumatic controlPneumatic control
Pneumatic control
 
Automation lecture 6
Automation lecture 6Automation lecture 6
Automation lecture 6
 
Neural network
Neural networkNeural network
Neural network
 
Motors types
Motors typesMotors types
Motors types
 

Similar a Robotics lec 6

lec 2 Robotics time & motion
lec 2 Robotics time & motionlec 2 Robotics time & motion
lec 2 Robotics time & motioncairo university
 
Research on The Control of Joint Robot Trajectory
Research on The Control of Joint Robot TrajectoryResearch on The Control of Joint Robot Trajectory
Research on The Control of Joint Robot TrajectoryIJRESJOURNAL
 
RMV Mechanics
RMV MechanicsRMV Mechanics
RMV Mechanicsanand hd
 
9783319319681 c2-3
9783319319681 c2-39783319319681 c2-3
9783319319681 c2-3g271188
 
090RobotTrajectoryGenerationEn.pdf
090RobotTrajectoryGenerationEn.pdf090RobotTrajectoryGenerationEn.pdf
090RobotTrajectoryGenerationEn.pdfsivapathuri
 
Two Link Robotic Manipulator
Two Link Robotic ManipulatorTwo Link Robotic Manipulator
Two Link Robotic ManipulatorTravis Heidrich
 
Optimal straight-line-trajectory-generation-in-3 d-space-using-deviation-algo...
Optimal straight-line-trajectory-generation-in-3 d-space-using-deviation-algo...Optimal straight-line-trajectory-generation-in-3 d-space-using-deviation-algo...
Optimal straight-line-trajectory-generation-in-3 d-space-using-deviation-algo...Cemal Ardil
 
simuliton of biped walkinng robot using kinematics
simuliton of biped walkinng robot using kinematicssimuliton of biped walkinng robot using kinematics
simuliton of biped walkinng robot using kinematicsReza Fazaeli
 
Jacobian | velocity and static forces
Jacobian | velocity and static forcesJacobian | velocity and static forces
Jacobian | velocity and static forcesAbrar Mohamed
 
Mba Ebooks ! Edhole
Mba Ebooks ! EdholeMba Ebooks ! Edhole
Mba Ebooks ! EdholeEdhole.com
 
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.pdfssuser060b2e1
 
Chapter 2 - Robot Kinematics.ppt
Chapter 2 - Robot Kinematics.pptChapter 2 - Robot Kinematics.ppt
Chapter 2 - Robot Kinematics.pptHoDMechanical9
 
Lecture 1 trajectory generation
Lecture 1 trajectory generation Lecture 1 trajectory generation
Lecture 1 trajectory generation cairo university
 
A Bionic gait programming algorithm for Hexapod Robot
A Bionic gait programming algorithm for Hexapod RobotA Bionic gait programming algorithm for Hexapod Robot
A Bionic gait programming algorithm for Hexapod RobotHao Yuan Cheng
 
Amazon.comThe three main activities that e.docx
Amazon.comThe three main activities that e.docxAmazon.comThe three main activities that e.docx
Amazon.comThe three main activities that e.docxnettletondevon
 

Similar a Robotics lec 6 (20)

03 time and motion
03 time and motion03 time and motion
03 time and motion
 
lec 2 Robotics time & motion
lec 2 Robotics time & motionlec 2 Robotics time & motion
lec 2 Robotics time & motion
 
Research on The Control of Joint Robot Trajectory
Research on The Control of Joint Robot TrajectoryResearch on The Control of Joint Robot Trajectory
Research on The Control of Joint Robot Trajectory
 
Sphero Write Up
Sphero Write UpSphero Write Up
Sphero Write Up
 
Kiaras Ioannis cern
Kiaras Ioannis cernKiaras Ioannis cern
Kiaras Ioannis cern
 
RMV Mechanics
RMV MechanicsRMV Mechanics
RMV Mechanics
 
9783319319681 c2-3
9783319319681 c2-39783319319681 c2-3
9783319319681 c2-3
 
090RobotTrajectoryGenerationEn.pdf
090RobotTrajectoryGenerationEn.pdf090RobotTrajectoryGenerationEn.pdf
090RobotTrajectoryGenerationEn.pdf
 
Two Link Robotic Manipulator
Two Link Robotic ManipulatorTwo Link Robotic Manipulator
Two Link Robotic Manipulator
 
Optimal straight-line-trajectory-generation-in-3 d-space-using-deviation-algo...
Optimal straight-line-trajectory-generation-in-3 d-space-using-deviation-algo...Optimal straight-line-trajectory-generation-in-3 d-space-using-deviation-algo...
Optimal straight-line-trajectory-generation-in-3 d-space-using-deviation-algo...
 
Lec15
Lec15Lec15
Lec15
 
4852014.pptx
4852014.pptx4852014.pptx
4852014.pptx
 
simuliton of biped walkinng robot using kinematics
simuliton of biped walkinng robot using kinematicssimuliton of biped walkinng robot using kinematics
simuliton of biped walkinng robot using kinematics
 
Jacobian | velocity and static forces
Jacobian | velocity and static forcesJacobian | velocity and static forces
Jacobian | velocity and static forces
 
Mba Ebooks ! Edhole
Mba Ebooks ! EdholeMba Ebooks ! Edhole
Mba Ebooks ! Edhole
 
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
 
Chapter 2 - Robot Kinematics.ppt
Chapter 2 - Robot Kinematics.pptChapter 2 - Robot Kinematics.ppt
Chapter 2 - Robot Kinematics.ppt
 
Lecture 1 trajectory generation
Lecture 1 trajectory generation Lecture 1 trajectory generation
Lecture 1 trajectory generation
 
A Bionic gait programming algorithm for Hexapod Robot
A Bionic gait programming algorithm for Hexapod RobotA Bionic gait programming algorithm for Hexapod Robot
A Bionic gait programming algorithm for Hexapod Robot
 
Amazon.comThe three main activities that e.docx
Amazon.comThe three main activities that e.docxAmazon.comThe three main activities that e.docx
Amazon.comThe three main activities that e.docx
 

Más de Mahmoud Hussein

Más de Mahmoud Hussein (20)

07 modelling.electric.motors
07 modelling.electric.motors07 modelling.electric.motors
07 modelling.electric.motors
 
Dc dc converter
Dc dc converterDc dc converter
Dc dc converter
 
08 pid.controller
08 pid.controller08 pid.controller
08 pid.controller
 
06 control.systems
06 control.systems06 control.systems
06 control.systems
 
05 tuning.pid.controllers
05 tuning.pid.controllers05 tuning.pid.controllers
05 tuning.pid.controllers
 
02 physical.system.modelling mechanical.systems.
02 physical.system.modelling mechanical.systems.02 physical.system.modelling mechanical.systems.
02 physical.system.modelling mechanical.systems.
 
03 dynamic.system.
03 dynamic.system.03 dynamic.system.
03 dynamic.system.
 
Lecture 02 laplace transformation
Lecture 02 laplace transformationLecture 02 laplace transformation
Lecture 02 laplace transformation
 
Mbd2
Mbd2Mbd2
Mbd2
 
Model based design-Hardware in loop-software in loop
Model based design-Hardware in loop-software in loopModel based design-Hardware in loop-software in loop
Model based design-Hardware in loop-software in loop
 
Ac drive basics
Ac drive basicsAc drive basics
Ac drive basics
 
Velocity kinematics
Velocity kinematicsVelocity kinematics
Velocity kinematics
 
MPI Communication
MPI CommunicationMPI Communication
MPI Communication
 
ERROR
ERRORERROR
ERROR
 
Analogue Module
Analogue ModuleAnalogue Module
Analogue Module
 
Function Block & Organization Block
Function Block & Organization BlockFunction Block & Organization Block
Function Block & Organization Block
 
Data Block
Data BlockData Block
Data Block
 
Declaration Table
Declaration TableDeclaration Table
Declaration Table
 
Math operation
Math operationMath operation
Math operation
 
Industrial communication
Industrial communicationIndustrial communication
Industrial communication
 

Último

Employee leave management system project.
Employee leave management system project.Employee leave management system project.
Employee leave management system project.Kamal Acharya
 
Navigating Complexity: The Role of Trusted Partners and VIAS3D in Dassault Sy...
Navigating Complexity: The Role of Trusted Partners and VIAS3D in Dassault Sy...Navigating Complexity: The Role of Trusted Partners and VIAS3D in Dassault Sy...
Navigating Complexity: The Role of Trusted Partners and VIAS3D in Dassault Sy...Arindam Chakraborty, Ph.D., P.E. (CA, TX)
 
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 Bookingdharasingh5698
 
DC MACHINE-Motoring and generation, Armature circuit equation
DC MACHINE-Motoring and generation, Armature circuit equationDC MACHINE-Motoring and generation, Armature circuit equation
DC MACHINE-Motoring and generation, Armature circuit equationBhangaleSonal
 
Call Girls Wakad Call Me 7737669865 Budget Friendly No Advance Booking
Call Girls Wakad Call Me 7737669865 Budget Friendly No Advance BookingCall Girls Wakad Call Me 7737669865 Budget Friendly No Advance Booking
Call Girls Wakad Call Me 7737669865 Budget Friendly No Advance Bookingroncy bisnoi
 
Design For Accessibility: Getting it right from the start
Design For Accessibility: Getting it right from the startDesign For Accessibility: Getting it right from the start
Design For Accessibility: Getting it right from the startQuintin Balsdon
 
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...roncy bisnoi
 
KubeKraft presentation @CloudNativeHooghly
KubeKraft presentation @CloudNativeHooghlyKubeKraft presentation @CloudNativeHooghly
KubeKraft presentation @CloudNativeHooghlysanyuktamishra911
 
COST-EFFETIVE and Energy Efficient BUILDINGS ptx
COST-EFFETIVE  and Energy Efficient BUILDINGS ptxCOST-EFFETIVE  and Energy Efficient BUILDINGS ptx
COST-EFFETIVE and Energy Efficient BUILDINGS ptxJIT KUMAR GUPTA
 
Generative AI or GenAI technology based PPT
Generative AI or GenAI technology based PPTGenerative AI or GenAI technology based PPT
Generative AI or GenAI technology based PPTbhaskargani46
 
chapter 5.pptx: drainage and irrigation engineering
chapter 5.pptx: drainage and irrigation engineeringchapter 5.pptx: drainage and irrigation engineering
chapter 5.pptx: drainage and irrigation engineeringmulugeta48
 
Thermal Engineering -unit - III & IV.ppt
Thermal Engineering -unit - III & IV.pptThermal Engineering -unit - III & IV.ppt
Thermal Engineering -unit - III & IV.pptDineshKumar4165
 
Standard vs Custom Battery Packs - Decoding the Power Play
Standard vs Custom Battery Packs - Decoding the Power PlayStandard vs Custom Battery Packs - Decoding the Power Play
Standard vs Custom Battery Packs - Decoding the Power PlayEpec Engineered Technologies
 
Top Rated Call Girls In chittoor 📱 {7001035870} VIP Escorts chittoor
Top Rated Call Girls In chittoor 📱 {7001035870} VIP Escorts chittoorTop Rated Call Girls In chittoor 📱 {7001035870} VIP Escorts chittoor
Top Rated Call Girls In chittoor 📱 {7001035870} VIP Escorts chittoordharasingh5698
 

Último (20)

Call Girls in Ramesh Nagar Delhi 💯 Call Us 🔝9953056974 🔝 Escort Service
Call Girls in Ramesh Nagar Delhi 💯 Call Us 🔝9953056974 🔝 Escort ServiceCall Girls in Ramesh Nagar Delhi 💯 Call Us 🔝9953056974 🔝 Escort Service
Call Girls in Ramesh Nagar Delhi 💯 Call Us 🔝9953056974 🔝 Escort Service
 
Employee leave management system project.
Employee leave management system project.Employee leave management system project.
Employee leave management system project.
 
Navigating Complexity: The Role of Trusted Partners and VIAS3D in Dassault Sy...
Navigating Complexity: The Role of Trusted Partners and VIAS3D in Dassault Sy...Navigating Complexity: The Role of Trusted Partners and VIAS3D in Dassault Sy...
Navigating Complexity: The Role of Trusted Partners and VIAS3D in Dassault Sy...
 
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
 
DC MACHINE-Motoring and generation, Armature circuit equation
DC MACHINE-Motoring and generation, Armature circuit equationDC MACHINE-Motoring and generation, Armature circuit equation
DC MACHINE-Motoring and generation, Armature circuit equation
 
Call Girls Wakad Call Me 7737669865 Budget Friendly No Advance Booking
Call Girls Wakad Call Me 7737669865 Budget Friendly No Advance BookingCall Girls Wakad Call Me 7737669865 Budget Friendly No Advance Booking
Call Girls Wakad Call Me 7737669865 Budget Friendly No Advance Booking
 
Design For Accessibility: Getting it right from the start
Design For Accessibility: Getting it right from the startDesign For Accessibility: Getting it right from the start
Design For Accessibility: Getting it right from the start
 
Integrated Test Rig For HTFE-25 - Neometrix
Integrated Test Rig For HTFE-25 - NeometrixIntegrated Test Rig For HTFE-25 - Neometrix
Integrated Test Rig For HTFE-25 - Neometrix
 
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...
 
KubeKraft presentation @CloudNativeHooghly
KubeKraft presentation @CloudNativeHooghlyKubeKraft presentation @CloudNativeHooghly
KubeKraft presentation @CloudNativeHooghly
 
Cara Menggugurkan Sperma Yang Masuk Rahim Biyar Tidak Hamil
Cara Menggugurkan Sperma Yang Masuk Rahim Biyar Tidak HamilCara Menggugurkan Sperma Yang Masuk Rahim Biyar Tidak Hamil
Cara Menggugurkan Sperma Yang Masuk Rahim Biyar Tidak Hamil
 
COST-EFFETIVE and Energy Efficient BUILDINGS ptx
COST-EFFETIVE  and Energy Efficient BUILDINGS ptxCOST-EFFETIVE  and Energy Efficient BUILDINGS ptx
COST-EFFETIVE and Energy Efficient BUILDINGS ptx
 
(INDIRA) Call Girl Bhosari Call Now 8617697112 Bhosari Escorts 24x7
(INDIRA) Call Girl Bhosari Call Now 8617697112 Bhosari Escorts 24x7(INDIRA) Call Girl Bhosari Call Now 8617697112 Bhosari Escorts 24x7
(INDIRA) Call Girl Bhosari Call Now 8617697112 Bhosari Escorts 24x7
 
Generative AI or GenAI technology based PPT
Generative AI or GenAI technology based PPTGenerative AI or GenAI technology based PPT
Generative AI or GenAI technology based PPT
 
chapter 5.pptx: drainage and irrigation engineering
chapter 5.pptx: drainage and irrigation engineeringchapter 5.pptx: drainage and irrigation engineering
chapter 5.pptx: drainage and irrigation engineering
 
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...
 
Thermal Engineering -unit - III & IV.ppt
Thermal Engineering -unit - III & IV.pptThermal Engineering -unit - III & IV.ppt
Thermal Engineering -unit - III & IV.ppt
 
Call Girls in Netaji Nagar, Delhi 💯 Call Us 🔝9953056974 🔝 Escort Service
Call Girls in Netaji Nagar, Delhi 💯 Call Us 🔝9953056974 🔝 Escort ServiceCall Girls in Netaji Nagar, Delhi 💯 Call Us 🔝9953056974 🔝 Escort Service
Call Girls in Netaji Nagar, Delhi 💯 Call Us 🔝9953056974 🔝 Escort Service
 
Standard vs Custom Battery Packs - Decoding the Power Play
Standard vs Custom Battery Packs - Decoding the Power PlayStandard vs Custom Battery Packs - Decoding the Power Play
Standard vs Custom Battery Packs - Decoding the Power Play
 
Top Rated Call Girls In chittoor 📱 {7001035870} VIP Escorts chittoor
Top Rated Call Girls In chittoor 📱 {7001035870} VIP Escorts chittoorTop Rated Call Girls In chittoor 📱 {7001035870} VIP Escorts chittoor
Top Rated Call Girls In chittoor 📱 {7001035870} VIP Escorts chittoor
 

Robotics lec 6

  • 1. Robotics lec 6 BY : Mahmoud Hussein
  • 2. The idea of motion  To move a robot smoothly from one pose to another, we need smooth and coordinated motion of all of its joints.  we begin by looking at how to create smooth paths for the robot end effector moving from one pose to another. There are two approaches we will introduce you to. The first is what’s called a joint interpolated trajectory where we take the initial pose and final pose and we use inverse kinematics to determine the initial and final sets of joint values; then, we smoothly interpolate between those two sets.  The second approach is to compute a Cartesian interpolated trajectory and what we do here is interpolate between the initial and final end effector poses. Then, for each interpolated pose, we compute the inverse kinematics to find the joint values that are appropriate at that particular time step.
  • 3. Interpolation of a scalar  We want to make our robot to move from A to B , when the motion start, the end effector of the robot arm is at a position or (pose) A and at the end of the motion , the end effector of the robot arm is at a position or (Pose)B , during the motion the robot's position is changing smoothly and ideally the shortest path.  We’ll start in a simple way and see how this works for a point moving along a number line, and then apply those principles to two common approaches for robotic motion: joint interpolation and Cartesian interpolation.  Consider A and B are two points in real number line and we wish to move smoothly between them. We can construct a function  X(t) = A +(B - A) t
  • 4. Interpolation of a scalar  Such that the time variable t varies from 0 to 1 , that o<= t <=1.you should convince your self that X(0)=A and X(1)=B we call this a trajectory a set of times and points(ti , x(i)) that defines how the point moves as a function of time We can choose to divide the time interval into as many steps, time steps, as we desire. This is commonly known as linear interpolation and does the job very nicely, but has the drawback that the motion is not totally smooth - let’s examine why.  The point is initially not moving, and then at t=0 it starts to move with a velocity of (B - A) since it has to cover the distance from A to B which is (B - A) in 1 second. When it arrives at B it suddenly stops. The sudden changes in velocity at the start and at the end mean massive accelerations– this is not a problem when moving a mathematical point (which has no mass) along a number line but it is a very real problem for the motors of a real robot.
  • 5. Interpolation of a scalar  What we need is a way for our point to smoothly accelerate at the beginning of the motion and then smoothly decelerate at the end. Fortunately the Toolbox has a function that does just this. Consider the problem of moving smoothly from X= - 2 to X = 3 n fifty steps. Using the Toolbox the solution is tpoly(-2,3,50)  If you want to create vector we can do it  X=tpoly(-2,3,50)
  • 6. Joint interpolation in 2 D  we learned how to interpolate a scalar smoothly between two values. Now, we want to do this for the robot’s joint values, which are a vector.  We define qA as a vector of the joint values (angles or lengths) at the robot’s initial position (or pose). For a robot with N oints, this will be a vector of length N .  Similarly , qB s a vector of the joint values (angles or lengths) at the robot’s final position (or pose), and is the same length as qA  Now we want to find a series of vectors that move smoothly between the values qA and qB . Consider that qA=(-0.3 , 0.5) and qB=(0.5 ,0.2)  qA=[-0.3 0.5]  qB=[0.5 0.2]  q=jtraj(qA,qB,50)
  • 7. Cartesian interpolation in 2 D  Now we have made our non-physical robot move as its joint angles followed a trajectory – it moved from A to B. However, as we saw in the last step, close scrutiny shows that between points A and B, the robot’s end effector does not follow a straight line.  For many robot applications, this is not important and joint interpolated motion is adequate and easy to compute. However, there are some applications where following a straight line is important – perhaps the robot is doing a cutting or welding task. The solution we require is called Cartesian interpolation, and involves interpolating points in the 2-dimensional (2D) Cartesian coordinate frame rather than the 2D robot joint space. Consider two points in the 2D Cartesian coordinate frame  qA=[-0.3 0.5]  qB=[0.5 0.2]  q=mjtraj(@tpoly,qA,qB,50)
  • 8. Motion in 3D  Mdl_puma560
  • 10. Motion in 3 D  Figure  qplot(tg)
  • 11. Cartesian interpolation in 3D  Ts=ctraj(TA,TB,50);  Ts(:,:,1)  Ts(:,:,2)  And so on
  • 13. Cartesian interpolation in 3D  Figure  qplot(ts)