SlideShare a Scribd company logo
1 of 32
Introduction
To Robotics
Robot Function
• Generate specific motion of joints
• Integrate tooling and sensors
Robot Processes
• Path following
• Repetitive configuration moves
• Telerobotics
• Target moves versus taught moves
Key Terms (cont...)
• TCF - Tool or terminal control frame
• TCP - Tool /terminal control point
• Joint limits - Either the software or physical hardware limits which constrain
the operating range of a joint on a robot. The software limits have a smaller
range
than the hardware limits.
• Joint speed limits - Speed limit for robot joints, which limit how fast the links
of a robot may translate or rotate.
• Point-to-point motion - Characterized by starting and stopping between
configurations or as the tool is moved between targets.
Key Terms (cont..)
• Continuous path motion - Characterized by blending of motion between
configurations or targets, usually with the loss of path accuracy at the target
transitions, as the robot moves between configurations/targets.
• Interpolation (kinematic) capabilities - Robot usually capable of both
forward and inverse kinematics. Both combine to give the robot the capability to
move in joint space and in Cartesian space. We typically refer to the
moves as joint, linear, or circular interpolation.
• Forward kinematics - Specifying the joint values to accomplish a robot
move to a new configuration in space. These may not be simple as it seems
because secondary joints such as four-bar linkages, ball screws, etc. may be
required to accomplish this motion.
Key Terms (cont..)
• Inverse kinematics - Solving a mathematical model of the robot kinematics
to determine the necessary joint values to move the tool to a desired target
(frame) in space. This is accomplished by frame representation whereby a triad
(xyz axes) is attached to the tool on the robot and a target frame is attached to the
part or operating point in the workcell. The inverse kinematics determine the
joint values required to align the tool triad with the target triad.
• I/O - Input/output which consist of ON/OFF signal values, threshold values, or
analog signal values which allow the control of or response to external
devices/sensors as required to sequence workcell operations.
• Programming language - The language and logical constructs used to
program the set of operational instructions used to control robot movement and
interact with sensors and other cell devices.
• Multi-tasking - Ability to process more than one program at a time or process
I/O concurrently.
Key Terms (cont..)
• Load capability - Force and torque capability of the robot at its tool interface
• Teach Pendant - Operator interface device used to teach/save robot
configurations and program simple instructions.
Where Used and Applied
• Welding
• Painting
• Surface finishing
• Aerospace and automotive industries
• Light assembly such as in the micro-electronics industries,
or consumer products industries
• Inspection of parts (e.g., CMM)
• Underwater and space exploration
• Hazardous waste remediation
Primary Vendors
· Fanuc (Japan) · Kuka (Germany)
· ABB (Sweden, US) · Adept (US)
· Panasonic (Japan) · Seiko (Japan)
· Sankyo (Japan) · Motoman (Japan)
· Mitsubishi (Japan)
Typical Costs: $20 K - $80 K
Vendor Specifications
Robot Repeatability & Accuracy
ISO 9283:1998 Norm for Industrial Robots:ISO 9283:1998 Norm for Industrial Robots:
RepeatabilityRepeatability: positional deviation from the average of displacement.: positional deviation from the average of displacement.
(max speed and max payload)(max speed and max payload)
Accuracy:Accuracy: ability to position, at a desired target point within the workability to position, at a desired target point within the work
volume. (max speed and max payload)volume. (max speed and max payload)
1. Warm robot to steady state conditions
2. Send identical commands to bring the robot to
3 different positions in sequence.
3. Measure the reached position using 2 cameras
and an optical target carried by the robot, or
other instruments.
Robot Repeatability & Accuracy
For N measurements, with commanded position (Xc, Yc, Zc) and reachedFor N measurements, with commanded position (Xc, Yc, Zc) and reached
position (Xr, Yr, Zr); according to statistics theory, using this formula, itposition (Xr, Yr, Zr); according to statistics theory, using this formula, it
means that the position of the robot will be 99.8% of the time inside themeans that the position of the robot will be 99.8% of the time inside the
repeatability range.repeatability range.
Supporting Technologies
· Vision systems · End-of-arm tooling
· Compliance devices · Manipulation devices
· Welding technologies · Lasers
· Proximity sensors · Wrist sensor (forces/torques)
· Control software/hardware · Part delivery systems
· Application software · Interface software
· Operating systems · Programming languages
· Communication systems · I/O devices
Advantages
• Greater flexibility, re-programmability, kinematics dexterity
• Greater response time to inputs than humans
• Improved product quality
• Maximize capital intensive equipment in multiple work shifts
• Accident reduction
• Reduction of hazardous exposure for human workers
• Automation less susceptible to work stoppages
Disadvantages
• Replacement of human labor
• Greater unemployment
• Significant retraining costs for both unemployed and
users of new technology
• Advertised technology does not always disclose some of
the hidden disadvantages
• Hidden costs because of the associated technology that
must be purchased and integrated into a functioning
cell. Typically, a functioning cell will cost 3-10 times
the cost of the robot.
Limitations
• Assembly dexterity does not match that of human beings,
particularly where eye-hand coordination required.
• Payload to robot weight ratio is poor, often less than 5%.
• Robot structural configuration may limit joint movement.
• Work volumes can be constrained by parts or tooling/sensors
added to the robot.
• Robot repeatability/accuracy can constrain the range of
potential applications.
• Closed architectures of modern robot control systems make it
difficult to automate cells.
Robot Kinematics
• Open kinematics chain
• Degrees-of-freedom = # independent joints (normally)
• Other joints often used to drive independent joints
• Joints often have functional relationships
• Forward kinematics -> Joint space
• Inverse kinematics -> Cartesian space
Homogeneous Transformation
Notes:
1. In robotics d = 0
2. p = origin of xyz relative to XYZ
3. Three columns of R are direction cosines of x, y, z with respect to X, Y,
and Z, e.g., R(1,2) = cosine of angle between y and X.
4. If xyz aligned with XYZ, then R = I = identity matrix.
5. If rotation only then p = 0 = zero vector.


















=
)11()31(
)13()33(
1
xx
xx
Td
pR
p),H(RXX
YY
ZZ
yy
xx
zz
pp
Interpretation of Homogeneous
Transformation











 −
1000
0100
100001
200010
YYzz
yy
xx
ZZ
XX
200200
100100
Example
Can you show that H from the previous slide is the same as H(p)
H(z,90˚)where frame xyz is first offset from the base frame by p = [200
100 0]T
, followed by a 90˚ rotation applied about the frame (or body) z
axis?
agrees!>−
−
=
−
=




























































1000
0100
100001
200010
1000
0100
0001
0010
1000
0100
100010
200001
H
H = H(p) H(z, 90˚)
Rotation Transformations
Rotation about single axis:
Transferring/Resolving Vectors
Transfer v to XYZ by
u = H v
where
Note: To resolve v into the base frame only the 3x3 R matrix
should be used and the 1 dropped off the v vector.
XX
YY
ZZ
yy
xx
zz
pp
uu
vv
uuxx
uuyy
uuzz
11
u =
vvxx
vvyy
vvzz
11
v =
Example of resolving vectors
Rotate u = [0 1 0]T
by 90˚ CW (-) about Z and 90˚ CW (-) about Y (note that both
rotations are about base axes). What are the final coordinates in XYZ axes? If
rotation order is changed, will the final coordinates be the same?
Solution:
v = R (Z, -90˚) u
w = R (Y, -90˚) v
Thus,
w = R (y, -90˚) R (z, -90˚) u




















−









 −
=










=
0
1
0
100
001
010
001
010
100
1
0
0
w
Rotations are not commutative, thus
final coordinates will not be the
same!
Relative Transformations
If we post-multiply a transformation representing a frame by a
second transformation, we make the transformation with respect to the
frame axes of the first transformation. Pre-multiplying the frame
transformation by the second transformation causes the transformation
to be made with respect to the base reference frame.
Kinematics Loop
Forward*: T = H1 H2…Hi…Hn G
Inverse*: H1 H2…Hi…Hn = TG-1
…..complex solution!
*Note that Hi is a function of joint variable; thus, 6 joints, 6 joint variables!s!
Forward Kinematics
Homogeneous transformations can be described in Denavit-Hartenberg (D-H) coordinates
which only requires 4 parameters to pose one frame relative to another. In these
coordinates the z axis is always aligned along the joint axis.
D-H parameters:
ai = minimum distance between joint i axis (zi) and joint i-1 axis (zi-1)
di = distance from minimum distance line (xi-1 axis) to origin of ith joint frame
measured along zi axis.
αi = angle between zi and zi-1 measured about previous joint frame xi-1 axis.
θi = angle about zi joint axis which rotates xi-1 to xi axis in right hand sense.
Joint Interpolated Motion
• Examine each joint for the changes in joint angles.
• Estimate the time to accomplish each joint change at the
speed setting, given the speed allowables for each joint.
• Determine the joint which will take the longest time to
accomplish the joint change.
• Slow the remaining joints down so that all accomplish their
change in the same period.
• The joint interpolated setting is usually a number between 0
and 1 which represents the fractional % of full speed for
each joint.
Example
A simple mechanism has two joints described as follows:
Joint 1: Joint 2:
Type = Prismatic (sliding) Type = Revolute (rotational)
Joint speed maximum = 100 mm/s Joint speed maximum = 180˚/s
If the robot joint speed setting is set to 50%, then approximate the time to move from a
configuration of 20 mm, 125.3˚ to a configuration of 134.5 mm, 34.5˚, and also determine
the joint speeds in doing so. Which joint is controlling the motion and which is following
the motion? Neglect the acceleration and deceleration times.
Solution:
Robot Programming
· Teach Pendant
· Lead Through
· Off-Line
· Programming Languages:
DARL
VAL II
RAIL
AML
KAREL
Robpac/C
etc.
Standards
• Robotics Industries Association (RIA)
• SME/RI
• Typical areas covered:
- Definitions such as accuracy/repeatability
- Teach pendant safety regulations
- Controller wiring
Summary
•Robotics - integration of computers and controlled mechanisms
to make devices re-programmable and versatile.
• Modern mathematic representations are used to plan robotic
tasks and integrate sensors into the task planning.
• There are decided advantages to using robots, namely flexibility
and performance quality.
• Down side is that robotics effects the labor pool and increases
the educational requirements for manufacturing personnel.
• Robotics are used in most industries and will be used even more
in the decades to come.
ThankThank You !!!You !!!
For More Information click below link:
Follow Us on:
http://vibranttechnologies.co.in/robotics-classes-in-mumbai.html

More Related Content

What's hot

Chapter 2 robot kinematics
Chapter 2   robot kinematicsChapter 2   robot kinematics
Chapter 2 robot kinematicsnguyendattdh
 
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-AllaqAimanAlAllaq
 
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 ...Waqas Tariq
 
RMV robot programming
RMV robot programmingRMV robot programming
RMV robot programminganand hd
 
Robotics and Automation Introduction
Robotics and Automation IntroductionRobotics and Automation Introduction
Robotics and Automation Introductionanand hd
 
selection of robot
selection of robotselection of robot
selection of robotnabil130290
 
Empirical Analysis of Invariance of Transform Coefficients under Rotation
Empirical Analysis of Invariance of Transform Coefficients under RotationEmpirical Analysis of Invariance of Transform Coefficients under Rotation
Empirical Analysis of Invariance of Transform Coefficients under RotationIJERD Editor
 
Robotics unit4 slides
Robotics unit4 slidesRobotics unit4 slides
Robotics unit4 slidesJanarthanan B
 
RMV Mechanics
RMV MechanicsRMV Mechanics
RMV Mechanicsanand hd
 
Robotics of Quadruped Robot
Robotics of Quadruped RobotRobotics of Quadruped Robot
Robotics of Quadruped Robot홍배 김
 
Robotics: Cartesian Trajectory Planning
Robotics: Cartesian Trajectory PlanningRobotics: Cartesian Trajectory Planning
Robotics: Cartesian Trajectory PlanningDamian T. Gordon
 
Robotics: Introduction to Kinematics
Robotics: Introduction to KinematicsRobotics: Introduction to Kinematics
Robotics: Introduction to KinematicsDamian T. Gordon
 
Basics of Robotics
Basics of RoboticsBasics of Robotics
Basics of Robotics홍배 김
 

What's hot (20)

Chapter 2 robot kinematics
Chapter 2   robot kinematicsChapter 2   robot kinematics
Chapter 2 robot kinematics
 
07 robot arm kinematics
07 robot arm kinematics07 robot arm kinematics
07 robot arm kinematics
 
Inverse Kinematics
Inverse KinematicsInverse Kinematics
Inverse Kinematics
 
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 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 ...
 
RMV robot programming
RMV robot programmingRMV robot programming
RMV robot programming
 
Robotics and Automation Introduction
Robotics and Automation IntroductionRobotics and Automation Introduction
Robotics and Automation Introduction
 
selection of robot
selection of robotselection of robot
selection of robot
 
Empirical Analysis of Invariance of Transform Coefficients under Rotation
Empirical Analysis of Invariance of Transform Coefficients under RotationEmpirical Analysis of Invariance of Transform Coefficients under Rotation
Empirical Analysis of Invariance of Transform Coefficients under Rotation
 
Robotics unit4 slides
Robotics unit4 slidesRobotics unit4 slides
Robotics unit4 slides
 
RMV Mechanics
RMV MechanicsRMV Mechanics
RMV Mechanics
 
Lecture2
Lecture2Lecture2
Lecture2
 
Kinematics Modeling and Simulation of SCARA Robot Arm
Kinematics Modeling and Simulation of SCARA Robot ArmKinematics Modeling and Simulation of SCARA Robot Arm
Kinematics Modeling and Simulation of SCARA Robot Arm
 
Robotics of Quadruped Robot
Robotics of Quadruped RobotRobotics of Quadruped Robot
Robotics of Quadruped Robot
 
Robotics: Cartesian Trajectory Planning
Robotics: Cartesian Trajectory PlanningRobotics: Cartesian Trajectory Planning
Robotics: Cartesian Trajectory Planning
 
Lecture 04
Lecture 04Lecture 04
Lecture 04
 
Robotics: Introduction to Kinematics
Robotics: Introduction to KinematicsRobotics: Introduction to Kinematics
Robotics: Introduction to Kinematics
 
11 kinematicsrobot
11 kinematicsrobot11 kinematicsrobot
11 kinematicsrobot
 
Basics of Robotics
Basics of RoboticsBasics of Robotics
Basics of Robotics
 
Fir 04 kinem
Fir 04 kinemFir 04 kinem
Fir 04 kinem
 

Viewers also liked

Coal Handling System
Coal Handling SystemCoal Handling System
Coal Handling Systemshaikhsaif
 
Programmable logic controller(plc)
Programmable logic controller(plc)Programmable logic controller(plc)
Programmable logic controller(plc)Mustahid Ali
 
COAL HANDLING PLANT
COAL  HANDLING PLANTCOAL  HANDLING PLANT
COAL HANDLING PLANTpulak126
 
Introduction: Strategic Management of Engineering Enterprise
Introduction:  Strategic Management of Engineering EnterpriseIntroduction:  Strategic Management of Engineering Enterprise
Introduction: Strategic Management of Engineering EnterpriseJo Balucanag - Bitonio
 
Future of Robotics- Presentation by Dr. Manish Sharma
Future of Robotics- Presentation by Dr. Manish SharmaFuture of Robotics- Presentation by Dr. Manish Sharma
Future of Robotics- Presentation by Dr. Manish Sharmarobongiers
 
Market Intelligence Briefing and Government Panel: Cloud Sales Opportunities
Market Intelligence Briefing and Government Panel: Cloud Sales OpportunitiesMarket Intelligence Briefing and Government Panel: Cloud Sales Opportunities
Market Intelligence Briefing and Government Panel: Cloud Sales OpportunitiesimmixGroup
 
GRAINGER AND MCMASTER CARR – MAINTENANCE REPAIR AND OPERATION SUPPLIERS
GRAINGER AND MCMASTER CARR – MAINTENANCE REPAIR AND OPERATION SUPPLIERSGRAINGER AND MCMASTER CARR – MAINTENANCE REPAIR AND OPERATION SUPPLIERS
GRAINGER AND MCMASTER CARR – MAINTENANCE REPAIR AND OPERATION SUPPLIERSAkhil Ayyakutty
 
Big Data Workshop: Splunk and Dell EMC...Better Together
Big Data Workshop: Splunk and Dell EMC...Better TogetherBig Data Workshop: Splunk and Dell EMC...Better Together
Big Data Workshop: Splunk and Dell EMC...Better TogetherZivaro Inc
 
Oshkosh 1070 f heavy equipment transporter, united kingdom
Oshkosh 1070 f heavy equipment transporter, united kingdomOshkosh 1070 f heavy equipment transporter, united kingdom
Oshkosh 1070 f heavy equipment transporter, united kingdomhindujudaic
 
Opslag van long tail producten in e-warehouse
Opslag van long tail producten in e-warehouseOpslag van long tail producten in e-warehouse
Opslag van long tail producten in e-warehouseFréderique Debecker
 
Getting hired 101 | Lessons from Where's Waldo
Getting hired 101 | Lessons from Where's WaldoGetting hired 101 | Lessons from Where's Waldo
Getting hired 101 | Lessons from Where's WaldoBenjamin W. Jackson
 
SandeepKumar _Resume
SandeepKumar _ResumeSandeepKumar _Resume
SandeepKumar _ResumeSandeep Kumar
 
Aws d1.1. 2002 presentation for ska 2005
Aws d1.1. 2002 presentation for ska 2005 Aws d1.1. 2002 presentation for ska 2005
Aws d1.1. 2002 presentation for ska 2005 Sergey Kobelev
 
SYNERGY Global VAT/GST update – Overview of recent changes & what’s on the ho...
SYNERGY Global VAT/GST update – Overview of recent changes & what’s on the ho...SYNERGY Global VAT/GST update – Overview of recent changes & what’s on the ho...
SYNERGY Global VAT/GST update – Overview of recent changes & what’s on the ho...Alex Baulf
 

Viewers also liked (20)

Coal Handling System
Coal Handling SystemCoal Handling System
Coal Handling System
 
Programmable logic controller(plc)
Programmable logic controller(plc)Programmable logic controller(plc)
Programmable logic controller(plc)
 
COAL HANDLING PLANT
COAL  HANDLING PLANTCOAL  HANDLING PLANT
COAL HANDLING PLANT
 
Introduction: Strategic Management of Engineering Enterprise
Introduction:  Strategic Management of Engineering EnterpriseIntroduction:  Strategic Management of Engineering Enterprise
Introduction: Strategic Management of Engineering Enterprise
 
Future of Robotics- Presentation by Dr. Manish Sharma
Future of Robotics- Presentation by Dr. Manish SharmaFuture of Robotics- Presentation by Dr. Manish Sharma
Future of Robotics- Presentation by Dr. Manish Sharma
 
Balancing Chemical Equations
Balancing Chemical EquationsBalancing Chemical Equations
Balancing Chemical Equations
 
Market Intelligence Briefing and Government Panel: Cloud Sales Opportunities
Market Intelligence Briefing and Government Panel: Cloud Sales OpportunitiesMarket Intelligence Briefing and Government Panel: Cloud Sales Opportunities
Market Intelligence Briefing and Government Panel: Cloud Sales Opportunities
 
GRAINGER AND MCMASTER CARR – MAINTENANCE REPAIR AND OPERATION SUPPLIERS
GRAINGER AND MCMASTER CARR – MAINTENANCE REPAIR AND OPERATION SUPPLIERSGRAINGER AND MCMASTER CARR – MAINTENANCE REPAIR AND OPERATION SUPPLIERS
GRAINGER AND MCMASTER CARR – MAINTENANCE REPAIR AND OPERATION SUPPLIERS
 
Big Data Workshop: Splunk and Dell EMC...Better Together
Big Data Workshop: Splunk and Dell EMC...Better TogetherBig Data Workshop: Splunk and Dell EMC...Better Together
Big Data Workshop: Splunk and Dell EMC...Better Together
 
Kotler mm 14e_11_ippt
Kotler mm 14e_11_ipptKotler mm 14e_11_ippt
Kotler mm 14e_11_ippt
 
Oshkosh 1070 f heavy equipment transporter, united kingdom
Oshkosh 1070 f heavy equipment transporter, united kingdomOshkosh 1070 f heavy equipment transporter, united kingdom
Oshkosh 1070 f heavy equipment transporter, united kingdom
 
Opslag van long tail producten in e-warehouse
Opslag van long tail producten in e-warehouseOpslag van long tail producten in e-warehouse
Opslag van long tail producten in e-warehouse
 
Getting hired 101 | Lessons from Where's Waldo
Getting hired 101 | Lessons from Where's WaldoGetting hired 101 | Lessons from Where's Waldo
Getting hired 101 | Lessons from Where's Waldo
 
Mareck Resume
Mareck ResumeMareck Resume
Mareck Resume
 
SandeepKumar _Resume
SandeepKumar _ResumeSandeepKumar _Resume
SandeepKumar _Resume
 
The mindset of an alpha marketer
The mindset of an alpha marketerThe mindset of an alpha marketer
The mindset of an alpha marketer
 
Jayadeep cv latest
Jayadeep cv latestJayadeep cv latest
Jayadeep cv latest
 
Aws d1.1. 2002 presentation for ska 2005
Aws d1.1. 2002 presentation for ska 2005 Aws d1.1. 2002 presentation for ska 2005
Aws d1.1. 2002 presentation for ska 2005
 
Motor final
Motor finalMotor final
Motor final
 
SYNERGY Global VAT/GST update – Overview of recent changes & what’s on the ho...
SYNERGY Global VAT/GST update – Overview of recent changes & what’s on the ho...SYNERGY Global VAT/GST update – Overview of recent changes & what’s on the ho...
SYNERGY Global VAT/GST update – Overview of recent changes & what’s on the ho...
 

Similar to Robotics - introduction to Robotics

Industrial Robotics Chap 01 Fundamentals
Industrial  Robotics  Chap 01  FundamentalsIndustrial  Robotics  Chap 01  Fundamentals
Industrial Robotics Chap 01 FundamentalsKevin Carvalho
 
Robot programming , accuracy ,repeatability and application
Robot programming , accuracy ,repeatability  and applicationRobot programming , accuracy ,repeatability  and application
Robot programming , accuracy ,repeatability and applicationvishaldattKohir1
 
robot-pplication-200916054307.pptx
robot-pplication-200916054307.pptxrobot-pplication-200916054307.pptx
robot-pplication-200916054307.pptxDSelvamarilakshmiAss
 
Readymade Projects,Buy Projects,Corporate Training,Projects Assistance
Readymade Projects,Buy Projects,Corporate Training,Projects AssistanceReadymade Projects,Buy Projects,Corporate Training,Projects Assistance
Readymade Projects,Buy Projects,Corporate Training,Projects AssistanceTechnogroovy
 
UNIT 6 Robotics01.ppt
UNIT 6 Robotics01.pptUNIT 6 Robotics01.ppt
UNIT 6 Robotics01.pptnachiketkale5
 
Robotics corporate-training-in-mumbai
Robotics corporate-training-in-mumbaiRobotics corporate-training-in-mumbai
Robotics corporate-training-in-mumbaiUnmesh Baile
 
robotics presentation (2).ppt is good for the student life and easy to gain t...
robotics presentation (2).ppt is good for the student life and easy to gain t...robotics presentation (2).ppt is good for the student life and easy to gain t...
robotics presentation (2).ppt is good for the student life and easy to gain t...poojaranga2911
 
Industrial Automated Robots Working and explanation
Industrial Automated Robots Working and explanationIndustrial Automated Robots Working and explanation
Industrial Automated Robots Working and explanationSarmadFarooq5
 
06. industrial robotics
06. industrial robotics06. industrial robotics
06. industrial roboticsrichard visey
 
introduction to robotics and embedded systems
introduction to robotics and embedded systemsintroduction to robotics and embedded systems
introduction to robotics and embedded systemsDirectorCentreforEne
 

Similar to Robotics - introduction to Robotics (20)

Industrial_Robots_pptx.pptx
Industrial_Robots_pptx.pptxIndustrial_Robots_pptx.pptx
Industrial_Robots_pptx.pptx
 
Robots
RobotsRobots
Robots
 
ROBOTICS - Introduction to Robotics
ROBOTICS -  Introduction to RoboticsROBOTICS -  Introduction to Robotics
ROBOTICS - Introduction to Robotics
 
Industrial Robotics Chap 01 Fundamentals
Industrial  Robotics  Chap 01  FundamentalsIndustrial  Robotics  Chap 01  Fundamentals
Industrial Robotics Chap 01 Fundamentals
 
Robot programming , accuracy ,repeatability and application
Robot programming , accuracy ,repeatability  and applicationRobot programming , accuracy ,repeatability  and application
Robot programming , accuracy ,repeatability and application
 
robot-pplication-200916054307.pptx
robot-pplication-200916054307.pptxrobot-pplication-200916054307.pptx
robot-pplication-200916054307.pptx
 
Readymade Projects,Buy Projects,Corporate Training,Projects Assistance
Readymade Projects,Buy Projects,Corporate Training,Projects AssistanceReadymade Projects,Buy Projects,Corporate Training,Projects Assistance
Readymade Projects,Buy Projects,Corporate Training,Projects Assistance
 
UNIT 6 Robotics01.ppt
UNIT 6 Robotics01.pptUNIT 6 Robotics01.ppt
UNIT 6 Robotics01.ppt
 
robot_program.ppt
robot_program.pptrobot_program.ppt
robot_program.ppt
 
Robotics corporate-training-in-mumbai
Robotics corporate-training-in-mumbaiRobotics corporate-training-in-mumbai
Robotics corporate-training-in-mumbai
 
robotics presentation (2).ppt is good for the student life and easy to gain t...
robotics presentation (2).ppt is good for the student life and easy to gain t...robotics presentation (2).ppt is good for the student life and easy to gain t...
robotics presentation (2).ppt is good for the student life and easy to gain t...
 
ROBOTIC - Introduction to Robotics
ROBOTIC - Introduction to RoboticsROBOTIC - Introduction to Robotics
ROBOTIC - Introduction to Robotics
 
Industrial robotics.pptx
Industrial robotics.pptxIndustrial robotics.pptx
Industrial robotics.pptx
 
Robots
Robots Robots
Robots
 
Ie450pp8
Ie450pp8Ie450pp8
Ie450pp8
 
Ie450pp8
Ie450pp8Ie450pp8
Ie450pp8
 
Industrial Automated Robots Working and explanation
Industrial Automated Robots Working and explanationIndustrial Automated Robots Working and explanation
Industrial Automated Robots Working and explanation
 
06. industrial robotics
06. industrial robotics06. industrial robotics
06. industrial robotics
 
Robotics1.ppt
Robotics1.pptRobotics1.ppt
Robotics1.ppt
 
introduction to robotics and embedded systems
introduction to robotics and embedded systemsintroduction to robotics and embedded systems
introduction to robotics and embedded systems
 

More from Vibrant Technologies & Computers

Data ware housing - Introduction to data ware housing process.
Data ware housing - Introduction to data ware housing process.Data ware housing - Introduction to data ware housing process.
Data ware housing - Introduction to data ware housing process.Vibrant Technologies & Computers
 

More from Vibrant Technologies & Computers (20)

Buisness analyst business analysis overview ppt 5
Buisness analyst business analysis overview ppt 5Buisness analyst business analysis overview ppt 5
Buisness analyst business analysis overview ppt 5
 
SQL Introduction to displaying data from multiple tables
SQL Introduction to displaying data from multiple tables  SQL Introduction to displaying data from multiple tables
SQL Introduction to displaying data from multiple tables
 
SQL- Introduction to MySQL
SQL- Introduction to MySQLSQL- Introduction to MySQL
SQL- Introduction to MySQL
 
SQL- Introduction to SQL database
SQL- Introduction to SQL database SQL- Introduction to SQL database
SQL- Introduction to SQL database
 
ITIL - introduction to ITIL
ITIL - introduction to ITILITIL - introduction to ITIL
ITIL - introduction to ITIL
 
Salesforce - Introduction to Security & Access
Salesforce -  Introduction to Security & Access Salesforce -  Introduction to Security & Access
Salesforce - Introduction to Security & Access
 
Data ware housing- Introduction to olap .
Data ware housing- Introduction to  olap .Data ware housing- Introduction to  olap .
Data ware housing- Introduction to olap .
 
Data ware housing - Introduction to data ware housing process.
Data ware housing - Introduction to data ware housing process.Data ware housing - Introduction to data ware housing process.
Data ware housing - Introduction to data ware housing process.
 
Data ware housing- Introduction to data ware housing
Data ware housing- Introduction to data ware housingData ware housing- Introduction to data ware housing
Data ware housing- Introduction to data ware housing
 
Salesforce - classification of cloud computing
Salesforce - classification of cloud computingSalesforce - classification of cloud computing
Salesforce - classification of cloud computing
 
Salesforce - cloud computing fundamental
Salesforce - cloud computing fundamentalSalesforce - cloud computing fundamental
Salesforce - cloud computing fundamental
 
SQL- Introduction to PL/SQL
SQL- Introduction to  PL/SQLSQL- Introduction to  PL/SQL
SQL- Introduction to PL/SQL
 
SQL- Introduction to advanced sql concepts
SQL- Introduction to  advanced sql conceptsSQL- Introduction to  advanced sql concepts
SQL- Introduction to advanced sql concepts
 
SQL Inteoduction to SQL manipulating of data
SQL Inteoduction to SQL manipulating of data   SQL Inteoduction to SQL manipulating of data
SQL Inteoduction to SQL manipulating of data
 
SQL- Introduction to SQL Set Operations
SQL- Introduction to SQL Set OperationsSQL- Introduction to SQL Set Operations
SQL- Introduction to SQL Set Operations
 
Sas - Introduction to designing the data mart
Sas - Introduction to designing the data martSas - Introduction to designing the data mart
Sas - Introduction to designing the data mart
 
Sas - Introduction to working under change management
Sas - Introduction to working under change managementSas - Introduction to working under change management
Sas - Introduction to working under change management
 
SAS - overview of SAS
SAS - overview of SASSAS - overview of SAS
SAS - overview of SAS
 
Teradata - Architecture of Teradata
Teradata - Architecture of TeradataTeradata - Architecture of Teradata
Teradata - Architecture of Teradata
 
Teradata - Restoring Data
Teradata - Restoring Data Teradata - Restoring Data
Teradata - Restoring Data
 

Recently uploaded

Integration and Automation in Practice: CI/CD in Mule Integration and Automat...
Integration and Automation in Practice: CI/CD in Mule Integration and Automat...Integration and Automation in Practice: CI/CD in Mule Integration and Automat...
Integration and Automation in Practice: CI/CD in Mule Integration and Automat...Patryk Bandurski
 
Unblocking The Main Thread Solving ANRs and Frozen Frames
Unblocking The Main Thread Solving ANRs and Frozen FramesUnblocking The Main Thread Solving ANRs and Frozen Frames
Unblocking The Main Thread Solving ANRs and Frozen FramesSinan KOZAK
 
Human Factors of XR: Using Human Factors to Design XR Systems
Human Factors of XR: Using Human Factors to Design XR SystemsHuman Factors of XR: Using Human Factors to Design XR Systems
Human Factors of XR: Using Human Factors to Design XR SystemsMark Billinghurst
 
Install Stable Diffusion in windows machine
Install Stable Diffusion in windows machineInstall Stable Diffusion in windows machine
Install Stable Diffusion in windows machinePadma Pradeep
 
Breaking the Kubernetes Kill Chain: Host Path Mount
Breaking the Kubernetes Kill Chain: Host Path MountBreaking the Kubernetes Kill Chain: Host Path Mount
Breaking the Kubernetes Kill Chain: Host Path MountPuma Security, LLC
 
CloudStudio User manual (basic edition):
CloudStudio User manual (basic edition):CloudStudio User manual (basic edition):
CloudStudio User manual (basic edition):comworks
 
Build your next Gen AI Breakthrough - April 2024
Build your next Gen AI Breakthrough - April 2024Build your next Gen AI Breakthrough - April 2024
Build your next Gen AI Breakthrough - April 2024Neo4j
 
Artificial intelligence in the post-deep learning era
Artificial intelligence in the post-deep learning eraArtificial intelligence in the post-deep learning era
Artificial intelligence in the post-deep learning eraDeakin University
 
Understanding the Laravel MVC Architecture
Understanding the Laravel MVC ArchitectureUnderstanding the Laravel MVC Architecture
Understanding the Laravel MVC ArchitecturePixlogix Infotech
 
"LLMs for Python Engineers: Advanced Data Analysis and Semantic Kernel",Oleks...
"LLMs for Python Engineers: Advanced Data Analysis and Semantic Kernel",Oleks..."LLMs for Python Engineers: Advanced Data Analysis and Semantic Kernel",Oleks...
"LLMs for Python Engineers: Advanced Data Analysis and Semantic Kernel",Oleks...Fwdays
 
Connect Wave/ connectwave Pitch Deck Presentation
Connect Wave/ connectwave Pitch Deck PresentationConnect Wave/ connectwave Pitch Deck Presentation
Connect Wave/ connectwave Pitch Deck PresentationSlibray Presentation
 
Presentation on how to chat with PDF using ChatGPT code interpreter
Presentation on how to chat with PDF using ChatGPT code interpreterPresentation on how to chat with PDF using ChatGPT code interpreter
Presentation on how to chat with PDF using ChatGPT code interpreternaman860154
 
Key Features Of Token Development (1).pptx
Key  Features Of Token  Development (1).pptxKey  Features Of Token  Development (1).pptx
Key Features Of Token Development (1).pptxLBM Solutions
 
Unleash Your Potential - Namagunga Girls Coding Club
Unleash Your Potential - Namagunga Girls Coding ClubUnleash Your Potential - Namagunga Girls Coding Club
Unleash Your Potential - Namagunga Girls Coding ClubKalema Edgar
 
Automating Business Process via MuleSoft Composer | Bangalore MuleSoft Meetup...
Automating Business Process via MuleSoft Composer | Bangalore MuleSoft Meetup...Automating Business Process via MuleSoft Composer | Bangalore MuleSoft Meetup...
Automating Business Process via MuleSoft Composer | Bangalore MuleSoft Meetup...shyamraj55
 
Are Multi-Cloud and Serverless Good or Bad?
Are Multi-Cloud and Serverless Good or Bad?Are Multi-Cloud and Serverless Good or Bad?
Are Multi-Cloud and Serverless Good or Bad?Mattias Andersson
 
Tech-Forward - Achieving Business Readiness For Copilot in Microsoft 365
Tech-Forward - Achieving Business Readiness For Copilot in Microsoft 365Tech-Forward - Achieving Business Readiness For Copilot in Microsoft 365
Tech-Forward - Achieving Business Readiness For Copilot in Microsoft 3652toLead Limited
 
Injustice - Developers Among Us (SciFiDevCon 2024)
Injustice - Developers Among Us (SciFiDevCon 2024)Injustice - Developers Among Us (SciFiDevCon 2024)
Injustice - Developers Among Us (SciFiDevCon 2024)Allon Mureinik
 
SQL Database Design For Developers at php[tek] 2024
SQL Database Design For Developers at php[tek] 2024SQL Database Design For Developers at php[tek] 2024
SQL Database Design For Developers at php[tek] 2024Scott Keck-Warren
 

Recently uploaded (20)

Integration and Automation in Practice: CI/CD in Mule Integration and Automat...
Integration and Automation in Practice: CI/CD in Mule Integration and Automat...Integration and Automation in Practice: CI/CD in Mule Integration and Automat...
Integration and Automation in Practice: CI/CD in Mule Integration and Automat...
 
Unblocking The Main Thread Solving ANRs and Frozen Frames
Unblocking The Main Thread Solving ANRs and Frozen FramesUnblocking The Main Thread Solving ANRs and Frozen Frames
Unblocking The Main Thread Solving ANRs and Frozen Frames
 
DMCC Future of Trade Web3 - Special Edition
DMCC Future of Trade Web3 - Special EditionDMCC Future of Trade Web3 - Special Edition
DMCC Future of Trade Web3 - Special Edition
 
Human Factors of XR: Using Human Factors to Design XR Systems
Human Factors of XR: Using Human Factors to Design XR SystemsHuman Factors of XR: Using Human Factors to Design XR Systems
Human Factors of XR: Using Human Factors to Design XR Systems
 
Install Stable Diffusion in windows machine
Install Stable Diffusion in windows machineInstall Stable Diffusion in windows machine
Install Stable Diffusion in windows machine
 
Breaking the Kubernetes Kill Chain: Host Path Mount
Breaking the Kubernetes Kill Chain: Host Path MountBreaking the Kubernetes Kill Chain: Host Path Mount
Breaking the Kubernetes Kill Chain: Host Path Mount
 
CloudStudio User manual (basic edition):
CloudStudio User manual (basic edition):CloudStudio User manual (basic edition):
CloudStudio User manual (basic edition):
 
Build your next Gen AI Breakthrough - April 2024
Build your next Gen AI Breakthrough - April 2024Build your next Gen AI Breakthrough - April 2024
Build your next Gen AI Breakthrough - April 2024
 
Artificial intelligence in the post-deep learning era
Artificial intelligence in the post-deep learning eraArtificial intelligence in the post-deep learning era
Artificial intelligence in the post-deep learning era
 
Understanding the Laravel MVC Architecture
Understanding the Laravel MVC ArchitectureUnderstanding the Laravel MVC Architecture
Understanding the Laravel MVC Architecture
 
"LLMs for Python Engineers: Advanced Data Analysis and Semantic Kernel",Oleks...
"LLMs for Python Engineers: Advanced Data Analysis and Semantic Kernel",Oleks..."LLMs for Python Engineers: Advanced Data Analysis and Semantic Kernel",Oleks...
"LLMs for Python Engineers: Advanced Data Analysis and Semantic Kernel",Oleks...
 
Connect Wave/ connectwave Pitch Deck Presentation
Connect Wave/ connectwave Pitch Deck PresentationConnect Wave/ connectwave Pitch Deck Presentation
Connect Wave/ connectwave Pitch Deck Presentation
 
Presentation on how to chat with PDF using ChatGPT code interpreter
Presentation on how to chat with PDF using ChatGPT code interpreterPresentation on how to chat with PDF using ChatGPT code interpreter
Presentation on how to chat with PDF using ChatGPT code interpreter
 
Key Features Of Token Development (1).pptx
Key  Features Of Token  Development (1).pptxKey  Features Of Token  Development (1).pptx
Key Features Of Token Development (1).pptx
 
Unleash Your Potential - Namagunga Girls Coding Club
Unleash Your Potential - Namagunga Girls Coding ClubUnleash Your Potential - Namagunga Girls Coding Club
Unleash Your Potential - Namagunga Girls Coding Club
 
Automating Business Process via MuleSoft Composer | Bangalore MuleSoft Meetup...
Automating Business Process via MuleSoft Composer | Bangalore MuleSoft Meetup...Automating Business Process via MuleSoft Composer | Bangalore MuleSoft Meetup...
Automating Business Process via MuleSoft Composer | Bangalore MuleSoft Meetup...
 
Are Multi-Cloud and Serverless Good or Bad?
Are Multi-Cloud and Serverless Good or Bad?Are Multi-Cloud and Serverless Good or Bad?
Are Multi-Cloud and Serverless Good or Bad?
 
Tech-Forward - Achieving Business Readiness For Copilot in Microsoft 365
Tech-Forward - Achieving Business Readiness For Copilot in Microsoft 365Tech-Forward - Achieving Business Readiness For Copilot in Microsoft 365
Tech-Forward - Achieving Business Readiness For Copilot in Microsoft 365
 
Injustice - Developers Among Us (SciFiDevCon 2024)
Injustice - Developers Among Us (SciFiDevCon 2024)Injustice - Developers Among Us (SciFiDevCon 2024)
Injustice - Developers Among Us (SciFiDevCon 2024)
 
SQL Database Design For Developers at php[tek] 2024
SQL Database Design For Developers at php[tek] 2024SQL Database Design For Developers at php[tek] 2024
SQL Database Design For Developers at php[tek] 2024
 

Robotics - introduction to Robotics

  • 1.
  • 3. Robot Function • Generate specific motion of joints • Integrate tooling and sensors Robot Processes • Path following • Repetitive configuration moves • Telerobotics • Target moves versus taught moves
  • 4. Key Terms (cont...) • TCF - Tool or terminal control frame • TCP - Tool /terminal control point • Joint limits - Either the software or physical hardware limits which constrain the operating range of a joint on a robot. The software limits have a smaller range than the hardware limits. • Joint speed limits - Speed limit for robot joints, which limit how fast the links of a robot may translate or rotate. • Point-to-point motion - Characterized by starting and stopping between configurations or as the tool is moved between targets.
  • 5. Key Terms (cont..) • Continuous path motion - Characterized by blending of motion between configurations or targets, usually with the loss of path accuracy at the target transitions, as the robot moves between configurations/targets. • Interpolation (kinematic) capabilities - Robot usually capable of both forward and inverse kinematics. Both combine to give the robot the capability to move in joint space and in Cartesian space. We typically refer to the moves as joint, linear, or circular interpolation. • Forward kinematics - Specifying the joint values to accomplish a robot move to a new configuration in space. These may not be simple as it seems because secondary joints such as four-bar linkages, ball screws, etc. may be required to accomplish this motion.
  • 6. Key Terms (cont..) • Inverse kinematics - Solving a mathematical model of the robot kinematics to determine the necessary joint values to move the tool to a desired target (frame) in space. This is accomplished by frame representation whereby a triad (xyz axes) is attached to the tool on the robot and a target frame is attached to the part or operating point in the workcell. The inverse kinematics determine the joint values required to align the tool triad with the target triad. • I/O - Input/output which consist of ON/OFF signal values, threshold values, or analog signal values which allow the control of or response to external devices/sensors as required to sequence workcell operations. • Programming language - The language and logical constructs used to program the set of operational instructions used to control robot movement and interact with sensors and other cell devices. • Multi-tasking - Ability to process more than one program at a time or process I/O concurrently.
  • 7. Key Terms (cont..) • Load capability - Force and torque capability of the robot at its tool interface • Teach Pendant - Operator interface device used to teach/save robot configurations and program simple instructions.
  • 8. Where Used and Applied • Welding • Painting • Surface finishing • Aerospace and automotive industries • Light assembly such as in the micro-electronics industries, or consumer products industries • Inspection of parts (e.g., CMM) • Underwater and space exploration • Hazardous waste remediation
  • 9. Primary Vendors · Fanuc (Japan) · Kuka (Germany) · ABB (Sweden, US) · Adept (US) · Panasonic (Japan) · Seiko (Japan) · Sankyo (Japan) · Motoman (Japan) · Mitsubishi (Japan) Typical Costs: $20 K - $80 K
  • 11. Robot Repeatability & Accuracy ISO 9283:1998 Norm for Industrial Robots:ISO 9283:1998 Norm for Industrial Robots: RepeatabilityRepeatability: positional deviation from the average of displacement.: positional deviation from the average of displacement. (max speed and max payload)(max speed and max payload) Accuracy:Accuracy: ability to position, at a desired target point within the workability to position, at a desired target point within the work volume. (max speed and max payload)volume. (max speed and max payload) 1. Warm robot to steady state conditions 2. Send identical commands to bring the robot to 3 different positions in sequence. 3. Measure the reached position using 2 cameras and an optical target carried by the robot, or other instruments.
  • 12. Robot Repeatability & Accuracy For N measurements, with commanded position (Xc, Yc, Zc) and reachedFor N measurements, with commanded position (Xc, Yc, Zc) and reached position (Xr, Yr, Zr); according to statistics theory, using this formula, itposition (Xr, Yr, Zr); according to statistics theory, using this formula, it means that the position of the robot will be 99.8% of the time inside themeans that the position of the robot will be 99.8% of the time inside the repeatability range.repeatability range.
  • 13. Supporting Technologies · Vision systems · End-of-arm tooling · Compliance devices · Manipulation devices · Welding technologies · Lasers · Proximity sensors · Wrist sensor (forces/torques) · Control software/hardware · Part delivery systems · Application software · Interface software · Operating systems · Programming languages · Communication systems · I/O devices
  • 14. Advantages • Greater flexibility, re-programmability, kinematics dexterity • Greater response time to inputs than humans • Improved product quality • Maximize capital intensive equipment in multiple work shifts • Accident reduction • Reduction of hazardous exposure for human workers • Automation less susceptible to work stoppages
  • 15. Disadvantages • Replacement of human labor • Greater unemployment • Significant retraining costs for both unemployed and users of new technology • Advertised technology does not always disclose some of the hidden disadvantages • Hidden costs because of the associated technology that must be purchased and integrated into a functioning cell. Typically, a functioning cell will cost 3-10 times the cost of the robot.
  • 16. Limitations • Assembly dexterity does not match that of human beings, particularly where eye-hand coordination required. • Payload to robot weight ratio is poor, often less than 5%. • Robot structural configuration may limit joint movement. • Work volumes can be constrained by parts or tooling/sensors added to the robot. • Robot repeatability/accuracy can constrain the range of potential applications. • Closed architectures of modern robot control systems make it difficult to automate cells.
  • 17. Robot Kinematics • Open kinematics chain • Degrees-of-freedom = # independent joints (normally) • Other joints often used to drive independent joints • Joints often have functional relationships • Forward kinematics -> Joint space • Inverse kinematics -> Cartesian space
  • 18. Homogeneous Transformation Notes: 1. In robotics d = 0 2. p = origin of xyz relative to XYZ 3. Three columns of R are direction cosines of x, y, z with respect to X, Y, and Z, e.g., R(1,2) = cosine of angle between y and X. 4. If xyz aligned with XYZ, then R = I = identity matrix. 5. If rotation only then p = 0 = zero vector.                   = )11()31( )13()33( 1 xx xx Td pR p),H(RXX YY ZZ yy xx zz pp
  • 19. Interpretation of Homogeneous Transformation             − 1000 0100 100001 200010 YYzz yy xx ZZ XX 200200 100100
  • 20. Example Can you show that H from the previous slide is the same as H(p) H(z,90˚)where frame xyz is first offset from the base frame by p = [200 100 0]T , followed by a 90˚ rotation applied about the frame (or body) z axis? agrees!>− − = − =                                                             1000 0100 100001 200010 1000 0100 0001 0010 1000 0100 100010 200001 H H = H(p) H(z, 90˚)
  • 22. Transferring/Resolving Vectors Transfer v to XYZ by u = H v where Note: To resolve v into the base frame only the 3x3 R matrix should be used and the 1 dropped off the v vector. XX YY ZZ yy xx zz pp uu vv uuxx uuyy uuzz 11 u = vvxx vvyy vvzz 11 v =
  • 23. Example of resolving vectors Rotate u = [0 1 0]T by 90˚ CW (-) about Z and 90˚ CW (-) about Y (note that both rotations are about base axes). What are the final coordinates in XYZ axes? If rotation order is changed, will the final coordinates be the same? Solution: v = R (Z, -90˚) u w = R (Y, -90˚) v Thus, w = R (y, -90˚) R (z, -90˚) u                     −           − =           = 0 1 0 100 001 010 001 010 100 1 0 0 w Rotations are not commutative, thus final coordinates will not be the same!
  • 24. Relative Transformations If we post-multiply a transformation representing a frame by a second transformation, we make the transformation with respect to the frame axes of the first transformation. Pre-multiplying the frame transformation by the second transformation causes the transformation to be made with respect to the base reference frame.
  • 25. Kinematics Loop Forward*: T = H1 H2…Hi…Hn G Inverse*: H1 H2…Hi…Hn = TG-1 …..complex solution! *Note that Hi is a function of joint variable; thus, 6 joints, 6 joint variables!s!
  • 26. Forward Kinematics Homogeneous transformations can be described in Denavit-Hartenberg (D-H) coordinates which only requires 4 parameters to pose one frame relative to another. In these coordinates the z axis is always aligned along the joint axis. D-H parameters: ai = minimum distance between joint i axis (zi) and joint i-1 axis (zi-1) di = distance from minimum distance line (xi-1 axis) to origin of ith joint frame measured along zi axis. αi = angle between zi and zi-1 measured about previous joint frame xi-1 axis. θi = angle about zi joint axis which rotates xi-1 to xi axis in right hand sense.
  • 27. Joint Interpolated Motion • Examine each joint for the changes in joint angles. • Estimate the time to accomplish each joint change at the speed setting, given the speed allowables for each joint. • Determine the joint which will take the longest time to accomplish the joint change. • Slow the remaining joints down so that all accomplish their change in the same period. • The joint interpolated setting is usually a number between 0 and 1 which represents the fractional % of full speed for each joint.
  • 28. Example A simple mechanism has two joints described as follows: Joint 1: Joint 2: Type = Prismatic (sliding) Type = Revolute (rotational) Joint speed maximum = 100 mm/s Joint speed maximum = 180˚/s If the robot joint speed setting is set to 50%, then approximate the time to move from a configuration of 20 mm, 125.3˚ to a configuration of 134.5 mm, 34.5˚, and also determine the joint speeds in doing so. Which joint is controlling the motion and which is following the motion? Neglect the acceleration and deceleration times. Solution:
  • 29. Robot Programming · Teach Pendant · Lead Through · Off-Line · Programming Languages: DARL VAL II RAIL AML KAREL Robpac/C etc.
  • 30. Standards • Robotics Industries Association (RIA) • SME/RI • Typical areas covered: - Definitions such as accuracy/repeatability - Teach pendant safety regulations - Controller wiring
  • 31. Summary •Robotics - integration of computers and controlled mechanisms to make devices re-programmable and versatile. • Modern mathematic representations are used to plan robotic tasks and integrate sensors into the task planning. • There are decided advantages to using robots, namely flexibility and performance quality. • Down side is that robotics effects the labor pool and increases the educational requirements for manufacturing personnel. • Robotics are used in most industries and will be used even more in the decades to come.
  • 32. ThankThank You !!!You !!! For More Information click below link: Follow Us on: http://vibranttechnologies.co.in/robotics-classes-in-mumbai.html