SlideShare a Scribd company logo
1 of 4
Download to read offline
Michelangelo: A 3-DOF Sketching Robot

                           Ravi Sankar Ippili, Uttam Grandhi, Dr. B.K. Raut, Dr. R.K. Mittal
                                               Mechanical Engineering Group
                                 Birla Institute of Technology and Science (BITS) -Pilani
                                                  Pilani, Rajasthan, INDIA
           ravi.sankar.ippili@gmail.com, uttam.grandhi@gmail.com, rout@bits-pilani.ac.in, rkm@bits-pilani.ac.in

Abstract— This paper presents an indigenously developed           real-time and is interactive. It uses existing tools for image
artbot capable of drawing complex images. The innovativeness      processing, robot control and object manipulation.
lies in the capacity to draw images with multiple gray values.    Sketching complex objects requires human-specific skills,
The robot possesses a tool magazine that holds pencils of         and is thus a challenge for robots.
varying shades of gray. The controller chooses the type of
pencil based on the intensity levels of each gray pixel.
                                                                     The rest of the paper is organized as follows: Section II
Geometric transformations like scaling and rotation can be        presents the system set-up and the tools used. Section III
performed on the image before drawing. To enhance the             presents the strategy used to realize human-like drawing of
characteristics of the image available image processing           images. Section IV discusses the image acquisition, image
algorithms are used. A GUI is developed with minimal buttons      conversion, image preprocessing, threshold determination,
to enable easy interaction with the robot. The simple yet         image binarization and inverse kinematics. Section V
efficient software and hardware design makes it a unique          discusses the results and shows the possible extensions of
sketching robot.                                                  the system.
                       I.    INTRODUCTION                                             II.    EXPERIMENTAL SET-UP
    Art surrounds us everywhere. It has become so
inevitable that even technical fields were also influenced by     A. Overview
it. Robotics is a field that clearly signifies such an effect.
                                                                      The 3-DOF model of the sketching robot is made with
Growing interest to keep robots as sources of entertainment       the use of 4 servo actuators (ROBOTIS AX-12). 2-DOF are
resulted in a new field of robotics, ‘artbots’. Robots that can   used to sweep the area on the paper. The other 1-DOF is
imitate humans in the true sense of an artist have always         used to implement pen-up and pen-down states. The
been a fascination to all age groups.                             actuators have torque-bearing capacity of 12 kgf.cm at 7 V
    During the last decade, various models of sketching           and 16.5 kgf.cm at 10 V. The holding brackets were modeled
robots have been developed that can draw pictures. They           using PRO-E and were manufactured with fused deposition
function similar to a printer that prints sequentially line by    modeling machine. The algorithms extract contours from the
line and hence, lack the dexterity of a human artist. These       image using some edge detection techniques developed by
models also fail to emulate a scene accurately as a fixed end     Canny [3]. The end-effector is equipped with a magazine
effector, usually a pencil or a pen, is used to represent         with a maximum capacity of 4 pencils to portray various
various gray levels in an image. Sketching Robots that have       gray level values in the image. The actuators are connected
been developed recently lack the portability and simplicity       in a daisy chain mechanism and interfaced through a USB
[1], [5], [6]. These robots sketch portraits only with a single   port with the computer. The Graphical User Interface was
color. This motivated us to develop a robot which is              developed using Visual Basic. The instruction packets were
compact in size, user friendly and a source of entertainment.     constructed by the controller and sent to the actuators for
We have also incorporated multi shades of gray in our             execution.
model. Further, the graffiti output device [4] that has been
developed for sketching involves the use of ink, which has
an inconvenience of drying the portrait once it is drawn.
This suggested us to use pencils and thus enabling the user
to access the drawn figure immediately.
    In this paper, we present the design of a 3-DOF
sketching robot that sketches the picture by using a novel
contour extraction algorithm and a tool magazine that can
hold pencils of varying darkness to represent multiple gray
levels in the image. The behavior of the robot resembles that
of an artist, who would, first, analyze the object, and then,     Figure 1: Photograph of the Michelangelo developed showing the magazine
draw the image on a piece of paper. The application runs in                                    with four pencils
III.   STRATEGY                             B. Image Conversion
    The sketcher traces the contour of a given image by                The image acquired in previous step is transformed to a
joining all the scattered dots with pen-up and pen-down            desired format to perform various operations on it. The
states. Depending on the desired range of the sketcher a           image is initially in JPEG format. It is converted to PGM
“Reachable Work Space (RWS)” has been fixed. RWS is the            (Portable Gray Map) format using image processing tool
area between two semi circles obtained by the extreme              box inbuilt in MATLAB. The inbuilt function used to
configurations of the sketcher. In the arm, 1-DOF is used for      achieve this is rgb2gray. The function converts RGB
pen up and pen down, while the other DOF are used to               images to grayscale by eliminating the hue and saturation
traverse a plane. The robot is controlled by an algorithm          information while retaining the luminance. For each pixel in
developed that optimizes the total distance traveled by the
                                                                   the image the luminance value L ∈ {0,1,...255} . The
end effector, thus accomplishing the task in minimum time.
The image to be processed is loaded through a GUI and              luminance values 0 and 255 correspond to black and white
converted to a desired format using the inbuilt functions of       colors respectively.
MATLAB. Inverse Kinematics is implemented for the 2-
                                                                   C. Image Preprocessing
DOF planar arm to find the joint parameters. Since a 2-DOF
manipulator can reach any point on a plane in two different             The digital image acquired is prone to a variety of types
arm orientations, a procedure has been devised to choose           of noise. There are several ways that noise can be
suitable and feasible orientation. Using the positions and         introduced into an image, depending on how the image is
speeds of all the actuators instruction packets are constructed    created. We have implemented some of the noise reduction
by the software. These instructions packets are sent to the        algorithms provided in the Image processing toolbox.
actuators connected in daisy chain through USB interface, to            One of the most common types of noise, Salt and Pepper
draw the image                                                     noise, typically seen on images, represents itself as randomly
                                                                   occurring white and black pixels. An effective noise
                                                                   reduction method for this type of noise involves the use of
                                                                   median filter. Median filter is applied using medfilt2 function
                                                                   of the toolbox. The function performs two dimensional
                                                                   median filtering. Median filtering, unlike linear filtering,
                                                                   besides removing noise it also preserves edges of the image,
                                     ARM 2                         thus manifesting itself as an effective image enhancement
                                                                   filter.

                                                                   D. Determination of Threshold
                                                                       The threshold for the processed image is determined
                                                                   using gray level histograms and inbuilt functions of
                                                                   MATLAB. The inbuilt function graythresh computes the
                                    ARM1                           global threshold of the image using Otsu’s method [2]. The
                                                                   image retains all the important characteristics and has an
                                                                   esthetic look. Besides this technique, various gray level
                                                                   histograms were plotted to determine the threshold based on
                               REVOLUTE                            the frequency scatter of the gray values.
         RWS                                            LINKS
                                 JOINTS

                                                                   E. Image Binarization
             Figure 2: Reachable Work Space of Michelangelo            For each pixel in the image, the luminance
                                                                    L ∈ {0,1,....255} is transformed to either 0 or 1. The
                 IV.    DATA PROCESSING                            algorithm converts the image to a binary representation that
                                                                   can be drawn by the robot using pencils on white paper. The
A. Image Acquisition                                               threshold determined in the previous step is used to achieve
    This is the first and the foremost step which forms the        this.
basis for the remaining phases of data processing. We have         F. Inverse Kinematics
used a CCD based image sensor for image acquisition. The
reason we have chosen CCD sensors over CMOS sensors is                 Inverse kinematics algorithms were run to compute joint
their ability to create high quality, low noise images. The        angle parameters from the Cartesian coordinates of the 2
picture of desired object is taken by placing it in front of the   DOF planar RR arm configuration. Every point             on
image sensor. The lighting conditions are maintained same          the RWS can be reached by the end effector in two different
for all the pictures taken to provide similar ambience in the      arm orientations. Taking into consideration various
scene.                                                             mechanical constraints associated with the manipulator, a
particular arm orientation was chosen. Some of the                                     As we see from the test figures (Fig. 4.), lines are not
important equations used in the development of inverse                              smooth and straight. It is mainly due to errors in the model
kinematics module are as follows:                                                   of the robot used during the inverse-kinematics process.
                                                                                    More specifically, the position of the pencil is supposed to
                                                                                    be fixed, but this can also slightly change during the
                                                                             (1)    drawing. Errors are also introduced in the set-up (e.g. if the
                                                                                    links are not properly clamped.).
                                                                                       Each step of the whole process can be monitored and
                                                                             (2)    controlled visually, and parameters can be changed online,
                                                                                    if desired. However, the application is created to run
                                                                                    without the intervention of the user. The whole process is
                                                                             (3)    fast: the image processing part and inverse kinematics take
                                                                                    only a few seconds, and the drawing takes less than 10
                                                                                    minutes. A similar portrait sketched by a human would
Where,                                                                              clearly take more time to draw.
                                                                                       In further work, we plan to add more interactive
      , are the abscissa and the ordinate of a point in RWS,                        behaviors to the robot. E.g. the robot may ask the user
     is the absolute distance of          from the origin,                          whether he/she would like to have some more personalized
                                                                                    addition be made to the drawing. We are in the process of
         are the link parameters of the manipulator, and                            incorporating stereoscopic vision system, which could be
         are the joint parameters of the manipulator.                               used to implement robust object tracking.
                                                                                       The process of transforming the image in a black & white
                                                                                    representation could be improved in many ways. For
                                                                                    instance, in thresholding process, other criteria such as a
                                                                                    solidity measure could be considered, to better distinguish
                                                                                    the object features. Solidity is a measure of a surface divided
                                                                                    by the convex surface surrounding the group of pixels. It
                                                                                    could, then, be possible to detect if multiple features are
                                                                                    merged together, resulting in non-convex areas.

a)                          b)                            c)




                                                                                          1                               2



d)                          e)                            f)


 Figure 3: Human Face. Images drawn with decreasing gray scale values. a),
 b), c) correspond to gray levels 200, 128 and 0 respectively. d), e), f) are the
           corresponding images drawn with HB, 4B and 6B pencils.


     V.   RESULTS, DISCUSSION AND FURTHER WORK
   Some results are presented in Fig. 3 and 4, which are scan                         3                               4
of sketches drawn by Michelangelo. Sketching continuous
line drawing images (Fig 3.) is not an easy task, even for                            Figure 4: Test Figures. Images drawn by the robot range from simple
humans. Here, the robot performs this task skillfully. By                                  geometries (1) to medium (2) and complex figures(3 &,4).
planning a smooth trajectory, controlling the speed and
acceleration of the arm, the manipulator deftly sketches the
image.
TABLE I.      COMPARISION BETWEEN DIFFERENT TEST FIGURES     second, it highlights the potential of sketching robots as
      Image           Image Complexity         Time Taken [min.]
                                                                   source of entertainment.

      Circle                  Low                      0.66
                                                                                                 REFERENCES
       Car                  Medium                       4         [1]  Sylvain Calinon, Julien Epiney and Aude Billard, “A humanoid robot
                                                                        drawing human portraits", EPFL, Switzerland
    Human face              Medium                       6
                                                                   [2] Otsu, N., "A Threshold Selection Method from Gray-Level
       Duck                  High                        7              Histograms," IEEE Transactions on Systems, Man, and Cybernetics,
                                                                        Vol. 9, No. 1, 1979, pp. 62-66
                                                                   [3] J. Canny, “A computational approach to edge detection,” IEEE
                                                                        Trans.Pattern Analysis and Machine Intelligence, vol. 8, no. 6, pp.
                      VI.     CONCLUSION                                679–698, 1986.
    This paper presented a simple realization of a robot           [4] J. Lehni, “Hektor: a graffiti output device,” 2002, diploma project at
capable of sketching complex objects. We have used novel                the Ecole Cantonale d’Art de Lausanne. Available at
methods to realize a sketch with multiple gray shades and               http://www.hektor.ch.
developed a lucid user interface to reduce unwanted user           [5] M. Gommel, M. Haitz, and J. Zappe, “Robotlab autoportrait project:
interference. The contribution of this work to art robots is            Human portraits drawn by a robot,” 2004, center for Art and Media
two-fold: first, it demonstrates how image processing              Karlsruhe. Available at http://www.robotlab.de.
techniques and classical inverse kinematics algorithms can         [6] M. Stein and C. Madden, “The pumapaint project: Long term usage
be tuned to endow an artbot with human-like competencies;               trends and the move to three dimensions,” in Proceedings of the
                                                                        IEEE Intl Conference on Robotics and Automation (ICRA),
                                                                        Barcelona, Spain,April 18-22 200

More Related Content

What's hot

Image processing fundamentals
Image processing fundamentalsImage processing fundamentals
Image processing fundamentalsA B Shinde
 
Advanced animation techniques
Advanced animation techniquesAdvanced animation techniques
Advanced animation techniquesCharles Flynt
 
Animation techniques for CG students
Animation techniques for CG studentsAnimation techniques for CG students
Animation techniques for CG studentsMahith
 
Introduction to computer graphics part 1
Introduction to computer graphics part 1Introduction to computer graphics part 1
Introduction to computer graphics part 1Ankit Garg
 
Image Processing
Image ProcessingImage Processing
Image ProcessingRolando
 
IMAGE PROCESSING - MATHANKUMAR.S - VMKVEC
IMAGE PROCESSING - MATHANKUMAR.S - VMKVECIMAGE PROCESSING - MATHANKUMAR.S - VMKVEC
IMAGE PROCESSING - MATHANKUMAR.S - VMKVECMathankumar S
 
SIXTH SENCE TECHNOLOGY
SIXTH SENCE TECHNOLOGYSIXTH SENCE TECHNOLOGY
SIXTH SENCE TECHNOLOGYGp
 
Image compression standards
Image compression standardsImage compression standards
Image compression standardskirupasuchi1996
 
Image processing and compression techniques
Image processing and compression techniquesImage processing and compression techniques
Image processing and compression techniquesAshwin Venkataraman
 
Particle filter and cam shift approach for motion detection
Particle filter and cam shift approach for motion detectionParticle filter and cam shift approach for motion detection
Particle filter and cam shift approach for motion detectionkalyanibedekar
 
Graphics pipelining
Graphics pipeliningGraphics pipelining
Graphics pipeliningAreena Javed
 
Introduction to Digital Image Processing Using MATLAB
Introduction to Digital Image Processing Using MATLABIntroduction to Digital Image Processing Using MATLAB
Introduction to Digital Image Processing Using MATLABRay Phan
 

What's hot (20)

Image processing fundamentals
Image processing fundamentalsImage processing fundamentals
Image processing fundamentals
 
Advanced animation techniques
Advanced animation techniquesAdvanced animation techniques
Advanced animation techniques
 
Animation techniques for CG students
Animation techniques for CG studentsAnimation techniques for CG students
Animation techniques for CG students
 
Animation
AnimationAnimation
Animation
 
Chapter 1
Chapter 1Chapter 1
Chapter 1
 
Animation
AnimationAnimation
Animation
 
Animation
AnimationAnimation
Animation
 
Basic image processing techniques
Basic image processing techniquesBasic image processing techniques
Basic image processing techniques
 
Introduction to computer graphics part 1
Introduction to computer graphics part 1Introduction to computer graphics part 1
Introduction to computer graphics part 1
 
Image Processing
Image ProcessingImage Processing
Image Processing
 
IMAGE PROCESSING - MATHANKUMAR.S - VMKVEC
IMAGE PROCESSING - MATHANKUMAR.S - VMKVECIMAGE PROCESSING - MATHANKUMAR.S - VMKVEC
IMAGE PROCESSING - MATHANKUMAR.S - VMKVEC
 
SIXTH SENCE TECHNOLOGY
SIXTH SENCE TECHNOLOGYSIXTH SENCE TECHNOLOGY
SIXTH SENCE TECHNOLOGY
 
Image compression standards
Image compression standardsImage compression standards
Image compression standards
 
Image processing and compression techniques
Image processing and compression techniquesImage processing and compression techniques
Image processing and compression techniques
 
Ch06
Ch06Ch06
Ch06
 
Dip review
Dip reviewDip review
Dip review
 
Particle filter and cam shift approach for motion detection
Particle filter and cam shift approach for motion detectionParticle filter and cam shift approach for motion detection
Particle filter and cam shift approach for motion detection
 
Graphics pipelining
Graphics pipeliningGraphics pipelining
Graphics pipelining
 
Introduction to Digital Image Processing Using MATLAB
Introduction to Digital Image Processing Using MATLABIntroduction to Digital Image Processing Using MATLAB
Introduction to Digital Image Processing Using MATLAB
 
A0280105
A0280105A0280105
A0280105
 

Viewers also liked

Robotics: 2-Link Planar Manipulator
Robotics: 2-Link Planar ManipulatorRobotics: 2-Link Planar Manipulator
Robotics: 2-Link Planar ManipulatorDamian T. Gordon
 
Robotics: Forward and Inverse Kinematics
Robotics: Forward and Inverse KinematicsRobotics: Forward and Inverse Kinematics
Robotics: Forward and Inverse KinematicsDamian T. Gordon
 
Manipulator kinematics
Manipulator kinematicsManipulator kinematics
Manipulator kinematicsSudhir Reddy
 
Inverse kinematics
Inverse kinematicsInverse kinematics
Inverse kinematicsLINE+
 
Robotics: Introduction to Kinematics
Robotics: Introduction to KinematicsRobotics: Introduction to Kinematics
Robotics: Introduction to KinematicsDamian T. Gordon
 

Viewers also liked (6)

Robotics: 2-Link Planar Manipulator
Robotics: 2-Link Planar ManipulatorRobotics: 2-Link Planar Manipulator
Robotics: 2-Link Planar Manipulator
 
Robotics: Forward and Inverse Kinematics
Robotics: Forward and Inverse KinematicsRobotics: Forward and Inverse Kinematics
Robotics: Forward and Inverse Kinematics
 
Manipulator kinematics
Manipulator kinematicsManipulator kinematics
Manipulator kinematics
 
Bresenham circle
Bresenham circleBresenham circle
Bresenham circle
 
Inverse kinematics
Inverse kinematicsInverse kinematics
Inverse kinematics
 
Robotics: Introduction to Kinematics
Robotics: Introduction to KinematicsRobotics: Introduction to Kinematics
Robotics: Introduction to Kinematics
 

Similar to Michelangelo 3-DOF Sketching Robot Draws Images

Using A Application For A Desktop Application
Using A Application For A Desktop ApplicationUsing A Application For A Desktop Application
Using A Application For A Desktop ApplicationTracy Huang
 
Generic Image Processing With Climb
Generic Image Processing With ClimbGeneric Image Processing With Climb
Generic Image Processing With ClimbLaurent Senta
 
Generic Image Processing With Climb – 5th ELS
Generic Image Processing With Climb – 5th ELSGeneric Image Processing With Climb – 5th ELS
Generic Image Processing With Climb – 5th ELSChristopher Chedeau
 
Digital Image Processing
Digital Image ProcessingDigital Image Processing
Digital Image ProcessingAnkur Nanda
 
Deblurring, Localization and Geometry Correction of 2D QR Bar Codes Using Ric...
Deblurring, Localization and Geometry Correction of 2D QR Bar Codes Using Ric...Deblurring, Localization and Geometry Correction of 2D QR Bar Codes Using Ric...
Deblurring, Localization and Geometry Correction of 2D QR Bar Codes Using Ric...IJERA Editor
 
Paper id 21201419
Paper id 21201419Paper id 21201419
Paper id 21201419IJRAT
 
IRJET- Digital Image Forgery Detection using Local Binary Patterns (LBP) and ...
IRJET- Digital Image Forgery Detection using Local Binary Patterns (LBP) and ...IRJET- Digital Image Forgery Detection using Local Binary Patterns (LBP) and ...
IRJET- Digital Image Forgery Detection using Local Binary Patterns (LBP) and ...IRJET Journal
 
Gesture Recognition Based Mouse Events
Gesture Recognition Based Mouse EventsGesture Recognition Based Mouse Events
Gesture Recognition Based Mouse Eventsijcsit
 
Enhanced Optimization of Edge Detection for High Resolution Images Using Veri...
Enhanced Optimization of Edge Detection for High Resolution Images Using Veri...Enhanced Optimization of Edge Detection for High Resolution Images Using Veri...
Enhanced Optimization of Edge Detection for High Resolution Images Using Veri...ijcisjournal
 
Using Image Acquisition Is The Input Text Document
Using Image Acquisition Is The Input Text DocumentUsing Image Acquisition Is The Input Text Document
Using Image Acquisition Is The Input Text DocumentLisa Williams
 
IRJET - Computer-Assisted ALL, AML, CLL, CML Detection and Counting for D...
IRJET -  	  Computer-Assisted ALL, AML, CLL, CML Detection and Counting for D...IRJET -  	  Computer-Assisted ALL, AML, CLL, CML Detection and Counting for D...
IRJET - Computer-Assisted ALL, AML, CLL, CML Detection and Counting for D...IRJET Journal
 
Camouflage Color Changing Robot For Military Purpose
Camouflage Color Changing Robot For Military PurposeCamouflage Color Changing Robot For Military Purpose
Camouflage Color Changing Robot For Military PurposeHitesh Shinde
 
Camouflage color changing robot for miltary purpose
Camouflage color changing robot for miltary purposeCamouflage color changing robot for miltary purpose
Camouflage color changing robot for miltary purposeAtharvaPathak13
 
A Biometric Approach to Encrypt a File with the Help of Session Key
A Biometric Approach to Encrypt a File with the Help of Session KeyA Biometric Approach to Encrypt a File with the Help of Session Key
A Biometric Approach to Encrypt a File with the Help of Session KeySougata Das
 
Hardware software co simulation of edge detection for image processing system...
Hardware software co simulation of edge detection for image processing system...Hardware software co simulation of edge detection for image processing system...
Hardware software co simulation of edge detection for image processing system...eSAT Publishing House
 
Vhdl implementation for edge detection using log gabor filter for disease det...
Vhdl implementation for edge detection using log gabor filter for disease det...Vhdl implementation for edge detection using log gabor filter for disease det...
Vhdl implementation for edge detection using log gabor filter for disease det...eSAT Journals
 
IRJET- Image Forgery Detection using Support Vector Machine
IRJET- Image Forgery Detection using Support Vector MachineIRJET- Image Forgery Detection using Support Vector Machine
IRJET- Image Forgery Detection using Support Vector MachineIRJET Journal
 
A Smart Camera Processing Pipeline for Image Applications Utilizing Marching ...
A Smart Camera Processing Pipeline for Image Applications Utilizing Marching ...A Smart Camera Processing Pipeline for Image Applications Utilizing Marching ...
A Smart Camera Processing Pipeline for Image Applications Utilizing Marching ...sipij
 

Similar to Michelangelo 3-DOF Sketching Robot Draws Images (20)

Using A Application For A Desktop Application
Using A Application For A Desktop ApplicationUsing A Application For A Desktop Application
Using A Application For A Desktop Application
 
Generic Image Processing With Climb
Generic Image Processing With ClimbGeneric Image Processing With Climb
Generic Image Processing With Climb
 
Generic Image Processing With Climb – 5th ELS
Generic Image Processing With Climb – 5th ELSGeneric Image Processing With Climb – 5th ELS
Generic Image Processing With Climb – 5th ELS
 
Digital Image Processing
Digital Image ProcessingDigital Image Processing
Digital Image Processing
 
Deblurring, Localization and Geometry Correction of 2D QR Bar Codes Using Ric...
Deblurring, Localization and Geometry Correction of 2D QR Bar Codes Using Ric...Deblurring, Localization and Geometry Correction of 2D QR Bar Codes Using Ric...
Deblurring, Localization and Geometry Correction of 2D QR Bar Codes Using Ric...
 
Paper id 21201419
Paper id 21201419Paper id 21201419
Paper id 21201419
 
B018110915
B018110915B018110915
B018110915
 
IRJET- Digital Image Forgery Detection using Local Binary Patterns (LBP) and ...
IRJET- Digital Image Forgery Detection using Local Binary Patterns (LBP) and ...IRJET- Digital Image Forgery Detection using Local Binary Patterns (LBP) and ...
IRJET- Digital Image Forgery Detection using Local Binary Patterns (LBP) and ...
 
Gesture Recognition Based Mouse Events
Gesture Recognition Based Mouse EventsGesture Recognition Based Mouse Events
Gesture Recognition Based Mouse Events
 
Enhanced Optimization of Edge Detection for High Resolution Images Using Veri...
Enhanced Optimization of Edge Detection for High Resolution Images Using Veri...Enhanced Optimization of Edge Detection for High Resolution Images Using Veri...
Enhanced Optimization of Edge Detection for High Resolution Images Using Veri...
 
Using Image Acquisition Is The Input Text Document
Using Image Acquisition Is The Input Text DocumentUsing Image Acquisition Is The Input Text Document
Using Image Acquisition Is The Input Text Document
 
IRJET - Computer-Assisted ALL, AML, CLL, CML Detection and Counting for D...
IRJET -  	  Computer-Assisted ALL, AML, CLL, CML Detection and Counting for D...IRJET -  	  Computer-Assisted ALL, AML, CLL, CML Detection and Counting for D...
IRJET - Computer-Assisted ALL, AML, CLL, CML Detection and Counting for D...
 
Camouflage Color Changing Robot For Military Purpose
Camouflage Color Changing Robot For Military PurposeCamouflage Color Changing Robot For Military Purpose
Camouflage Color Changing Robot For Military Purpose
 
Camouflage color changing robot for miltary purpose
Camouflage color changing robot for miltary purposeCamouflage color changing robot for miltary purpose
Camouflage color changing robot for miltary purpose
 
A Biometric Approach to Encrypt a File with the Help of Session Key
A Biometric Approach to Encrypt a File with the Help of Session KeyA Biometric Approach to Encrypt a File with the Help of Session Key
A Biometric Approach to Encrypt a File with the Help of Session Key
 
Hardware software co simulation of edge detection for image processing system...
Hardware software co simulation of edge detection for image processing system...Hardware software co simulation of edge detection for image processing system...
Hardware software co simulation of edge detection for image processing system...
 
Vhdl implementation for edge detection using log gabor filter for disease det...
Vhdl implementation for edge detection using log gabor filter for disease det...Vhdl implementation for edge detection using log gabor filter for disease det...
Vhdl implementation for edge detection using log gabor filter for disease det...
 
IRJET- Image Forgery Detection using Support Vector Machine
IRJET- Image Forgery Detection using Support Vector MachineIRJET- Image Forgery Detection using Support Vector Machine
IRJET- Image Forgery Detection using Support Vector Machine
 
A Smart Camera Processing Pipeline for Image Applications Utilizing Marching ...
A Smart Camera Processing Pipeline for Image Applications Utilizing Marching ...A Smart Camera Processing Pipeline for Image Applications Utilizing Marching ...
A Smart Camera Processing Pipeline for Image Applications Utilizing Marching ...
 
Color Tracking Robot
Color Tracking RobotColor Tracking Robot
Color Tracking Robot
 

Recently uploaded

VIP Call Girls Service Kukatpally Hyderabad Call +91-8250192130
VIP Call Girls Service Kukatpally Hyderabad Call +91-8250192130VIP Call Girls Service Kukatpally Hyderabad Call +91-8250192130
VIP Call Girls Service Kukatpally Hyderabad Call +91-8250192130Suhani Kapoor
 
Cheap Rate Call girls Kalkaji 9205541914 shot 1500 night
Cheap Rate Call girls Kalkaji 9205541914 shot 1500 nightCheap Rate Call girls Kalkaji 9205541914 shot 1500 night
Cheap Rate Call girls Kalkaji 9205541914 shot 1500 nightDelhi Call girls
 
The history of music videos a level presentation
The history of music videos a level presentationThe history of music videos a level presentation
The history of music videos a level presentationamedia6
 
call girls in Harsh Vihar (DELHI) 🔝 >༒9953330565🔝 genuine Escort Service 🔝✔️✔️
call girls in Harsh Vihar (DELHI) 🔝 >༒9953330565🔝 genuine Escort Service 🔝✔️✔️call girls in Harsh Vihar (DELHI) 🔝 >༒9953330565🔝 genuine Escort Service 🔝✔️✔️
call girls in Harsh Vihar (DELHI) 🔝 >༒9953330565🔝 genuine Escort Service 🔝✔️✔️9953056974 Low Rate Call Girls In Saket, Delhi NCR
 
CALL ON ➥8923113531 🔝Call Girls Aminabad Lucknow best Night Fun service
CALL ON ➥8923113531 🔝Call Girls Aminabad Lucknow best Night Fun serviceCALL ON ➥8923113531 🔝Call Girls Aminabad Lucknow best Night Fun service
CALL ON ➥8923113531 🔝Call Girls Aminabad Lucknow best Night Fun serviceanilsa9823
 
VIP Kolkata Call Girl Gariahat 👉 8250192130 Available With Room
VIP Kolkata Call Girl Gariahat 👉 8250192130  Available With RoomVIP Kolkata Call Girl Gariahat 👉 8250192130  Available With Room
VIP Kolkata Call Girl Gariahat 👉 8250192130 Available With Roomdivyansh0kumar0
 
Cosumer Willingness to Pay for Sustainable Bricks
Cosumer Willingness to Pay for Sustainable BricksCosumer Willingness to Pay for Sustainable Bricks
Cosumer Willingness to Pay for Sustainable Bricksabhishekparmar618
 
Cheap Rate ➥8448380779 ▻Call Girls In Iffco Chowk Gurgaon
Cheap Rate ➥8448380779 ▻Call Girls In Iffco Chowk GurgaonCheap Rate ➥8448380779 ▻Call Girls In Iffco Chowk Gurgaon
Cheap Rate ➥8448380779 ▻Call Girls In Iffco Chowk GurgaonDelhi Call girls
 
SCRIP Lua HTTP PROGRACMACION PLC WECON CA
SCRIP Lua HTTP PROGRACMACION PLC  WECON CASCRIP Lua HTTP PROGRACMACION PLC  WECON CA
SCRIP Lua HTTP PROGRACMACION PLC WECON CANestorGamez6
 
3D Printing And Designing Final Report.pdf
3D Printing And Designing Final Report.pdf3D Printing And Designing Final Report.pdf
3D Printing And Designing Final Report.pdfSwaraliBorhade
 
VIP Call Girls Bhiwandi Ananya 8250192130 Independent Escort Service Bhiwandi
VIP Call Girls Bhiwandi Ananya 8250192130 Independent Escort Service BhiwandiVIP Call Girls Bhiwandi Ananya 8250192130 Independent Escort Service Bhiwandi
VIP Call Girls Bhiwandi Ananya 8250192130 Independent Escort Service BhiwandiSuhani Kapoor
 
Chapter 19_DDA_TOD Policy_First Draft 2012.pdf
Chapter 19_DDA_TOD Policy_First Draft 2012.pdfChapter 19_DDA_TOD Policy_First Draft 2012.pdf
Chapter 19_DDA_TOD Policy_First Draft 2012.pdfParomita Roy
 
WAEC Carpentry and Joinery Past Questions
WAEC Carpentry and Joinery Past QuestionsWAEC Carpentry and Joinery Past Questions
WAEC Carpentry and Joinery Past QuestionsCharles Obaleagbon
 
Design Portfolio - 2024 - William Vickery
Design Portfolio - 2024 - William VickeryDesign Portfolio - 2024 - William Vickery
Design Portfolio - 2024 - William VickeryWilliamVickery6
 
VIP Russian Call Girls in Gorakhpur Deepika 8250192130 Independent Escort Ser...
VIP Russian Call Girls in Gorakhpur Deepika 8250192130 Independent Escort Ser...VIP Russian Call Girls in Gorakhpur Deepika 8250192130 Independent Escort Ser...
VIP Russian Call Girls in Gorakhpur Deepika 8250192130 Independent Escort Ser...Suhani Kapoor
 
CALL ON ➥8923113531 🔝Call Girls Kalyanpur Lucknow best Female service 🧵
CALL ON ➥8923113531 🔝Call Girls Kalyanpur Lucknow best Female service  🧵CALL ON ➥8923113531 🔝Call Girls Kalyanpur Lucknow best Female service  🧵
CALL ON ➥8923113531 🔝Call Girls Kalyanpur Lucknow best Female service 🧵anilsa9823
 
VIP Call Girls Service Mehdipatnam Hyderabad Call +91-8250192130
VIP Call Girls Service Mehdipatnam Hyderabad Call +91-8250192130VIP Call Girls Service Mehdipatnam Hyderabad Call +91-8250192130
VIP Call Girls Service Mehdipatnam Hyderabad Call +91-8250192130Suhani Kapoor
 

Recently uploaded (20)

VIP Call Girls Service Kukatpally Hyderabad Call +91-8250192130
VIP Call Girls Service Kukatpally Hyderabad Call +91-8250192130VIP Call Girls Service Kukatpally Hyderabad Call +91-8250192130
VIP Call Girls Service Kukatpally Hyderabad Call +91-8250192130
 
Cheap Rate Call girls Kalkaji 9205541914 shot 1500 night
Cheap Rate Call girls Kalkaji 9205541914 shot 1500 nightCheap Rate Call girls Kalkaji 9205541914 shot 1500 night
Cheap Rate Call girls Kalkaji 9205541914 shot 1500 night
 
The history of music videos a level presentation
The history of music videos a level presentationThe history of music videos a level presentation
The history of music videos a level presentation
 
call girls in Harsh Vihar (DELHI) 🔝 >༒9953330565🔝 genuine Escort Service 🔝✔️✔️
call girls in Harsh Vihar (DELHI) 🔝 >༒9953330565🔝 genuine Escort Service 🔝✔️✔️call girls in Harsh Vihar (DELHI) 🔝 >༒9953330565🔝 genuine Escort Service 🔝✔️✔️
call girls in Harsh Vihar (DELHI) 🔝 >༒9953330565🔝 genuine Escort Service 🔝✔️✔️
 
CALL ON ➥8923113531 🔝Call Girls Aminabad Lucknow best Night Fun service
CALL ON ➥8923113531 🔝Call Girls Aminabad Lucknow best Night Fun serviceCALL ON ➥8923113531 🔝Call Girls Aminabad Lucknow best Night Fun service
CALL ON ➥8923113531 🔝Call Girls Aminabad Lucknow best Night Fun service
 
VIP Kolkata Call Girl Gariahat 👉 8250192130 Available With Room
VIP Kolkata Call Girl Gariahat 👉 8250192130  Available With RoomVIP Kolkata Call Girl Gariahat 👉 8250192130  Available With Room
VIP Kolkata Call Girl Gariahat 👉 8250192130 Available With Room
 
Cosumer Willingness to Pay for Sustainable Bricks
Cosumer Willingness to Pay for Sustainable BricksCosumer Willingness to Pay for Sustainable Bricks
Cosumer Willingness to Pay for Sustainable Bricks
 
Cheap Rate ➥8448380779 ▻Call Girls In Iffco Chowk Gurgaon
Cheap Rate ➥8448380779 ▻Call Girls In Iffco Chowk GurgaonCheap Rate ➥8448380779 ▻Call Girls In Iffco Chowk Gurgaon
Cheap Rate ➥8448380779 ▻Call Girls In Iffco Chowk Gurgaon
 
SCRIP Lua HTTP PROGRACMACION PLC WECON CA
SCRIP Lua HTTP PROGRACMACION PLC  WECON CASCRIP Lua HTTP PROGRACMACION PLC  WECON CA
SCRIP Lua HTTP PROGRACMACION PLC WECON CA
 
3D Printing And Designing Final Report.pdf
3D Printing And Designing Final Report.pdf3D Printing And Designing Final Report.pdf
3D Printing And Designing Final Report.pdf
 
Call Girls Service Mukherjee Nagar @9999965857 Delhi 🫦 No Advance VVIP 🍎 SER...
Call Girls Service Mukherjee Nagar @9999965857 Delhi 🫦 No Advance  VVIP 🍎 SER...Call Girls Service Mukherjee Nagar @9999965857 Delhi 🫦 No Advance  VVIP 🍎 SER...
Call Girls Service Mukherjee Nagar @9999965857 Delhi 🫦 No Advance VVIP 🍎 SER...
 
escort service sasti (*~Call Girls in Prasad Nagar Metro❤️9953056974
escort service sasti (*~Call Girls in Prasad Nagar Metro❤️9953056974escort service sasti (*~Call Girls in Prasad Nagar Metro❤️9953056974
escort service sasti (*~Call Girls in Prasad Nagar Metro❤️9953056974
 
young call girls in Vivek Vihar🔝 9953056974 🔝 Delhi escort Service
young call girls in Vivek Vihar🔝 9953056974 🔝 Delhi escort Serviceyoung call girls in Vivek Vihar🔝 9953056974 🔝 Delhi escort Service
young call girls in Vivek Vihar🔝 9953056974 🔝 Delhi escort Service
 
VIP Call Girls Bhiwandi Ananya 8250192130 Independent Escort Service Bhiwandi
VIP Call Girls Bhiwandi Ananya 8250192130 Independent Escort Service BhiwandiVIP Call Girls Bhiwandi Ananya 8250192130 Independent Escort Service Bhiwandi
VIP Call Girls Bhiwandi Ananya 8250192130 Independent Escort Service Bhiwandi
 
Chapter 19_DDA_TOD Policy_First Draft 2012.pdf
Chapter 19_DDA_TOD Policy_First Draft 2012.pdfChapter 19_DDA_TOD Policy_First Draft 2012.pdf
Chapter 19_DDA_TOD Policy_First Draft 2012.pdf
 
WAEC Carpentry and Joinery Past Questions
WAEC Carpentry and Joinery Past QuestionsWAEC Carpentry and Joinery Past Questions
WAEC Carpentry and Joinery Past Questions
 
Design Portfolio - 2024 - William Vickery
Design Portfolio - 2024 - William VickeryDesign Portfolio - 2024 - William Vickery
Design Portfolio - 2024 - William Vickery
 
VIP Russian Call Girls in Gorakhpur Deepika 8250192130 Independent Escort Ser...
VIP Russian Call Girls in Gorakhpur Deepika 8250192130 Independent Escort Ser...VIP Russian Call Girls in Gorakhpur Deepika 8250192130 Independent Escort Ser...
VIP Russian Call Girls in Gorakhpur Deepika 8250192130 Independent Escort Ser...
 
CALL ON ➥8923113531 🔝Call Girls Kalyanpur Lucknow best Female service 🧵
CALL ON ➥8923113531 🔝Call Girls Kalyanpur Lucknow best Female service  🧵CALL ON ➥8923113531 🔝Call Girls Kalyanpur Lucknow best Female service  🧵
CALL ON ➥8923113531 🔝Call Girls Kalyanpur Lucknow best Female service 🧵
 
VIP Call Girls Service Mehdipatnam Hyderabad Call +91-8250192130
VIP Call Girls Service Mehdipatnam Hyderabad Call +91-8250192130VIP Call Girls Service Mehdipatnam Hyderabad Call +91-8250192130
VIP Call Girls Service Mehdipatnam Hyderabad Call +91-8250192130
 

Michelangelo 3-DOF Sketching Robot Draws Images

  • 1. Michelangelo: A 3-DOF Sketching Robot Ravi Sankar Ippili, Uttam Grandhi, Dr. B.K. Raut, Dr. R.K. Mittal Mechanical Engineering Group Birla Institute of Technology and Science (BITS) -Pilani Pilani, Rajasthan, INDIA ravi.sankar.ippili@gmail.com, uttam.grandhi@gmail.com, rout@bits-pilani.ac.in, rkm@bits-pilani.ac.in Abstract— This paper presents an indigenously developed real-time and is interactive. It uses existing tools for image artbot capable of drawing complex images. The innovativeness processing, robot control and object manipulation. lies in the capacity to draw images with multiple gray values. Sketching complex objects requires human-specific skills, The robot possesses a tool magazine that holds pencils of and is thus a challenge for robots. varying shades of gray. The controller chooses the type of pencil based on the intensity levels of each gray pixel. The rest of the paper is organized as follows: Section II Geometric transformations like scaling and rotation can be presents the system set-up and the tools used. Section III performed on the image before drawing. To enhance the presents the strategy used to realize human-like drawing of characteristics of the image available image processing images. Section IV discusses the image acquisition, image algorithms are used. A GUI is developed with minimal buttons conversion, image preprocessing, threshold determination, to enable easy interaction with the robot. The simple yet image binarization and inverse kinematics. Section V efficient software and hardware design makes it a unique discusses the results and shows the possible extensions of sketching robot. the system. I. INTRODUCTION II. EXPERIMENTAL SET-UP Art surrounds us everywhere. It has become so inevitable that even technical fields were also influenced by A. Overview it. Robotics is a field that clearly signifies such an effect. The 3-DOF model of the sketching robot is made with Growing interest to keep robots as sources of entertainment the use of 4 servo actuators (ROBOTIS AX-12). 2-DOF are resulted in a new field of robotics, ‘artbots’. Robots that can used to sweep the area on the paper. The other 1-DOF is imitate humans in the true sense of an artist have always used to implement pen-up and pen-down states. The been a fascination to all age groups. actuators have torque-bearing capacity of 12 kgf.cm at 7 V During the last decade, various models of sketching and 16.5 kgf.cm at 10 V. The holding brackets were modeled robots have been developed that can draw pictures. They using PRO-E and were manufactured with fused deposition function similar to a printer that prints sequentially line by modeling machine. The algorithms extract contours from the line and hence, lack the dexterity of a human artist. These image using some edge detection techniques developed by models also fail to emulate a scene accurately as a fixed end Canny [3]. The end-effector is equipped with a magazine effector, usually a pencil or a pen, is used to represent with a maximum capacity of 4 pencils to portray various various gray levels in an image. Sketching Robots that have gray level values in the image. The actuators are connected been developed recently lack the portability and simplicity in a daisy chain mechanism and interfaced through a USB [1], [5], [6]. These robots sketch portraits only with a single port with the computer. The Graphical User Interface was color. This motivated us to develop a robot which is developed using Visual Basic. The instruction packets were compact in size, user friendly and a source of entertainment. constructed by the controller and sent to the actuators for We have also incorporated multi shades of gray in our execution. model. Further, the graffiti output device [4] that has been developed for sketching involves the use of ink, which has an inconvenience of drying the portrait once it is drawn. This suggested us to use pencils and thus enabling the user to access the drawn figure immediately. In this paper, we present the design of a 3-DOF sketching robot that sketches the picture by using a novel contour extraction algorithm and a tool magazine that can hold pencils of varying darkness to represent multiple gray levels in the image. The behavior of the robot resembles that of an artist, who would, first, analyze the object, and then, Figure 1: Photograph of the Michelangelo developed showing the magazine draw the image on a piece of paper. The application runs in with four pencils
  • 2. III. STRATEGY B. Image Conversion The sketcher traces the contour of a given image by The image acquired in previous step is transformed to a joining all the scattered dots with pen-up and pen-down desired format to perform various operations on it. The states. Depending on the desired range of the sketcher a image is initially in JPEG format. It is converted to PGM “Reachable Work Space (RWS)” has been fixed. RWS is the (Portable Gray Map) format using image processing tool area between two semi circles obtained by the extreme box inbuilt in MATLAB. The inbuilt function used to configurations of the sketcher. In the arm, 1-DOF is used for achieve this is rgb2gray. The function converts RGB pen up and pen down, while the other DOF are used to images to grayscale by eliminating the hue and saturation traverse a plane. The robot is controlled by an algorithm information while retaining the luminance. For each pixel in developed that optimizes the total distance traveled by the the image the luminance value L ∈ {0,1,...255} . The end effector, thus accomplishing the task in minimum time. The image to be processed is loaded through a GUI and luminance values 0 and 255 correspond to black and white converted to a desired format using the inbuilt functions of colors respectively. MATLAB. Inverse Kinematics is implemented for the 2- C. Image Preprocessing DOF planar arm to find the joint parameters. Since a 2-DOF manipulator can reach any point on a plane in two different The digital image acquired is prone to a variety of types arm orientations, a procedure has been devised to choose of noise. There are several ways that noise can be suitable and feasible orientation. Using the positions and introduced into an image, depending on how the image is speeds of all the actuators instruction packets are constructed created. We have implemented some of the noise reduction by the software. These instructions packets are sent to the algorithms provided in the Image processing toolbox. actuators connected in daisy chain through USB interface, to One of the most common types of noise, Salt and Pepper draw the image noise, typically seen on images, represents itself as randomly occurring white and black pixels. An effective noise reduction method for this type of noise involves the use of median filter. Median filter is applied using medfilt2 function of the toolbox. The function performs two dimensional median filtering. Median filtering, unlike linear filtering, besides removing noise it also preserves edges of the image, ARM 2 thus manifesting itself as an effective image enhancement filter. D. Determination of Threshold The threshold for the processed image is determined using gray level histograms and inbuilt functions of MATLAB. The inbuilt function graythresh computes the ARM1 global threshold of the image using Otsu’s method [2]. The image retains all the important characteristics and has an esthetic look. Besides this technique, various gray level histograms were plotted to determine the threshold based on REVOLUTE the frequency scatter of the gray values. RWS LINKS JOINTS E. Image Binarization Figure 2: Reachable Work Space of Michelangelo For each pixel in the image, the luminance L ∈ {0,1,....255} is transformed to either 0 or 1. The IV. DATA PROCESSING algorithm converts the image to a binary representation that can be drawn by the robot using pencils on white paper. The A. Image Acquisition threshold determined in the previous step is used to achieve This is the first and the foremost step which forms the this. basis for the remaining phases of data processing. We have F. Inverse Kinematics used a CCD based image sensor for image acquisition. The reason we have chosen CCD sensors over CMOS sensors is Inverse kinematics algorithms were run to compute joint their ability to create high quality, low noise images. The angle parameters from the Cartesian coordinates of the 2 picture of desired object is taken by placing it in front of the DOF planar RR arm configuration. Every point on image sensor. The lighting conditions are maintained same the RWS can be reached by the end effector in two different for all the pictures taken to provide similar ambience in the arm orientations. Taking into consideration various scene. mechanical constraints associated with the manipulator, a
  • 3. particular arm orientation was chosen. Some of the As we see from the test figures (Fig. 4.), lines are not important equations used in the development of inverse smooth and straight. It is mainly due to errors in the model kinematics module are as follows: of the robot used during the inverse-kinematics process. More specifically, the position of the pencil is supposed to be fixed, but this can also slightly change during the (1) drawing. Errors are also introduced in the set-up (e.g. if the links are not properly clamped.). Each step of the whole process can be monitored and (2) controlled visually, and parameters can be changed online, if desired. However, the application is created to run without the intervention of the user. The whole process is (3) fast: the image processing part and inverse kinematics take only a few seconds, and the drawing takes less than 10 minutes. A similar portrait sketched by a human would Where, clearly take more time to draw. In further work, we plan to add more interactive , are the abscissa and the ordinate of a point in RWS, behaviors to the robot. E.g. the robot may ask the user is the absolute distance of from the origin, whether he/she would like to have some more personalized addition be made to the drawing. We are in the process of are the link parameters of the manipulator, and incorporating stereoscopic vision system, which could be are the joint parameters of the manipulator. used to implement robust object tracking. The process of transforming the image in a black & white representation could be improved in many ways. For instance, in thresholding process, other criteria such as a solidity measure could be considered, to better distinguish the object features. Solidity is a measure of a surface divided by the convex surface surrounding the group of pixels. It could, then, be possible to detect if multiple features are merged together, resulting in non-convex areas. a) b) c) 1 2 d) e) f) Figure 3: Human Face. Images drawn with decreasing gray scale values. a), b), c) correspond to gray levels 200, 128 and 0 respectively. d), e), f) are the corresponding images drawn with HB, 4B and 6B pencils. V. RESULTS, DISCUSSION AND FURTHER WORK Some results are presented in Fig. 3 and 4, which are scan 3 4 of sketches drawn by Michelangelo. Sketching continuous line drawing images (Fig 3.) is not an easy task, even for Figure 4: Test Figures. Images drawn by the robot range from simple humans. Here, the robot performs this task skillfully. By geometries (1) to medium (2) and complex figures(3 &,4). planning a smooth trajectory, controlling the speed and acceleration of the arm, the manipulator deftly sketches the image.
  • 4. TABLE I. COMPARISION BETWEEN DIFFERENT TEST FIGURES second, it highlights the potential of sketching robots as Image Image Complexity Time Taken [min.] source of entertainment. Circle Low 0.66 REFERENCES Car Medium 4 [1] Sylvain Calinon, Julien Epiney and Aude Billard, “A humanoid robot drawing human portraits", EPFL, Switzerland Human face Medium 6 [2] Otsu, N., "A Threshold Selection Method from Gray-Level Duck High 7 Histograms," IEEE Transactions on Systems, Man, and Cybernetics, Vol. 9, No. 1, 1979, pp. 62-66 [3] J. Canny, “A computational approach to edge detection,” IEEE Trans.Pattern Analysis and Machine Intelligence, vol. 8, no. 6, pp. VI. CONCLUSION 679–698, 1986. This paper presented a simple realization of a robot [4] J. Lehni, “Hektor: a graffiti output device,” 2002, diploma project at capable of sketching complex objects. We have used novel the Ecole Cantonale d’Art de Lausanne. Available at methods to realize a sketch with multiple gray shades and http://www.hektor.ch. developed a lucid user interface to reduce unwanted user [5] M. Gommel, M. Haitz, and J. Zappe, “Robotlab autoportrait project: interference. The contribution of this work to art robots is Human portraits drawn by a robot,” 2004, center for Art and Media two-fold: first, it demonstrates how image processing Karlsruhe. Available at http://www.robotlab.de. techniques and classical inverse kinematics algorithms can [6] M. Stein and C. Madden, “The pumapaint project: Long term usage be tuned to endow an artbot with human-like competencies; trends and the move to three dimensions,” in Proceedings of the IEEE Intl Conference on Robotics and Automation (ICRA), Barcelona, Spain,April 18-22 200