SlideShare a Scribd company logo
1 of 28
Download to read offline
Trajectory Planning
Trajectory Planning
 Path and trajectory planning means the way that a
robot is moved from one location to another in a
controlled manner.
 The sequence of movements for a controlled
movement between motion segment, in straight-line
motion or in sequential motions.
 It requires the use of both kinematics and dynamics of
robots.
Trajectory Planning
 Goal: to generate the reference inputs to the
motion control system which ensures that the
manipulator executes the planned trajectory
Motion control
system
RobotTrajectory
planning system
torques
Position, velocity, acceleration
Trajectory Planning
PATH VS. TRAJECTORY
 Path: A sequence of robot configurations in a
particular order without regard to the timing of
these configurations.
 Trajectory: It concerned about when each part of
the path must be attained, thus specifying timing.
Sequential robot movements in a path.
Trajectory planning
algorithm
Path description
path constraints(obstacles)
constraints imposed by
robot dynamics (smooth)
(
Joint (end-effector)
trajectories in terms
of position, velocity
and acceleration
TRAJECTORY PLANNING
TRAJECTORY PLANNING
Method 1
Plan a path in Cartesian Space
Use inverse kinematics for
finding the corresponding path
for the joints in the joint space.
Method 2
Plan a path in Joint Space
Use inverse kinematics for
finding the initial and final joint
position in joint space.
Without
obstacle
Cartesian Space
Techniques
Joint Space
Techniques
TRAJECTORY PLANNING
Method 1 Method 2
Computing the inverse
kinematics in real time,
time consuming and robot
efficiency may be affected.
When a specific end effector
trajectory is required, this
method is useful. E.g. in
the case of arc welding,
the electrode is required
to follow the seam
precisely.
Determine the initial and
final joint positions. The
path for all joints can be
easily planned in real time.
No need for forward and
inverse kinematics
recalculation.
Cartesian space
• We can track a shape
(for orientation : equivalent axes, Euler angles,…
• More expensive at run time
(after the path is calculated need joint angles
in a lot of points)
• Discontinuity problems
Joint space
• Easy to go through via points
(Solve inverse kinematics at all path points and plan)
• No problems with singularities
• Less calculations
• Can not follow straight line
TRAJECTORY PLANNING
Cartesian planning
difficulties :
Initial and Goal
Points are
reachable.
Intermediate points
(C) unreachable.
TRAJECTORY PLANNING
A
B
C
TRAJECTORY PLANNING
WITH POLYNOMIALS
No obstacle
The robot trajectory can be planned using initial
positions, initial velocity , final position and final velocity
of the joints in joint space. The third-order (cubic)
polynomial function is chosen as the position trajectory of
the ith joint:
3
3
2
210)( tatataat iiiii 
3210 ,,, iiii aaaa are constant parameters to be determined.
TRAJECTORY PLANNING
WITH POLYNOMIALS
No obstacle
Differentiate with respect to time t,
2
321 32)( tataat iiii 
we obtained the velocity trajectory of the
ith joint.
TRAJECTORY PLANNING
WITH POLYNOMIALS
No obstacle 2
321 32)( tataat iiii 
Assume that the initial position, final position, initial
velocity and final velocity are known, where the initial
time is t0=0 and final time is tf,
2
321
1
3
3
2
210
0
32)(
)0(
)(
)0(
fifiifi
ii
fififiifi
ii
tataat
a
tatataat
a










TRAJECTORY PLANNING
WITH POLYNOMIALS
No obstacle 2
321 32)( tataat iiii 
33
22
1
0
))()0(())()0((2
))()0(2())0()((3
)0(
)0(
f
ffiifii
i
f
ffiiifi
i
ii
ii
t
ttt
a
t
ttt
a
a
a













Four parameters of the cubic polynomial can be uniquely
determined by the four constraints: the initial position,
final position, initial velocity and final velocity.
Obtain this
equation
TRAJECTORY PLANNING
WITH POLYNOMIALS
No obstacle 2
321 32)( tataat iiii 
3
0
000
3
2
0
0
2
1
0
)(
)))(()(())()((2
)(
)))(()0(2())0()((3
)0(
)0(
tt
tttttt
a
tt
tttttt
a
ta
ta
f
ffiifii
i
f
ffiiifi
i
ii
ii















When t0 is not equal to 0,
TRAJECTORY PLANNING
WITH POLYNOMIALS
No obstacle
Consider a single link robot manipulator with a
rotary joint. Design a cubic trajectory, which starts
from the initial angular position and ends
at the final angular position , with zero
initial velocity and zero final velocity.
10)0(i
 90)2(i
TRAJECTORY PLANNING
WITH POLYNOMIALS
No obstacle
10)0(i  90)2(i
3
3
2
210)( tatataat iiiii 
0)0( i 0)2( i
20
2
)9010(2
60
2
)1090(3
0
10
33
22
1
0








a
a
a
a
32
206010)( ttt 
Final trajectory,
EXERCISE 1
The second joint of SCARA manipulator is required
to move from ϴ2 = 30° to 150° in 5 seconds. Find
the cubic polynomial to generate the smooth
trajectory for the joint. Assume that the initial and
final velocity of the joint is zero.
POLYNOMIALS TRAJECTORIES WITH
VIA POINTS
With obstacle
Some via points must be specified in order to avoid collisions.
A
B
CP(0)
P(tf)
POLYNOMIALS TRAJECTORIES WITH
VIA POINTS
With obstacle
Two methods fro trajectory planning with via point in space:
1. Use single high-order polynomial. The order of
polynomial depends on the number of the constraints.
2. With m via points, the whole trajectory could be divided
into m+1 segments, and each segment can be modeled
by using cubic polynomials.
POLYNOMIALS TRAJECTORIES WITH
VIA POINTSWith obstacle
Consider a single-link robot manipulator with a
rotary joint. Design a single polynomial
trajectory, which starts from the initial angular
position ϴ(0)=10°, passes the via point ϴ(1)=5°,
and then stops at the final angular position
ϴ(2)=50°, with zero initial velocity and zero final
velocity.
POLYNOMIALS TRAJECTORIES WITH
VIA POINTSWith obstacle
The initial angular position ,
initial velocity ,
passes the via point ,
the final angular position ,
final velocity .
0)0( 
10)0(
 5)1(
 50)2(
0)2( 
POLYNOMIALS TRAJECTORIES WITH
VIA POINTSWith obstacle
The order of polynomial depends on the number of
constraint. We have 5 constraints, fourth order polynomial
with five parameters as the candidate of the trajectory
function:
4
4
3
3
2
210)( tatatataat 
3
4
2
321 432)( tatataat 
2
432 1262)( tataat 
Velocity,
Acceleration,
POLYNOMIALS TRAJECTORIES WITH
VIA POINTSWith obstacle
100 a
543210  aaaaa
032124 4321  aaaa
5016842 43210  aaaaa
01 a
Using the five constraints, the following equation were
obtained,
25,90,70,0,10 43210  aaaaaThen,
POLYNOMIALS TRAJECTORIES WITH
VIA POINTSWith obstacle
Fourth order polynomial trajectory is formed,
25,90,70,0,10 43210  aaaaaThen,
432
25907010)( tttt 
32
100270140)( tttt 
2
300540140)( ttt 
Velocity,
Acceleration,
TRAJECTORY PLANNING
Previously, the velocity increase until peak and then
reduce until zero when the robot arm move
towards the final position.
There are cases where the robot arm are required
to move at a constant velocity. In that case, the
trajectory should be divided into three segments
i.e. acceleration segment, constant velocity
segment and deceleration segment.
POLYNOMIALS TRAJECTORIES WITH
VIA POINTSWith obstacle
Consider a single-link robot manipulator with a
rotary joint. Design a trajectory with following
cubic segments: the 1st segment connects initial
angular position ϴ(0)=10° to the via point
ϴ(1)=5°, and 2nd segment that connects via
point ϴ(1)=5° to the final angular position
ϴ(2)=50°. Assume that initial velocity and final
velocity are zero. At via point, the trajectory
should have continuous velocity and
acceleration
Quiz - 1
Consider a single-link robot manipulator with a
rotary joint. Design a trajectory with following cubic
segments: the 1st segment connects initial angular
position ϴ(0)=5° to the via point ϴ(5)=10°, and 2nd
segment connects via point ϴ(5)=10° to the final
angular position ϴ(20)=100°. Assume that initial
velocity and final velocity are zero. At via point, the
trajectory should have continuous velocity and
acceleration
TRAJECTORY PLANNING
Two parabolics model to define acceleration and
decelaration, one linear model to define
constant velocity segment, it is called Linear
Segment With Two Parabolic Blend (LPSB).

More Related Content

What's hot (20)

Robot programming
Robot programmingRobot programming
Robot programming
 
Robotics - unit-2 - end effector
Robotics - unit-2 - end effectorRobotics - unit-2 - end effector
Robotics - unit-2 - end effector
 
Chapter 8 - Robot Control System
Chapter 8 - Robot Control SystemChapter 8 - Robot Control System
Chapter 8 - Robot Control System
 
ROBOTICS-ROBOT KINEMATICS AND ROBOT PROGRAMMING
ROBOTICS-ROBOT KINEMATICS AND ROBOT PROGRAMMINGROBOTICS-ROBOT KINEMATICS AND ROBOT PROGRAMMING
ROBOTICS-ROBOT KINEMATICS AND ROBOT PROGRAMMING
 
Introduction to robotics
Introduction to roboticsIntroduction to robotics
Introduction to robotics
 
Robotics: Forward and Inverse Kinematics
Robotics: Forward and Inverse KinematicsRobotics: Forward and Inverse Kinematics
Robotics: Forward and Inverse Kinematics
 
Robo unit4- Robot Programming.pptx
Robo unit4- Robot Programming.pptxRobo unit4- Robot Programming.pptx
Robo unit4- Robot Programming.pptx
 
Robot control
Robot controlRobot control
Robot control
 
Robot work cell layout
Robot work cell layoutRobot work cell layout
Robot work cell layout
 
Robot Configuration - 2
Robot Configuration - 2Robot Configuration - 2
Robot Configuration - 2
 
Hydraulic and Pneumatic Drive System
Hydraulic and Pneumatic Drive SystemHydraulic and Pneumatic Drive System
Hydraulic and Pneumatic Drive System
 
Robots
Robots Robots
Robots
 
End effectors
End effectorsEnd effectors
End effectors
 
Dek3223 chapter 3 industrial robotic
Dek3223 chapter 3 industrial roboticDek3223 chapter 3 industrial robotic
Dek3223 chapter 3 industrial robotic
 
Industrial robotics
Industrial roboticsIndustrial robotics
Industrial robotics
 
Robot vision
Robot visionRobot vision
Robot vision
 
Robot manipulator
Robot manipulatorRobot manipulator
Robot manipulator
 
Robotics: Introduction to Kinematics
Robotics: Introduction to KinematicsRobotics: Introduction to Kinematics
Robotics: Introduction to Kinematics
 
Robotics End Effector
Robotics End EffectorRobotics End Effector
Robotics End Effector
 
Actuators
ActuatorsActuators
Actuators
 

Similar to Trajectory

090RobotTrajectoryGenerationEn.pdf
090RobotTrajectoryGenerationEn.pdf090RobotTrajectoryGenerationEn.pdf
090RobotTrajectoryGenerationEn.pdfsivapathuri
 
Kinematic models and constraints.ppt
Kinematic models and constraints.pptKinematic models and constraints.ppt
Kinematic models and constraints.pptssuser8698eb
 
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
 
Trajectory Planning Through Polynomial Equation
Trajectory Planning Through Polynomial EquationTrajectory Planning Through Polynomial Equation
Trajectory Planning Through Polynomial Equationgummaavinash7
 
Lecture 1 trajectory generation
Lecture 1 trajectory generation Lecture 1 trajectory generation
Lecture 1 trajectory generation cairo university
 
Robot2L_IEEE00493506
Robot2L_IEEE00493506Robot2L_IEEE00493506
Robot2L_IEEE00493506Chih-Wu Jen
 
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
 
Presentation for the 19th EUROSTAR Users Conference June 2011
Presentation for the 19th EUROSTAR Users Conference June 2011Presentation for the 19th EUROSTAR Users Conference June 2011
Presentation for the 19th EUROSTAR Users Conference June 2011Antonios Arkas
 
WIMS2_Rui_Hou_2
WIMS2_Rui_Hou_2WIMS2_Rui_Hou_2
WIMS2_Rui_Hou_2RUI Hou
 
Design of recumbent elliptical trainer
Design of  recumbent elliptical trainerDesign of  recumbent elliptical trainer
Design of recumbent elliptical trainerdaveson700
 
lec 2 Robotics time & motion
lec 2 Robotics time & motionlec 2 Robotics time & motion
lec 2 Robotics time & motioncairo university
 
Business Proposal Presentation in Purple Monochrome Corporate Style.pptx
Business Proposal Presentation in Purple Monochrome Corporate Style.pptxBusiness Proposal Presentation in Purple Monochrome Corporate Style.pptx
Business Proposal Presentation in Purple Monochrome Corporate Style.pptxJOHN35307
 
BallCatchingRobot
BallCatchingRobotBallCatchingRobot
BallCatchingRobotgauravbrd
 
Stairs Detection Algorithm for Tri-Star Wheeled Robot and Experimental Valida...
Stairs Detection Algorithm for Tri-Star Wheeled Robot and Experimental Valida...Stairs Detection Algorithm for Tri-Star Wheeled Robot and Experimental Valida...
Stairs Detection Algorithm for Tri-Star Wheeled Robot and Experimental Valida...Premier Publishers
 
Unit 4 mm9400 ver1.1 (2014)
Unit 4 mm9400 ver1.1 (2014)Unit 4 mm9400 ver1.1 (2014)
Unit 4 mm9400 ver1.1 (2014)all_engineering
 
A NOVEL NAVIGATION STRATEGY FOR AN UNICYCLE MOBILE ROBOT INSPIRED FROM THE DU...
A NOVEL NAVIGATION STRATEGY FOR AN UNICYCLE MOBILE ROBOT INSPIRED FROM THE DU...A NOVEL NAVIGATION STRATEGY FOR AN UNICYCLE MOBILE ROBOT INSPIRED FROM THE DU...
A NOVEL NAVIGATION STRATEGY FOR AN UNICYCLE MOBILE ROBOT INSPIRED FROM THE DU...JaresJournal
 
Design and Analysis of Articulated Inspection Arm of Robot
Design and Analysis of Articulated Inspection Arm of RobotDesign and Analysis of Articulated Inspection Arm of Robot
Design and Analysis of Articulated Inspection Arm of RobotIJTET Journal
 
Troubleshooting and Enhancement of Inverted Pendulum System Controlled by DSP...
Troubleshooting and Enhancement of Inverted Pendulum System Controlled by DSP...Troubleshooting and Enhancement of Inverted Pendulum System Controlled by DSP...
Troubleshooting and Enhancement of Inverted Pendulum System Controlled by DSP...Thomas Templin
 

Similar to Trajectory (20)

090RobotTrajectoryGenerationEn.pdf
090RobotTrajectoryGenerationEn.pdf090RobotTrajectoryGenerationEn.pdf
090RobotTrajectoryGenerationEn.pdf
 
Chapter 7_0.pptx
Chapter 7_0.pptxChapter 7_0.pptx
Chapter 7_0.pptx
 
Kinematic models and constraints.ppt
Kinematic models and constraints.pptKinematic models and constraints.ppt
Kinematic models and constraints.ppt
 
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
 
Trajectory Planning Through Polynomial Equation
Trajectory Planning Through Polynomial EquationTrajectory Planning Through Polynomial Equation
Trajectory Planning Through Polynomial Equation
 
Lecture 1 trajectory generation
Lecture 1 trajectory generation Lecture 1 trajectory generation
Lecture 1 trajectory generation
 
Robot2L_IEEE00493506
Robot2L_IEEE00493506Robot2L_IEEE00493506
Robot2L_IEEE00493506
 
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...
 
Presentation for the 19th EUROSTAR Users Conference June 2011
Presentation for the 19th EUROSTAR Users Conference June 2011Presentation for the 19th EUROSTAR Users Conference June 2011
Presentation for the 19th EUROSTAR Users Conference June 2011
 
WIMS2_Rui_Hou_2
WIMS2_Rui_Hou_2WIMS2_Rui_Hou_2
WIMS2_Rui_Hou_2
 
Design of recumbent elliptical trainer
Design of  recumbent elliptical trainerDesign of  recumbent elliptical trainer
Design of recumbent elliptical trainer
 
lec 2 Robotics time & motion
lec 2 Robotics time & motionlec 2 Robotics time & motion
lec 2 Robotics time & motion
 
Business Proposal Presentation in Purple Monochrome Corporate Style.pptx
Business Proposal Presentation in Purple Monochrome Corporate Style.pptxBusiness Proposal Presentation in Purple Monochrome Corporate Style.pptx
Business Proposal Presentation in Purple Monochrome Corporate Style.pptx
 
BallCatchingRobot
BallCatchingRobotBallCatchingRobot
BallCatchingRobot
 
Stairs Detection Algorithm for Tri-Star Wheeled Robot and Experimental Valida...
Stairs Detection Algorithm for Tri-Star Wheeled Robot and Experimental Valida...Stairs Detection Algorithm for Tri-Star Wheeled Robot and Experimental Valida...
Stairs Detection Algorithm for Tri-Star Wheeled Robot and Experimental Valida...
 
Unit 4 mm9400 ver1.1 (2014)
Unit 4 mm9400 ver1.1 (2014)Unit 4 mm9400 ver1.1 (2014)
Unit 4 mm9400 ver1.1 (2014)
 
S5 S6.pdf
S5 S6.pdfS5 S6.pdf
S5 S6.pdf
 
A NOVEL NAVIGATION STRATEGY FOR AN UNICYCLE MOBILE ROBOT INSPIRED FROM THE DU...
A NOVEL NAVIGATION STRATEGY FOR AN UNICYCLE MOBILE ROBOT INSPIRED FROM THE DU...A NOVEL NAVIGATION STRATEGY FOR AN UNICYCLE MOBILE ROBOT INSPIRED FROM THE DU...
A NOVEL NAVIGATION STRATEGY FOR AN UNICYCLE MOBILE ROBOT INSPIRED FROM THE DU...
 
Design and Analysis of Articulated Inspection Arm of Robot
Design and Analysis of Articulated Inspection Arm of RobotDesign and Analysis of Articulated Inspection Arm of Robot
Design and Analysis of Articulated Inspection Arm of Robot
 
Troubleshooting and Enhancement of Inverted Pendulum System Controlled by DSP...
Troubleshooting and Enhancement of Inverted Pendulum System Controlled by DSP...Troubleshooting and Enhancement of Inverted Pendulum System Controlled by DSP...
Troubleshooting and Enhancement of Inverted Pendulum System Controlled by DSP...
 

Recently uploaded

Extrusion Processes and Their Limitations
Extrusion Processes and Their LimitationsExtrusion Processes and Their Limitations
Extrusion Processes and Their Limitations120cr0395
 
Call Girls Service Nagpur Tanvi Call 7001035870 Meet With Nagpur Escorts
Call Girls Service Nagpur Tanvi Call 7001035870 Meet With Nagpur EscortsCall Girls Service Nagpur Tanvi Call 7001035870 Meet With Nagpur Escorts
Call Girls Service Nagpur Tanvi Call 7001035870 Meet With Nagpur EscortsCall Girls in Nagpur High Profile
 
College Call Girls Nashik Nehal 7001305949 Independent Escort Service Nashik
College Call Girls Nashik Nehal 7001305949 Independent Escort Service NashikCollege Call Girls Nashik Nehal 7001305949 Independent Escort Service Nashik
College Call Girls Nashik Nehal 7001305949 Independent Escort Service NashikCall Girls in Nagpur High Profile
 
(PRIYA) Rajgurunagar Call Girls Just Call 7001035870 [ Cash on Delivery ] Pun...
(PRIYA) Rajgurunagar Call Girls Just Call 7001035870 [ Cash on Delivery ] Pun...(PRIYA) Rajgurunagar Call Girls Just Call 7001035870 [ Cash on Delivery ] Pun...
(PRIYA) Rajgurunagar Call Girls Just Call 7001035870 [ Cash on Delivery ] Pun...ranjana rawat
 
Microscopic Analysis of Ceramic Materials.pptx
Microscopic Analysis of Ceramic Materials.pptxMicroscopic Analysis of Ceramic Materials.pptx
Microscopic Analysis of Ceramic Materials.pptxpurnimasatapathy1234
 
SPICE PARK APR2024 ( 6,793 SPICE Models )
SPICE PARK APR2024 ( 6,793 SPICE Models )SPICE PARK APR2024 ( 6,793 SPICE Models )
SPICE PARK APR2024 ( 6,793 SPICE Models )Tsuyoshi Horigome
 
Sheet Pile Wall Design and Construction: A Practical Guide for Civil Engineer...
Sheet Pile Wall Design and Construction: A Practical Guide for Civil Engineer...Sheet Pile Wall Design and Construction: A Practical Guide for Civil Engineer...
Sheet Pile Wall Design and Construction: A Practical Guide for Civil Engineer...Dr.Costas Sachpazis
 
High Profile Call Girls Nagpur Isha Call 7001035870 Meet With Nagpur Escorts
High Profile Call Girls Nagpur Isha Call 7001035870 Meet With Nagpur EscortsHigh Profile Call Girls Nagpur Isha Call 7001035870 Meet With Nagpur Escorts
High Profile Call Girls Nagpur Isha Call 7001035870 Meet With Nagpur Escortsranjana rawat
 
What are the advantages and disadvantages of membrane structures.pptx
What are the advantages and disadvantages of membrane structures.pptxWhat are the advantages and disadvantages of membrane structures.pptx
What are the advantages and disadvantages of membrane structures.pptxwendy cai
 
Model Call Girl in Narela Delhi reach out to us at 🔝8264348440🔝
Model Call Girl in Narela Delhi reach out to us at 🔝8264348440🔝Model Call Girl in Narela Delhi reach out to us at 🔝8264348440🔝
Model Call Girl in Narela Delhi reach out to us at 🔝8264348440🔝soniya singh
 
High Profile Call Girls Nagpur Meera Call 7001035870 Meet With Nagpur Escorts
High Profile Call Girls Nagpur Meera Call 7001035870 Meet With Nagpur EscortsHigh Profile Call Girls Nagpur Meera Call 7001035870 Meet With Nagpur Escorts
High Profile Call Girls Nagpur Meera Call 7001035870 Meet With Nagpur EscortsCall Girls in Nagpur High Profile
 
OSVC_Meta-Data based Simulation Automation to overcome Verification Challenge...
OSVC_Meta-Data based Simulation Automation to overcome Verification Challenge...OSVC_Meta-Data based Simulation Automation to overcome Verification Challenge...
OSVC_Meta-Data based Simulation Automation to overcome Verification Challenge...Soham Mondal
 
(RIA) Call Girls Bhosari ( 7001035870 ) HI-Fi Pune Escorts Service
(RIA) Call Girls Bhosari ( 7001035870 ) HI-Fi Pune Escorts Service(RIA) Call Girls Bhosari ( 7001035870 ) HI-Fi Pune Escorts Service
(RIA) Call Girls Bhosari ( 7001035870 ) HI-Fi Pune Escorts Serviceranjana rawat
 
Introduction and different types of Ethernet.pptx
Introduction and different types of Ethernet.pptxIntroduction and different types of Ethernet.pptx
Introduction and different types of Ethernet.pptxupamatechverse
 
Coefficient of Thermal Expansion and their Importance.pptx
Coefficient of Thermal Expansion and their Importance.pptxCoefficient of Thermal Expansion and their Importance.pptx
Coefficient of Thermal Expansion and their Importance.pptxAsutosh Ranjan
 
Decoding Kotlin - Your guide to solving the mysterious in Kotlin.pptx
Decoding Kotlin - Your guide to solving the mysterious in Kotlin.pptxDecoding Kotlin - Your guide to solving the mysterious in Kotlin.pptx
Decoding Kotlin - Your guide to solving the mysterious in Kotlin.pptxJoão Esperancinha
 
Gfe Mayur Vihar Call Girls Service WhatsApp -> 9999965857 Available 24x7 ^ De...
Gfe Mayur Vihar Call Girls Service WhatsApp -> 9999965857 Available 24x7 ^ De...Gfe Mayur Vihar Call Girls Service WhatsApp -> 9999965857 Available 24x7 ^ De...
Gfe Mayur Vihar Call Girls Service WhatsApp -> 9999965857 Available 24x7 ^ De...srsj9000
 
GDSC ASEB Gen AI study jams presentation
GDSC ASEB Gen AI study jams presentationGDSC ASEB Gen AI study jams presentation
GDSC ASEB Gen AI study jams presentationGDSCAESB
 
The Most Attractive Pune Call Girls Budhwar Peth 8250192130 Will You Miss Thi...
The Most Attractive Pune Call Girls Budhwar Peth 8250192130 Will You Miss Thi...The Most Attractive Pune Call Girls Budhwar Peth 8250192130 Will You Miss Thi...
The Most Attractive Pune Call Girls Budhwar Peth 8250192130 Will You Miss Thi...ranjana rawat
 

Recently uploaded (20)

Extrusion Processes and Their Limitations
Extrusion Processes and Their LimitationsExtrusion Processes and Their Limitations
Extrusion Processes and Their Limitations
 
Call Girls Service Nagpur Tanvi Call 7001035870 Meet With Nagpur Escorts
Call Girls Service Nagpur Tanvi Call 7001035870 Meet With Nagpur EscortsCall Girls Service Nagpur Tanvi Call 7001035870 Meet With Nagpur Escorts
Call Girls Service Nagpur Tanvi Call 7001035870 Meet With Nagpur Escorts
 
College Call Girls Nashik Nehal 7001305949 Independent Escort Service Nashik
College Call Girls Nashik Nehal 7001305949 Independent Escort Service NashikCollege Call Girls Nashik Nehal 7001305949 Independent Escort Service Nashik
College Call Girls Nashik Nehal 7001305949 Independent Escort Service Nashik
 
(PRIYA) Rajgurunagar Call Girls Just Call 7001035870 [ Cash on Delivery ] Pun...
(PRIYA) Rajgurunagar Call Girls Just Call 7001035870 [ Cash on Delivery ] Pun...(PRIYA) Rajgurunagar Call Girls Just Call 7001035870 [ Cash on Delivery ] Pun...
(PRIYA) Rajgurunagar Call Girls Just Call 7001035870 [ Cash on Delivery ] Pun...
 
★ CALL US 9953330565 ( HOT Young Call Girls In Badarpur delhi NCR
★ CALL US 9953330565 ( HOT Young Call Girls In Badarpur delhi NCR★ CALL US 9953330565 ( HOT Young Call Girls In Badarpur delhi NCR
★ CALL US 9953330565 ( HOT Young Call Girls In Badarpur delhi NCR
 
Microscopic Analysis of Ceramic Materials.pptx
Microscopic Analysis of Ceramic Materials.pptxMicroscopic Analysis of Ceramic Materials.pptx
Microscopic Analysis of Ceramic Materials.pptx
 
SPICE PARK APR2024 ( 6,793 SPICE Models )
SPICE PARK APR2024 ( 6,793 SPICE Models )SPICE PARK APR2024 ( 6,793 SPICE Models )
SPICE PARK APR2024 ( 6,793 SPICE Models )
 
Sheet Pile Wall Design and Construction: A Practical Guide for Civil Engineer...
Sheet Pile Wall Design and Construction: A Practical Guide for Civil Engineer...Sheet Pile Wall Design and Construction: A Practical Guide for Civil Engineer...
Sheet Pile Wall Design and Construction: A Practical Guide for Civil Engineer...
 
High Profile Call Girls Nagpur Isha Call 7001035870 Meet With Nagpur Escorts
High Profile Call Girls Nagpur Isha Call 7001035870 Meet With Nagpur EscortsHigh Profile Call Girls Nagpur Isha Call 7001035870 Meet With Nagpur Escorts
High Profile Call Girls Nagpur Isha Call 7001035870 Meet With Nagpur Escorts
 
What are the advantages and disadvantages of membrane structures.pptx
What are the advantages and disadvantages of membrane structures.pptxWhat are the advantages and disadvantages of membrane structures.pptx
What are the advantages and disadvantages of membrane structures.pptx
 
Model Call Girl in Narela Delhi reach out to us at 🔝8264348440🔝
Model Call Girl in Narela Delhi reach out to us at 🔝8264348440🔝Model Call Girl in Narela Delhi reach out to us at 🔝8264348440🔝
Model Call Girl in Narela Delhi reach out to us at 🔝8264348440🔝
 
High Profile Call Girls Nagpur Meera Call 7001035870 Meet With Nagpur Escorts
High Profile Call Girls Nagpur Meera Call 7001035870 Meet With Nagpur EscortsHigh Profile Call Girls Nagpur Meera Call 7001035870 Meet With Nagpur Escorts
High Profile Call Girls Nagpur Meera Call 7001035870 Meet With Nagpur Escorts
 
OSVC_Meta-Data based Simulation Automation to overcome Verification Challenge...
OSVC_Meta-Data based Simulation Automation to overcome Verification Challenge...OSVC_Meta-Data based Simulation Automation to overcome Verification Challenge...
OSVC_Meta-Data based Simulation Automation to overcome Verification Challenge...
 
(RIA) Call Girls Bhosari ( 7001035870 ) HI-Fi Pune Escorts Service
(RIA) Call Girls Bhosari ( 7001035870 ) HI-Fi Pune Escorts Service(RIA) Call Girls Bhosari ( 7001035870 ) HI-Fi Pune Escorts Service
(RIA) Call Girls Bhosari ( 7001035870 ) HI-Fi Pune Escorts Service
 
Introduction and different types of Ethernet.pptx
Introduction and different types of Ethernet.pptxIntroduction and different types of Ethernet.pptx
Introduction and different types of Ethernet.pptx
 
Coefficient of Thermal Expansion and their Importance.pptx
Coefficient of Thermal Expansion and their Importance.pptxCoefficient of Thermal Expansion and their Importance.pptx
Coefficient of Thermal Expansion and their Importance.pptx
 
Decoding Kotlin - Your guide to solving the mysterious in Kotlin.pptx
Decoding Kotlin - Your guide to solving the mysterious in Kotlin.pptxDecoding Kotlin - Your guide to solving the mysterious in Kotlin.pptx
Decoding Kotlin - Your guide to solving the mysterious in Kotlin.pptx
 
Gfe Mayur Vihar Call Girls Service WhatsApp -> 9999965857 Available 24x7 ^ De...
Gfe Mayur Vihar Call Girls Service WhatsApp -> 9999965857 Available 24x7 ^ De...Gfe Mayur Vihar Call Girls Service WhatsApp -> 9999965857 Available 24x7 ^ De...
Gfe Mayur Vihar Call Girls Service WhatsApp -> 9999965857 Available 24x7 ^ De...
 
GDSC ASEB Gen AI study jams presentation
GDSC ASEB Gen AI study jams presentationGDSC ASEB Gen AI study jams presentation
GDSC ASEB Gen AI study jams presentation
 
The Most Attractive Pune Call Girls Budhwar Peth 8250192130 Will You Miss Thi...
The Most Attractive Pune Call Girls Budhwar Peth 8250192130 Will You Miss Thi...The Most Attractive Pune Call Girls Budhwar Peth 8250192130 Will You Miss Thi...
The Most Attractive Pune Call Girls Budhwar Peth 8250192130 Will You Miss Thi...
 

Trajectory

  • 2. Trajectory Planning  Path and trajectory planning means the way that a robot is moved from one location to another in a controlled manner.  The sequence of movements for a controlled movement between motion segment, in straight-line motion or in sequential motions.  It requires the use of both kinematics and dynamics of robots.
  • 3. Trajectory Planning  Goal: to generate the reference inputs to the motion control system which ensures that the manipulator executes the planned trajectory Motion control system RobotTrajectory planning system torques Position, velocity, acceleration
  • 4. Trajectory Planning PATH VS. TRAJECTORY  Path: A sequence of robot configurations in a particular order without regard to the timing of these configurations.  Trajectory: It concerned about when each part of the path must be attained, thus specifying timing. Sequential robot movements in a path.
  • 5. Trajectory planning algorithm Path description path constraints(obstacles) constraints imposed by robot dynamics (smooth) ( Joint (end-effector) trajectories in terms of position, velocity and acceleration TRAJECTORY PLANNING
  • 6. TRAJECTORY PLANNING Method 1 Plan a path in Cartesian Space Use inverse kinematics for finding the corresponding path for the joints in the joint space. Method 2 Plan a path in Joint Space Use inverse kinematics for finding the initial and final joint position in joint space. Without obstacle Cartesian Space Techniques Joint Space Techniques
  • 7. TRAJECTORY PLANNING Method 1 Method 2 Computing the inverse kinematics in real time, time consuming and robot efficiency may be affected. When a specific end effector trajectory is required, this method is useful. E.g. in the case of arc welding, the electrode is required to follow the seam precisely. Determine the initial and final joint positions. The path for all joints can be easily planned in real time. No need for forward and inverse kinematics recalculation.
  • 8. Cartesian space • We can track a shape (for orientation : equivalent axes, Euler angles,… • More expensive at run time (after the path is calculated need joint angles in a lot of points) • Discontinuity problems Joint space • Easy to go through via points (Solve inverse kinematics at all path points and plan) • No problems with singularities • Less calculations • Can not follow straight line TRAJECTORY PLANNING
  • 9. Cartesian planning difficulties : Initial and Goal Points are reachable. Intermediate points (C) unreachable. TRAJECTORY PLANNING A B C
  • 10. TRAJECTORY PLANNING WITH POLYNOMIALS No obstacle The robot trajectory can be planned using initial positions, initial velocity , final position and final velocity of the joints in joint space. The third-order (cubic) polynomial function is chosen as the position trajectory of the ith joint: 3 3 2 210)( tatataat iiiii  3210 ,,, iiii aaaa are constant parameters to be determined.
  • 11. TRAJECTORY PLANNING WITH POLYNOMIALS No obstacle Differentiate with respect to time t, 2 321 32)( tataat iiii  we obtained the velocity trajectory of the ith joint.
  • 12. TRAJECTORY PLANNING WITH POLYNOMIALS No obstacle 2 321 32)( tataat iiii  Assume that the initial position, final position, initial velocity and final velocity are known, where the initial time is t0=0 and final time is tf, 2 321 1 3 3 2 210 0 32)( )0( )( )0( fifiifi ii fififiifi ii tataat a tatataat a          
  • 13. TRAJECTORY PLANNING WITH POLYNOMIALS No obstacle 2 321 32)( tataat iiii  33 22 1 0 ))()0(())()0((2 ))()0(2())0()((3 )0( )0( f ffiifii i f ffiiifi i ii ii t ttt a t ttt a a a              Four parameters of the cubic polynomial can be uniquely determined by the four constraints: the initial position, final position, initial velocity and final velocity. Obtain this equation
  • 14. TRAJECTORY PLANNING WITH POLYNOMIALS No obstacle 2 321 32)( tataat iiii  3 0 000 3 2 0 0 2 1 0 )( )))(()(())()((2 )( )))(()0(2())0()((3 )0( )0( tt tttttt a tt tttttt a ta ta f ffiifii i f ffiiifi i ii ii                When t0 is not equal to 0,
  • 15. TRAJECTORY PLANNING WITH POLYNOMIALS No obstacle Consider a single link robot manipulator with a rotary joint. Design a cubic trajectory, which starts from the initial angular position and ends at the final angular position , with zero initial velocity and zero final velocity. 10)0(i  90)2(i
  • 16. TRAJECTORY PLANNING WITH POLYNOMIALS No obstacle 10)0(i  90)2(i 3 3 2 210)( tatataat iiiii  0)0( i 0)2( i 20 2 )9010(2 60 2 )1090(3 0 10 33 22 1 0         a a a a 32 206010)( ttt  Final trajectory,
  • 17. EXERCISE 1 The second joint of SCARA manipulator is required to move from ϴ2 = 30° to 150° in 5 seconds. Find the cubic polynomial to generate the smooth trajectory for the joint. Assume that the initial and final velocity of the joint is zero.
  • 18. POLYNOMIALS TRAJECTORIES WITH VIA POINTS With obstacle Some via points must be specified in order to avoid collisions. A B CP(0) P(tf)
  • 19. POLYNOMIALS TRAJECTORIES WITH VIA POINTS With obstacle Two methods fro trajectory planning with via point in space: 1. Use single high-order polynomial. The order of polynomial depends on the number of the constraints. 2. With m via points, the whole trajectory could be divided into m+1 segments, and each segment can be modeled by using cubic polynomials.
  • 20. POLYNOMIALS TRAJECTORIES WITH VIA POINTSWith obstacle Consider a single-link robot manipulator with a rotary joint. Design a single polynomial trajectory, which starts from the initial angular position ϴ(0)=10°, passes the via point ϴ(1)=5°, and then stops at the final angular position ϴ(2)=50°, with zero initial velocity and zero final velocity.
  • 21. POLYNOMIALS TRAJECTORIES WITH VIA POINTSWith obstacle The initial angular position , initial velocity , passes the via point , the final angular position , final velocity . 0)0(  10)0(  5)1(  50)2( 0)2( 
  • 22. POLYNOMIALS TRAJECTORIES WITH VIA POINTSWith obstacle The order of polynomial depends on the number of constraint. We have 5 constraints, fourth order polynomial with five parameters as the candidate of the trajectory function: 4 4 3 3 2 210)( tatatataat  3 4 2 321 432)( tatataat  2 432 1262)( tataat  Velocity, Acceleration,
  • 23. POLYNOMIALS TRAJECTORIES WITH VIA POINTSWith obstacle 100 a 543210  aaaaa 032124 4321  aaaa 5016842 43210  aaaaa 01 a Using the five constraints, the following equation were obtained, 25,90,70,0,10 43210  aaaaaThen,
  • 24. POLYNOMIALS TRAJECTORIES WITH VIA POINTSWith obstacle Fourth order polynomial trajectory is formed, 25,90,70,0,10 43210  aaaaaThen, 432 25907010)( tttt  32 100270140)( tttt  2 300540140)( ttt  Velocity, Acceleration,
  • 25. TRAJECTORY PLANNING Previously, the velocity increase until peak and then reduce until zero when the robot arm move towards the final position. There are cases where the robot arm are required to move at a constant velocity. In that case, the trajectory should be divided into three segments i.e. acceleration segment, constant velocity segment and deceleration segment.
  • 26. POLYNOMIALS TRAJECTORIES WITH VIA POINTSWith obstacle Consider a single-link robot manipulator with a rotary joint. Design a trajectory with following cubic segments: the 1st segment connects initial angular position ϴ(0)=10° to the via point ϴ(1)=5°, and 2nd segment that connects via point ϴ(1)=5° to the final angular position ϴ(2)=50°. Assume that initial velocity and final velocity are zero. At via point, the trajectory should have continuous velocity and acceleration
  • 27. Quiz - 1 Consider a single-link robot manipulator with a rotary joint. Design a trajectory with following cubic segments: the 1st segment connects initial angular position ϴ(0)=5° to the via point ϴ(5)=10°, and 2nd segment connects via point ϴ(5)=10° to the final angular position ϴ(20)=100°. Assume that initial velocity and final velocity are zero. At via point, the trajectory should have continuous velocity and acceleration
  • 28. TRAJECTORY PLANNING Two parabolics model to define acceleration and decelaration, one linear model to define constant velocity segment, it is called Linear Segment With Two Parabolic Blend (LPSB).