SlideShare a Scribd company logo
Grad Students:
Gaurav Shah
Student Id- 1001152161
Ravikant Kattamudi
Student Id- 1001148933
Instructors :
Dr Dan O Popa
Dr Indika Wijaysinghe
Ball catching manipulator using webcam
using projectile motion
Dept of Electrical engineering – University of Texas at Arlington
5325 - Robotics, Spring15
Introduction:
• This project consists of Ball catching
manipulator in 2D space with 2 Degree of freedom
• It demands a tight interplay of skills in mechanics,
control, planning and visual sensing.
• Manipulator must reach the necessary point in
space and in time
• Ball catching has been used for almost 20 years from
now as a challenging benchmark system to develop
and test robotics key technologies
Steps and Divisions of Project
1. Selection of Manipulator – 2 DOF
2. Inverse kinematics approach in simulation
3. Trajectory generation
4. Estimation of Projectile motion – Selection of
Proper mathematical algorithm
5. Transfering co ordinate frames
6. Parsing Future co-ordinates to Inverse kinematics
7. Webcam based thresholding of Ball (Image
processing)
8. Visual servoing (Future work)
At Last,
(for extra credit)
9 . Experimental Results
(19th slide video)
Block representation – Ball catching manipulator
Selection of Manipulator
• For a simple simulation we have selected 2 DOF manipulator for our project
• To move a robotic arm from one point to another point requires the details of
joint variables.
• Using the Kinematics and Inverse Kinematics the data of the moment of the
arm is found and is implemented to show the pose of the robotic arm
• If the input is obtained (i.e. a point of catching from the trajectory is obtained
from the visual data) the arm positions itself to that point to catch the ball.
Inverse Kinematics approach
• First we define a set of co-ordinates of an end effector to be positioned.
• Applying the inverse kinematics to find out the joint variables of the arm.
• Forward kinematics will have a wide set of solution (since a robot can reach a point in
space in various number of ways)
But as this method gives a single solution for the joint angles this could clear the
confusion in choosing the solution
Inverse Kinematics approach
DH Table
Link a alpha d Theta
1 l1 0 0 Theta1
2 l2 0 0 Thata2
l1,l2 = Lengths of ARM
Theta1, Theta2 = Joint variables WorkSpace @ [180,180]
Last column of the transformation matrix gives position of end effector and inverse
kinematics gives joint variables
Ball Dynamcis : Trajectory Interpretation
• Moving the manipulator arm form some initial position {Ta } to some final desired
position {Tb} going through some Via points
• Trajectory is time history of position, velocity, acceleration
• Important step for path planning and estimation of future points to accurately catch
the ball in 2D space
•Our requirement : Predict the path point BEFORE THE BALL STRIKES TO WORKSPACE
“ Parabolic curve based trajectory is predicted
with recursive least sqaures algorithm”
Projectile Motion
•For modeling of this systems, We first feed manual
initial data – Velocity, height and angle
•This method verifies the estimation we used before we
give actual data from windows webcam
•Terms involved:
--Time of flight
-- Range
-- Velocity Impact
-- Projectile motion equation
Equations for Projectile Motion
Time of Flight
usin(θ) + sqrt(u2 sin2 (θ)-2gh)
_________________________
g
Trajectory Equation
Y = Y0 + ut -1/2(gt2 )
Velocity Impact :
V = sqrt (u2 + 2g*Y )
Timing Calculations
Basic Logical steps for time based dynamics :
Terms : Time of flight (Zero point to zero destination) / end to end
Time to predict the ball path (measured in MATLAB time stamp)
Max time for end effector to reach the ball in trajectory (end effector )
Time taken actually (considering air drag / error / stability / dynamixels
factors)
Example
Time flight : 1.9 second
Prediction time : 0< 0.5 second
Max time for end effector : < 1.4 second
Actual time (depends on practical approach)
Projectile motion for Height = 5 m, Initial V = 8 m/s, Throwing angle = 45
Prediction of Object with least squares approximations
• Real time data are calculated from visual servoing, not
from the manual data
• Path interpretation is carried out by taking the first
few point of the ball path and creating the whole
trajectory (in real time air drag must also be taken into
consideration)
• Initial velocity is known from the distance travelled by
first two points of short distance and the time
difference between two snaps.
• This way, Optimal point derived and manipulator
reaches there before the ball
Object detection using image processing toolbox
Goal : To visually track a Red ball thrown in a region and get XY co-ordinates for
manipulator”
• After literature survey, We focused on color, rather than edges and shapes.
• Also, We worked on RoboRealm robotics animatation software which helped
calibrating the methods needed to detect the red ball
Such as,
•Subtracting gray scale data from original RGB image to get red color detection. But
this covers all red objects in the frame. So we used median filtering followed by
thresholding.
•0.17 value seems to be most accurate thresholding for detecting red colors above 400
pixels
Object detection Algorithm
1. Extracting frames
2. Extracting colour components
3. RGB to grey scale conversion
4. Noise Elimination
5. Elimination of small objects
6. Subtracting background
MATLAB implementation :
Captured 20 frames from infinite frames per trigger, at 30 Hz
Getting X-Y Co-ordinates
Goal : Centroid Analysis
•Identification of bounding box (contour) of desired object
•The area = Count for number of pixels in the tracked bounding box
Centroid is the geometrical center of the bounding box(Inbuilt function).
• Centroid is nothing but X-Y
• Data stored in an Array, which is input for trajectory planning
For example, for 10 frames, Total 10 X- Y co-ordinates are stored in an
array and displayed on the command window.
This data depends on the frame length and centroid.
Visual servoing based
on Jacobian
For example case, When 2D image data used to move 3 D manipulator with 2
webcams….
If u = image coordinates of the head
The angle of the i-th arm is denoted by θi , and the set of these angles by
θ = [θ1, θ2, · · · , ] T
Then
u˙ = Jθ˙
J is the Jacobian between image feature velocities and manipulator joint velocities
Now, for control input from jacobian to match the data from both camera,
θ˙ = λJ T(JJT) −1 (ud − u)
Motion control
For this a computed torque feed forward control in combination with a
decentralized PD controller is used
Feedforward for motion control
Feedback from robot system
Assumption for simplicity :
•No air drag
•Rotational ball velocity = 0
Ref : Koichiro DEGUCHI, Hironari SAKURAI, and Shun’s paper
Transfering frames
(0,0)
Its obvious to transfer the co-ordinates from left most top point of webcam (0,0) to
manipulator axis allocation.
Experimental Results
Alternative methods
•Optimizing prediction by Recursive least square filters OR Kalman filters.
( These methods are dedicated estimations to minimise error in overrated equations of
dynamics of projectile motion)
Holds solutions for linear as well as non linear terms of motion
Train the manipulator
1. The machine uses its cameras to predict the path of a flying object based on imitating
repeated human actions and grab it in less than five hundredths of a second
2. Model Learning and Inference through ANFIS ( adaptive neuro-fuzzy inference system)
Softwares used other then Matlab
1. RoboRealm
Softwares used other then Matlab
2. Robot Analyser
yna
Servo motors in Actual manipulator
Dynamixels AX12
• The AX-12A robot servo has
the ability to track its speed,
temperature, shaft position,
voltage, and load
• Control algorithm allows
you to control the speed and
strength of the motor's
response
Operating V : 12 Volts
Resolution : 0.29 degree
Controller :
USB to
Dynamixels
(Easily
operated
with
Labview)
Limitations of our work
• Because of the time limitations we omitted air drag calculation and object
avoidance in trajectory prediction
• Our focus mainly concentrated between object tracking, trajectory
planning and dynamics of motion for inverse kinematics
• Force and torques are yet to be calculated once optimal models has been
carried out
• This is 2 Dimension, 2 DOF system, which is does not give results in 3D (as
kinect depth sensor gives)
• Needs feed forward loop to better estimate the trajectories
“ We ended our project with experimental simulation and
discussing the future work “
Applications
--Entertainment purpose
- Circus, Ball Juggling
--Sports
--Pick and place machines in SMT manufecturing
--Sorting out objects
-- Industrial application
-Parts insertion in mass production
Conclusion
Learning outcome of this project work is :
We fully understood the concepts of
- Kinematics
- Trajectory generation
- Estimation of Path
- Image processing for visual servoing
-Robotic toolbox
-Basic procedures in n DOF manipulator and their workspace, joint
configuration, applying dynamics equations
Future work
• Implementation of this simulation in Labview controlled Dynamixels arm available in
NGS lab
• Instead of 2D detetction, Detect the ball with Microsoft Kinect along with Depth
sensor for distance measurement and accurate dynamics
• Use of Force / Torque sensors in end effector
• Use of some more precise algorithm for trajectory estimation
• Try Predictive controller – Fuzzy controller
BallCatchingRobot

More Related Content

What's hot

Implementation of PD controller in attitude of quadcopter
Implementation of PD controller in attitude of quadcopterImplementation of PD controller in attitude of quadcopter
Implementation of PD controller in attitude of quadcopterTack-geun You
 
COM2304: Intensity Transformation and Spatial Filtering – I (Intensity Transf...
COM2304: Intensity Transformation and Spatial Filtering – I (Intensity Transf...COM2304: Intensity Transformation and Spatial Filtering – I (Intensity Transf...
COM2304: Intensity Transformation and Spatial Filtering – I (Intensity Transf...Hemantha Kulathilake
 
3.point operation and histogram based image enhancement
3.point operation and histogram based image enhancement3.point operation and histogram based image enhancement
3.point operation and histogram based image enhancementmukesh bhardwaj
 
motion and feature based person tracking in survillance videos
motion and feature based person tracking in survillance videosmotion and feature based person tracking in survillance videos
motion and feature based person tracking in survillance videosshiva kumar cheruku
 
COM2304: Intensity Transformation and Spatial Filtering – II Spatial Filterin...
COM2304: Intensity Transformation and Spatial Filtering – II Spatial Filterin...COM2304: Intensity Transformation and Spatial Filtering – II Spatial Filterin...
COM2304: Intensity Transformation and Spatial Filtering – II Spatial Filterin...Hemantha Kulathilake
 
Actuator Constrained Optimal Control of Formations Near the Libration Points
Actuator Constrained Optimal Control of Formations Near the Libration PointsActuator Constrained Optimal Control of Formations Near the Libration Points
Actuator Constrained Optimal Control of Formations Near the Libration PointsBelinda Marchand
 
MTG-INRPS final presentation
MTG-INRPS final presentationMTG-INRPS final presentation
MTG-INRPS final presentationpjjurado
 
Intensity Transformation
Intensity TransformationIntensity Transformation
Intensity TransformationAmnaakhaan
 
Design and Implementation of Parallel and Randomized Approximation Algorithms
Design and Implementation of Parallel and Randomized Approximation AlgorithmsDesign and Implementation of Parallel and Randomized Approximation Algorithms
Design and Implementation of Parallel and Randomized Approximation AlgorithmsAjay Bidyarthy
 
Nonlinear combination of intensity measures for response prediction of RC bui...
Nonlinear combination of intensity measures for response prediction of RC bui...Nonlinear combination of intensity measures for response prediction of RC bui...
Nonlinear combination of intensity measures for response prediction of RC bui...openseesdays
 
Building 3D Morphable Models from 2D Images
Building 3D Morphable Models from 2D ImagesBuilding 3D Morphable Models from 2D Images
Building 3D Morphable Models from 2D ImagesShanglin Yang
 
Moving vehicle detection from Videos
Moving vehicle detection from VideosMoving vehicle detection from Videos
Moving vehicle detection from VideosPRIYANK BHARDWAJ
 
Comparative analysis of multi stage cordic using micro rotation technique
Comparative analysis of multi stage cordic using micro rotation techniqueComparative analysis of multi stage cordic using micro rotation technique
Comparative analysis of multi stage cordic using micro rotation techniqueIAEME Publication
 

What's hot (20)

Article 1
Article 1Article 1
Article 1
 
Tracking[1]
Tracking[1]Tracking[1]
Tracking[1]
 
Background subtraction
Background subtractionBackground subtraction
Background subtraction
 
Implementation of PD controller in attitude of quadcopter
Implementation of PD controller in attitude of quadcopterImplementation of PD controller in attitude of quadcopter
Implementation of PD controller in attitude of quadcopter
 
COM2304: Intensity Transformation and Spatial Filtering – I (Intensity Transf...
COM2304: Intensity Transformation and Spatial Filtering – I (Intensity Transf...COM2304: Intensity Transformation and Spatial Filtering – I (Intensity Transf...
COM2304: Intensity Transformation and Spatial Filtering – I (Intensity Transf...
 
Unsupervised learning networks
Unsupervised learning networksUnsupervised learning networks
Unsupervised learning networks
 
3.point operation and histogram based image enhancement
3.point operation and histogram based image enhancement3.point operation and histogram based image enhancement
3.point operation and histogram based image enhancement
 
motion and feature based person tracking in survillance videos
motion and feature based person tracking in survillance videosmotion and feature based person tracking in survillance videos
motion and feature based person tracking in survillance videos
 
COM2304: Intensity Transformation and Spatial Filtering – II Spatial Filterin...
COM2304: Intensity Transformation and Spatial Filtering – II Spatial Filterin...COM2304: Intensity Transformation and Spatial Filtering – II Spatial Filterin...
COM2304: Intensity Transformation and Spatial Filtering – II Spatial Filterin...
 
N045077984
N045077984N045077984
N045077984
 
Actuator Constrained Optimal Control of Formations Near the Libration Points
Actuator Constrained Optimal Control of Formations Near the Libration PointsActuator Constrained Optimal Control of Formations Near the Libration Points
Actuator Constrained Optimal Control of Formations Near the Libration Points
 
MTG-INRPS final presentation
MTG-INRPS final presentationMTG-INRPS final presentation
MTG-INRPS final presentation
 
paper
paperpaper
paper
 
Intensity Transformation
Intensity TransformationIntensity Transformation
Intensity Transformation
 
Design and Implementation of Parallel and Randomized Approximation Algorithms
Design and Implementation of Parallel and Randomized Approximation AlgorithmsDesign and Implementation of Parallel and Randomized Approximation Algorithms
Design and Implementation of Parallel and Randomized Approximation Algorithms
 
Nonlinear combination of intensity measures for response prediction of RC bui...
Nonlinear combination of intensity measures for response prediction of RC bui...Nonlinear combination of intensity measures for response prediction of RC bui...
Nonlinear combination of intensity measures for response prediction of RC bui...
 
Building 3D Morphable Models from 2D Images
Building 3D Morphable Models from 2D ImagesBuilding 3D Morphable Models from 2D Images
Building 3D Morphable Models from 2D Images
 
Moving vehicle detection from Videos
Moving vehicle detection from VideosMoving vehicle detection from Videos
Moving vehicle detection from Videos
 
Comparative analysis of multi stage cordic using micro rotation technique
Comparative analysis of multi stage cordic using micro rotation techniqueComparative analysis of multi stage cordic using micro rotation technique
Comparative analysis of multi stage cordic using micro rotation technique
 
Ax03303120316
Ax03303120316Ax03303120316
Ax03303120316
 

Similar to BallCatchingRobot

Design, analysis and controlling of an offshore load transfer system Dimuthu ...
Design, analysis and controlling of an offshore load transfer system Dimuthu ...Design, analysis and controlling of an offshore load transfer system Dimuthu ...
Design, analysis and controlling of an offshore load transfer system Dimuthu ...Dimuthu Darshana
 
Presentation Object Recognition And Tracking Project
Presentation Object Recognition And Tracking ProjectPresentation Object Recognition And Tracking Project
Presentation Object Recognition And Tracking ProjectPrathamesh Joshi
 
4.3 real time game physics
4.3 real time game physics4.3 real time game physics
4.3 real time game physicsSayed Ahmed
 
208114036 l aser guided robo
208114036 l aser guided robo208114036 l aser guided robo
208114036 l aser guided roboChiranjeevi Manda
 
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
 
IRJET - Radius Approach for Inverse Kinematics of 4-R Manipulator in Spatial ...
IRJET - Radius Approach for Inverse Kinematics of 4-R Manipulator in Spatial ...IRJET - Radius Approach for Inverse Kinematics of 4-R Manipulator in Spatial ...
IRJET - Radius Approach for Inverse Kinematics of 4-R Manipulator in Spatial ...IRJET Journal
 
Intelligent Control Systems for Humanoid Robot: Master Thesis_Owen Chih-Hsuan...
Intelligent Control Systems for Humanoid Robot: Master Thesis_Owen Chih-Hsuan...Intelligent Control Systems for Humanoid Robot: Master Thesis_Owen Chih-Hsuan...
Intelligent Control Systems for Humanoid Robot: Master Thesis_Owen Chih-Hsuan...Owen (Chih-Hsuan) Chen
 
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
 
iv10_linear_pose.pptx
iv10_linear_pose.pptxiv10_linear_pose.pptx
iv10_linear_pose.pptxdarmadi ir,mm
 
Fuzzy-proportional-integral-derivative-based controller for object tracking i...
Fuzzy-proportional-integral-derivative-based controller for object tracking i...Fuzzy-proportional-integral-derivative-based controller for object tracking i...
Fuzzy-proportional-integral-derivative-based controller for object tracking i...IJECEIAES
 
[8] implementation of pmsm servo drive using digital signal processing
[8] implementation of pmsm servo drive using digital signal processing[8] implementation of pmsm servo drive using digital signal processing
[8] implementation of pmsm servo drive using digital signal processingNgoc Dinh
 
Simulation design of trajectory planning robot manipulator
Simulation design of trajectory planning robot manipulatorSimulation design of trajectory planning robot manipulator
Simulation design of trajectory planning robot manipulatorjournalBEEI
 
Embedded Programming for Quadcopters
Embedded Programming for QuadcoptersEmbedded Programming for Quadcopters
Embedded Programming for QuadcoptersRyan Boland
 
Stabilization of Six-Legged Robot on Tilt Surface With 9 DOF IMU Based on Inv...
Stabilization of Six-Legged Robot on Tilt Surface With 9 DOF IMU Based on Inv...Stabilization of Six-Legged Robot on Tilt Surface With 9 DOF IMU Based on Inv...
Stabilization of Six-Legged Robot on Tilt Surface With 9 DOF IMU Based on Inv...IJRES Journal
 
Post mission analysis noise reduction
Post mission analysis noise reductionPost mission analysis noise reduction
Post mission analysis noise reductionrohit baghel
 
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
 

Similar to BallCatchingRobot (20)

Design, analysis and controlling of an offshore load transfer system Dimuthu ...
Design, analysis and controlling of an offshore load transfer system Dimuthu ...Design, analysis and controlling of an offshore load transfer system Dimuthu ...
Design, analysis and controlling of an offshore load transfer system Dimuthu ...
 
Presentation Object Recognition And Tracking Project
Presentation Object Recognition And Tracking ProjectPresentation Object Recognition And Tracking Project
Presentation Object Recognition And Tracking Project
 
4.3 real time game physics
4.3 real time game physics4.3 real time game physics
4.3 real time game physics
 
208114036 l aser guided robo
208114036 l aser guided robo208114036 l aser guided robo
208114036 l aser guided robo
 
Robotics - introduction to Robotics
Robotics -  introduction to Robotics  Robotics -  introduction to Robotics
Robotics - introduction to Robotics
 
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...
 
IRJET - Radius Approach for Inverse Kinematics of 4-R Manipulator in Spatial ...
IRJET - Radius Approach for Inverse Kinematics of 4-R Manipulator in Spatial ...IRJET - Radius Approach for Inverse Kinematics of 4-R Manipulator in Spatial ...
IRJET - Radius Approach for Inverse Kinematics of 4-R Manipulator in Spatial ...
 
Robotics Localization
Robotics LocalizationRobotics Localization
Robotics Localization
 
Smart Room Gesture Control
Smart Room Gesture ControlSmart Room Gesture Control
Smart Room Gesture Control
 
Intelligent Control Systems for Humanoid Robot: Master Thesis_Owen Chih-Hsuan...
Intelligent Control Systems for Humanoid Robot: Master Thesis_Owen Chih-Hsuan...Intelligent Control Systems for Humanoid Robot: Master Thesis_Owen Chih-Hsuan...
Intelligent Control Systems for Humanoid Robot: Master Thesis_Owen Chih-Hsuan...
 
Outline
OutlineOutline
Outline
 
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...
 
iv10_linear_pose.pptx
iv10_linear_pose.pptxiv10_linear_pose.pptx
iv10_linear_pose.pptx
 
Fuzzy-proportional-integral-derivative-based controller for object tracking i...
Fuzzy-proportional-integral-derivative-based controller for object tracking i...Fuzzy-proportional-integral-derivative-based controller for object tracking i...
Fuzzy-proportional-integral-derivative-based controller for object tracking i...
 
[8] implementation of pmsm servo drive using digital signal processing
[8] implementation of pmsm servo drive using digital signal processing[8] implementation of pmsm servo drive using digital signal processing
[8] implementation of pmsm servo drive using digital signal processing
 
Simulation design of trajectory planning robot manipulator
Simulation design of trajectory planning robot manipulatorSimulation design of trajectory planning robot manipulator
Simulation design of trajectory planning robot manipulator
 
Embedded Programming for Quadcopters
Embedded Programming for QuadcoptersEmbedded Programming for Quadcopters
Embedded Programming for Quadcopters
 
Stabilization of Six-Legged Robot on Tilt Surface With 9 DOF IMU Based on Inv...
Stabilization of Six-Legged Robot on Tilt Surface With 9 DOF IMU Based on Inv...Stabilization of Six-Legged Robot on Tilt Surface With 9 DOF IMU Based on Inv...
Stabilization of Six-Legged Robot on Tilt Surface With 9 DOF IMU Based on Inv...
 
Post mission analysis noise reduction
Post mission analysis noise reductionPost mission analysis noise reduction
Post mission analysis noise reduction
 
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
 

BallCatchingRobot

  • 1. Grad Students: Gaurav Shah Student Id- 1001152161 Ravikant Kattamudi Student Id- 1001148933 Instructors : Dr Dan O Popa Dr Indika Wijaysinghe Ball catching manipulator using webcam using projectile motion Dept of Electrical engineering – University of Texas at Arlington 5325 - Robotics, Spring15
  • 2. Introduction: • This project consists of Ball catching manipulator in 2D space with 2 Degree of freedom • It demands a tight interplay of skills in mechanics, control, planning and visual sensing. • Manipulator must reach the necessary point in space and in time • Ball catching has been used for almost 20 years from now as a challenging benchmark system to develop and test robotics key technologies
  • 3. Steps and Divisions of Project 1. Selection of Manipulator – 2 DOF 2. Inverse kinematics approach in simulation 3. Trajectory generation 4. Estimation of Projectile motion – Selection of Proper mathematical algorithm 5. Transfering co ordinate frames 6. Parsing Future co-ordinates to Inverse kinematics 7. Webcam based thresholding of Ball (Image processing) 8. Visual servoing (Future work)
  • 4. At Last, (for extra credit) 9 . Experimental Results (19th slide video)
  • 5. Block representation – Ball catching manipulator
  • 6. Selection of Manipulator • For a simple simulation we have selected 2 DOF manipulator for our project • To move a robotic arm from one point to another point requires the details of joint variables. • Using the Kinematics and Inverse Kinematics the data of the moment of the arm is found and is implemented to show the pose of the robotic arm • If the input is obtained (i.e. a point of catching from the trajectory is obtained from the visual data) the arm positions itself to that point to catch the ball.
  • 7. Inverse Kinematics approach • First we define a set of co-ordinates of an end effector to be positioned. • Applying the inverse kinematics to find out the joint variables of the arm. • Forward kinematics will have a wide set of solution (since a robot can reach a point in space in various number of ways) But as this method gives a single solution for the joint angles this could clear the confusion in choosing the solution
  • 8. Inverse Kinematics approach DH Table Link a alpha d Theta 1 l1 0 0 Theta1 2 l2 0 0 Thata2 l1,l2 = Lengths of ARM Theta1, Theta2 = Joint variables WorkSpace @ [180,180] Last column of the transformation matrix gives position of end effector and inverse kinematics gives joint variables
  • 9. Ball Dynamcis : Trajectory Interpretation • Moving the manipulator arm form some initial position {Ta } to some final desired position {Tb} going through some Via points • Trajectory is time history of position, velocity, acceleration • Important step for path planning and estimation of future points to accurately catch the ball in 2D space •Our requirement : Predict the path point BEFORE THE BALL STRIKES TO WORKSPACE “ Parabolic curve based trajectory is predicted with recursive least sqaures algorithm”
  • 10. Projectile Motion •For modeling of this systems, We first feed manual initial data – Velocity, height and angle •This method verifies the estimation we used before we give actual data from windows webcam •Terms involved: --Time of flight -- Range -- Velocity Impact -- Projectile motion equation
  • 11. Equations for Projectile Motion Time of Flight usin(θ) + sqrt(u2 sin2 (θ)-2gh) _________________________ g Trajectory Equation Y = Y0 + ut -1/2(gt2 ) Velocity Impact : V = sqrt (u2 + 2g*Y )
  • 12. Timing Calculations Basic Logical steps for time based dynamics : Terms : Time of flight (Zero point to zero destination) / end to end Time to predict the ball path (measured in MATLAB time stamp) Max time for end effector to reach the ball in trajectory (end effector ) Time taken actually (considering air drag / error / stability / dynamixels factors) Example Time flight : 1.9 second Prediction time : 0< 0.5 second Max time for end effector : < 1.4 second Actual time (depends on practical approach)
  • 13. Projectile motion for Height = 5 m, Initial V = 8 m/s, Throwing angle = 45 Prediction of Object with least squares approximations
  • 14. • Real time data are calculated from visual servoing, not from the manual data • Path interpretation is carried out by taking the first few point of the ball path and creating the whole trajectory (in real time air drag must also be taken into consideration) • Initial velocity is known from the distance travelled by first two points of short distance and the time difference between two snaps. • This way, Optimal point derived and manipulator reaches there before the ball
  • 15. Object detection using image processing toolbox Goal : To visually track a Red ball thrown in a region and get XY co-ordinates for manipulator” • After literature survey, We focused on color, rather than edges and shapes. • Also, We worked on RoboRealm robotics animatation software which helped calibrating the methods needed to detect the red ball Such as, •Subtracting gray scale data from original RGB image to get red color detection. But this covers all red objects in the frame. So we used median filtering followed by thresholding. •0.17 value seems to be most accurate thresholding for detecting red colors above 400 pixels
  • 16. Object detection Algorithm 1. Extracting frames 2. Extracting colour components 3. RGB to grey scale conversion 4. Noise Elimination 5. Elimination of small objects 6. Subtracting background MATLAB implementation : Captured 20 frames from infinite frames per trigger, at 30 Hz
  • 17. Getting X-Y Co-ordinates Goal : Centroid Analysis •Identification of bounding box (contour) of desired object •The area = Count for number of pixels in the tracked bounding box Centroid is the geometrical center of the bounding box(Inbuilt function). • Centroid is nothing but X-Y • Data stored in an Array, which is input for trajectory planning For example, for 10 frames, Total 10 X- Y co-ordinates are stored in an array and displayed on the command window. This data depends on the frame length and centroid.
  • 18. Visual servoing based on Jacobian For example case, When 2D image data used to move 3 D manipulator with 2 webcams…. If u = image coordinates of the head The angle of the i-th arm is denoted by θi , and the set of these angles by θ = [θ1, θ2, · · · , ] T Then u˙ = Jθ˙ J is the Jacobian between image feature velocities and manipulator joint velocities Now, for control input from jacobian to match the data from both camera, θ˙ = λJ T(JJT) −1 (ud − u)
  • 19. Motion control For this a computed torque feed forward control in combination with a decentralized PD controller is used Feedforward for motion control Feedback from robot system Assumption for simplicity : •No air drag •Rotational ball velocity = 0 Ref : Koichiro DEGUCHI, Hironari SAKURAI, and Shun’s paper
  • 20. Transfering frames (0,0) Its obvious to transfer the co-ordinates from left most top point of webcam (0,0) to manipulator axis allocation.
  • 22. Alternative methods •Optimizing prediction by Recursive least square filters OR Kalman filters. ( These methods are dedicated estimations to minimise error in overrated equations of dynamics of projectile motion) Holds solutions for linear as well as non linear terms of motion Train the manipulator 1. The machine uses its cameras to predict the path of a flying object based on imitating repeated human actions and grab it in less than five hundredths of a second 2. Model Learning and Inference through ANFIS ( adaptive neuro-fuzzy inference system)
  • 23. Softwares used other then Matlab 1. RoboRealm
  • 24. Softwares used other then Matlab 2. Robot Analyser
  • 25. yna Servo motors in Actual manipulator Dynamixels AX12 • The AX-12A robot servo has the ability to track its speed, temperature, shaft position, voltage, and load • Control algorithm allows you to control the speed and strength of the motor's response Operating V : 12 Volts Resolution : 0.29 degree Controller : USB to Dynamixels (Easily operated with Labview)
  • 26. Limitations of our work • Because of the time limitations we omitted air drag calculation and object avoidance in trajectory prediction • Our focus mainly concentrated between object tracking, trajectory planning and dynamics of motion for inverse kinematics • Force and torques are yet to be calculated once optimal models has been carried out • This is 2 Dimension, 2 DOF system, which is does not give results in 3D (as kinect depth sensor gives) • Needs feed forward loop to better estimate the trajectories “ We ended our project with experimental simulation and discussing the future work “
  • 27. Applications --Entertainment purpose - Circus, Ball Juggling --Sports --Pick and place machines in SMT manufecturing --Sorting out objects -- Industrial application -Parts insertion in mass production
  • 28. Conclusion Learning outcome of this project work is : We fully understood the concepts of - Kinematics - Trajectory generation - Estimation of Path - Image processing for visual servoing -Robotic toolbox -Basic procedures in n DOF manipulator and their workspace, joint configuration, applying dynamics equations
  • 29. Future work • Implementation of this simulation in Labview controlled Dynamixels arm available in NGS lab • Instead of 2D detetction, Detect the ball with Microsoft Kinect along with Depth sensor for distance measurement and accurate dynamics • Use of Force / Torque sensors in end effector • Use of some more precise algorithm for trajectory estimation • Try Predictive controller – Fuzzy controller