"Introduction to Robotics: Mechanics, Planning, and Control," F. C. Park and K. M. Lynch

Total Page:16

File Type:pdf, Size:1020Kb

INTRODUCTION TO ROBOTICS MECHANICS, PLANNING, AND CONTROL F. C. Park and K. M. Lynch Contents 1Preview 1 2 Configuration Space 9 2.1DegreesofFreedomofaRigidBody................ 10 2.2DegreesofFreedomofaRobot................... 13 2.2.1 RobotJoints......................... 13 2.2.2 Gr¨ubler’sFormula...................... 14 2.3 Configuration Space: Topology and Representation ........ 19 2.3.1 ConfigurationSpaceTopology................ 19 2.3.2 Configuration Space Representation ............ 21 2.4ConfigurationandVelocityConstraints............... 25 2.5TaskSpaceandWorkspace..................... 28 2.6Summary............................... 31 2.7Exercises............................... 33 3 Rigid-Body Motions 51 3.1Rigid-BodyMotionsinthePlane.................. 53 3.2RotationsandAngularVelocities.................. 59 3.2.1 RotationMatrices...................... 59 3.2.2 AngularVelocity....................... 65 3.2.3 Exponential Coordinate Representation of Rotation . 68 3.3Rigid-BodyMotionsandTwists................... 77 3.3.1 HomogeneousTransformationMatrices.......... 77 3.3.2 Twists............................. 83 3.3.3 Exponential Coordinate Representation of Rigid-Body Mo- tions.............................. 90 3.4Wrenches............................... 93 3.5Summary............................... 95 3.6Software................................ 97 3.7NotesandReferences......................... 98 3.8Exercises............................... 99 i CONTENTS 4 Forward Kinematics 117 4.1ProductofExponentialsFormula..................120 4.1.1 First Formulation: Screw Axes Expressed in Base Frame . 120 4.1.2 Examples...........................122 4.1.3 Second Formulation: Screw Axes Expressed in End-Effector Frame.............................127 4.2 The Universal Robot Description Format .............130 4.3Summary...............................135 4.4Software................................137 4.5Exercises...............................138 5 Velocity Kinematics and Statics 149 5.1ManipulatorJacobian........................155 5.1.1 SpaceJacobian........................155 5.1.2 BodyJacobian........................159 5.1.3 Relationship between the Space and Body Jacobian . 161 5.1.4 AlternativeNotionsoftheJacobian............162 5.1.5 InverseVelocityKinematics.................163 5.2StaticsofOpenChains........................163 5.3SingularityAnalysis.........................164 5.4 Manipulability ............................169 5.5Summary...............................172 5.6Software................................173 5.7NotesandReferences.........................174 5.8Exercises...............................175 6 Inverse Kinematics 191 6.1AnalyticInverseKinematics.....................193 6.1.1 6RPUMA-TypeArm....................193 6.1.2 Stanford-TypeArms.....................196 6.2NumericalInverseKinematics....................198 6.2.1 Newton-RaphsonMethod..................198 6.2.2 OptimizationBasics.....................199 6.2.3 NumericalInverseKinematicsAlgorithm.........201 6.3InverseVelocityKinematics.....................205 6.4ANoteonClosedLoops.......................207 6.5Summary...............................207 6.6Software................................208 6.7NotesandReferences.........................208 6.8Exercises...............................209 7 Kinematics of Closed Chains 217 7.1InverseandForwardKinematics..................218 7.1.1 3×RPRPlanarParallelMechanism.............219 7.1.2 Stewart-GoughPlatform...................221 7.1.3 GeneralParallelMechanisms................222 Park and Lynch ii 16:36 September 20, 2016 CONTENTS 7.2DifferentialKinematics........................223 7.2.1 Stewart-GoughPlatform...................224 7.2.2 GeneralParallelMechanisms................225 7.3Singularities..............................227 7.4Summary...............................231 7.5NotesandReferences.........................232 7.6Exercises...............................234 8 Dynamics of Open Chains 241 8.1 Lagrangian Formulation .......................242 8.1.1 BasicConceptsandMotivatingExamples.........242 8.1.2 GeneralFormulation.....................246 8.1.3 UnderstandingtheMassMatrix..............248 8.1.4 Lagrangian Dynamics vs. Newton-Euler Dynamics ....250 8.2DynamicsofaSingleRigidBody..................251 8.2.1 ClassicalFormulation....................251 8.2.2 Twist-WrenchFormulation.................255 8.3Newton-EulerInverseDynamics...................257 8.3.1 Derivation...........................257 8.3.2 Newton-EulerInverseDynamicsAlgorithm........260 8.4DynamicEquationsinClosedForm.................260 8.5ForwardDynamicsofOpenChains.................263 8.6DynamicsinTaskSpaceCoordinates................264 8.7ConstrainedDynamics........................266 8.8RobotDynamicsintheURDF...................267 8.9Actuation,Gearing,andFriction..................268 8.9.1 DCMotorsandGearing...................270 8.9.2 ApparentInertia.......................273 8.9.3 Friction............................276 8.9.4 Joint and Link Flexibility ..................277 8.10Summary...............................277 8.11Software................................280 8.12NotesandReferences.........................282 8.13Exercises...............................283 9 Trajectory Generation 289 9.1Definitions...............................289 9.2Point-to-PointTrajectories.....................290 9.2.1 Straight-LinePaths.....................290 9.2.2 TimeScalingaStraight-LinePath.............292 9.3PolynomialViaPointTrajectories.................297 9.4Time-OptimalTimeScaling.....................299 9.4.1 The (s, s˙)PhasePlane....................301 9.4.2 TheTime-ScalingAlgorithm................304 9.4.3 AssumptionsandCaveats..................306 9.5Summary...............................307 Park and Lynch iii 16:36 September 20, 2016 CONTENTS 9.6Software................................308 9.7NotesandReferences.........................308 9.8Exercises...............................310 10 Motion Planning 315 10.1OverviewofMotionPlanning....................315 10.1.1TypesofMotionPlanningProblems............316 10.1.2PropertiesofMotionPlanners...............317 10.1.3MotionPlanningMethods..................318 10.2 Foundations ..............................319 10.2.1ConfigurationSpaceObstacles...............319 10.2.2 Distance to Obstacles and Collision Detection .......323 10.2.3GraphsandTrees.......................324 10.2.4GraphSearch.........................325 10.3CompletePathPlanners.......................328 10.4GridMethods.............................329 10.4.1 Multi-Resolution Grid Representation ...........331 10.4.2GridMethodswithMotionConstraints..........332 10.5SamplingMethods..........................337 10.5.1TheRRT...........................338 10.5.2ThePRM...........................342 10.6VirtualPotentialFields.......................344 10.6.1APointinC-space......................344 10.6.2NavigationFunctions.....................347 10.6.3WorkspacePotential.....................348 10.6.4WheeledMobileRobots...................349 10.6.5UseofPotentialFieldsinPlanners.............349 10.7NonlinearOptimization.......................349 10.8Smoothing...............................351 10.9Summary...............................352 10.10NotesandReferences.........................354 10.11Exercises...............................356 11 Robot Control 359 11.1ControlSystemOverview......................360 11.2MotionControl............................360 11.2.1 Motion Control of a Multi-Joint Robot with Velocity Input361 11.2.2 Motion Control of a Single Joint with Torque or Force Input363 11.2.3 Motion Control of a Multi-joint Robot with Torque or Force Input ..........................374 11.2.4TaskSpaceMotionControl.................376 11.3ForceControl.............................378 11.4HybridMotion-ForceControl....................380 11.4.1NaturalandArtificialConstraints.............380 11.4.2AHybridController.....................382 11.5ImpedanceControl..........................384 Park and Lynch iv 16:36 September 20, 2016 CONTENTS 11.5.1ImpedanceControlAlgorithm................386 11.5.2AdmittanceControlAlgorithm...............387 11.6OtherTopics.............................387 11.7Summary...............................388 11.8Software................................390 11.9NotesandReferences.........................391 11.10Exercises...............................392 12 Grasping and Manipulation 399 12.1ContactKinematics.........................400 12.1.1First-OrderAnalysisofaSingleContact..........401 12.1.2ContactTypes:Rolling,Sliding,andBreakingFree....402 12.1.3MultipleContacts......................405 12.1.4CollectionsofParts.....................406 12.1.5OtherTypesofContacts...................407 12.1.6PlanarGraphicalMethods..................409 12.1.7FormClosure.........................413 12.2ContactForcesandFriction.....................418 12.2.1Friction............................418 12.2.2PlanarGraphicalMethods..................420 12.2.3ForceClosure.........................423 12.2.4DualityofForceandMotionFreedoms...........428 12.3Manipulation.............................428 12.4Summary...............................434 12.5NotesandReferences.........................435 12.6Exercises...............................437 13 Wheeled Mobile Robots 455 13.1TypesofWheeledMobileRobots..................455 13.2OmnidirectionalWheeledMobileRobots..............457 13.2.1Modeling...........................457 13.2.2MotionPlanning.......................461 13.2.3FeedbackControl.......................462 13.3NonholonomicWheeledMobileRobots...............462
Recommended publications
  • Mobile Robot Kinematics
    Mobile Robot Kinematics We're going to start talking about our mobile robots now. There robots differ from our arms in 2 ways: They have sensors, and they can move themselves around. Because their movement is so different from the arms, we will need to talk about a new style of kinematics: Differential Drive. 1. Differential Drive is how many mobile wheeled robots locomote. 2. Differential Drive robot typically have two powered wheels, one on each side of the robot. Sometimes there are other passive wheels that keep the robot from tipping over. 3. When both wheels turn at the same speed in the same direction, the robot moves straight in that direction. 4. When one wheel turns faster than the other, the robot turns in an arc toward the slower wheel. 5. When the wheels turn in opposite directions, the robot turns in place. 6. We can formally describe the robot behavior as follows: (a) If the robot is moving in a curve, there is a center of that curve at that moment, known as the Instantaneous Center of Curvature (or ICC). We talk about the instantaneous center, because we'll analyze this at each instant- the curve may, and probably will, change in the next moment. (b) If r is the radius of the curve (measured to the middle of the robot) and l is the distance between the wheels, then the rate of rotation (!) around the ICC is related to the velocity of the wheels by: l !(r + ) = v 2 r l !(r − ) = v 2 l Why? The angular velocity is defined as the positional velocity divided by the radius: dθ V = dt r 1 This should make some intuitive sense: the farther you are from the center of rotation, the faster you need to move to get the same angular velocity.
    [Show full text]
  • Abbreviations and Glossary
    Appendix A Abbreviations and Glossary Abbreviations are defined and the mathematical symbols and notations used in this book are specified. Furthermore, the random number generator used in this book is referenced. A.1 Abbreviations arccos arccosine BiRRT Bidirectional rapidly growing random tree C-space Configuration space DH Denavit-Hartenberg DLR German aerospace center DOF Degree of freedom FFT Fast fourier transformation IK Inverse kinematics HRI Human-Robot interface LWR Light weight robot MMI Institute of Man-Machine interaction PCA Principal component analysis PRM Probabilistic road map RRT Rapidly growing random tree rulaCapMap Rula-restricted capability map RULA Rapid upper limb assessment SFE Shape fit error TCP Tool center point OV workspace overlap 130 A Abbreviations and Glossary A.2 Mathematical Symbols C configuration space K(q) direct kinematics H set of all homogeneous matrices WR reachable workspace WD dexterous workspace WV versatile workspace F(R,x) function that maps to a homogeneous matrix VRobot voxel space for the robot arm VHuman voxel space for the human arm P set of points on the sphere Np set of point indices for the points on the sphere No set of orientation indices OS set of all homogeneous frames distributed on a sphere MS capability map A.3 Mathematical Notations a scalar value a vector aT vector transposed A matrix AT matrix transposed < a,b > inner product 3 SO(3) group of rotation matrices ∈ IR SO(3) := R ∈ IR 3×3| RRT = I,detR =+1 SE(3) IR 3 × SO(3) A TB reference frame B given in coordinates of reference frame A a ceiling function a floor function A.4 Random Sampling In this book, the drawing of random samples is often used.
    [Show full text]
  • MSC.ADAMS Functions
    COSMOSMotion User’s Guide COPYRIGHT NOTICE Copyright © 20023by Structural Research and Analysis Corp, All rights reserved. Portions Copyright © 1997-2003 by MSC.Software Corporation. All rights reserved. U. S. Government Restricted Rights: If the Software and Documentation are provided in connection with a government contract, then they are provided with RESTRICTED RIGHTS. Use, duplication or disclosure is subject to restrictions stated in paragraph (c)(1)(ii) of the Rights in Technical Data and Computer Software clause at 252.227-7013. MSC.Software. 2 MacArthur Place, Santa Ana, CA 92707. Information in this document is subject to change without notice. This document contains proprietary and copyrighted information and may not be copied, reproduced, translated, or reduced to any electronic medium without prior consent, in writing, from MSC.Software Corporation. REVISION HISTORY First Printing December 2001 Second Printing September 2002 Third Printing August 2003 TRADEMARKS MSC.ADAMS is a registered United States trademark and MSC.ADAMS/Solver, MSC.ADAMS/Kinematics, MSC.ADAMS/View, and COSMOSMotion are trademarks of MSC.Software. SolidWorks, FeatureManager, SolidBasic, and RapidDraft are trademarks of SolidWorks Corporation. Windows is a registered trademark of MicroSoft Corporation. All other brands and product names are the trademarks of their respective holders. Table of Contents Table of Contents...........................................................................................................................i 1 COSMOSMotion...........................................................................................................
    [Show full text]
  • KINEMATIC ANALYSIS of a THUMB-EXOSKELETON SYSTEM for POST STROKE REHABILITATION By
    KINEMATIC ANALYSIS OF A THUMB-EXOSKELETON SYSTEM FOR POST STROKE REHABILITATION By Vikash Gupta Thesis Submitted to the Faculty of the Graduate School of Vanderbilt University in partial fulfillment of the requirements for the degree of MASTER OF SCIENCE in Mechanical Engineering August, 2010 Nashville, Tennessee Approved: Professor Nilanjan Sarkar Professor Derek Kamper Professor Robert Webster III ACKNOWLEDGEMENTS I will like to extend my sincere thanks to Dr. Nilanjan Sarkar for his continuous support and guidance, for his encouragement and advice throughout my studies. He has always been a source of inspiration for me. I would also like to thank Dr. Derek Kamper from Rehabilitation Institute of Chicago, for providing valuable comments on the thesis and being supportive throughout the research. My deep gratitude and sincere thanks goes to my parents and my sister, Swati Gupta. Their invaluable support, understanding and encouragement from far home has always helped me to continue my research. I would also like to thank Hari Kr. Voruganti, Mukul Singhee, Abhishek Chowdhury, Sayantan Chatterjee and Raktim Mitra for their support. My sincere thanks goes to Nino Dzotsenidze, who has always supported and believed in me and helped me make the right decisions at all times. Without her support and encouragement, it would have not been possible. I would also like to thank and express my sincere gratitude to my colleagues and friends Milind Shashtri, Furui Wang, Yu Tian, Jadav Das and Uttama Lahiri at Robotics and Autonomous Systems Laboratory for their support. Last but not the least, I want to express my humble thanks and appreciation to Suzanne Weiss from the Mechanical Engineering department for always being supportive.
    [Show full text]
  • Randomized Path Planning for Redundant Manipulators Without Inverse Kinematics
    Randomized Path Planning for Redundant Manipulators without Inverse Kinematics Mike Vande Weghe Dave Ferguson, Siddhartha S. Srinivasa Institute for Complex Engineered Systems Intel Research Pittsburgh Carnegie Mellon University 4720 Forbes Avenue Pittsburgh, PA 15213 Pittsburgh, PA 15213 [email protected] {dave.ferguson, siddhartha.srinivasa}@intel.com Abstract— We present a sampling-based path planning al- gorithm capable of efficiently generating solutions for high- dimensional manipulation problems involving challenging inverse kinematics and complex obstacles. Our algorithm extends the Rapidly-exploring Random Tree (RRT) algorithm to cope with goals that are specified in a subspace of the manipulator configuration space through which the search tree is being grown. Underspecified goals occur naturally in arm planning, where the final end effector position is crucial but the configuration of the rest of the arm is not. To achieve this, the algorithm bootstraps an optimal local controller based on the transpose of the Jacobian to a global RRT search. The resulting approach, known as Jacobian Transpose-directed Rapidly Exploring Random Trees (JT-RRTs), is able to combine the configuration space exploration of RRTs with a workspace goal bias to produce direct paths through complex environments extremely efficiently, without the need for any inverse kinematics. We compare our algorithm to a recently- developed competing approach and provide results from both simulation and a 7 degree-of-freedom robotic arm. I. INTRODUCTION Path planning for robotic systems operating in real envi- ronments is hard. Not only must such systems deal with the standard planning challenges of potentially high-dimensional and complex search spaces, but they must also cope with im- perfect information regarding their surroundings and perhaps Fig.
    [Show full text]
  • Robot Control and Programming: Class Notes Dr
    NAVARRA UNIVERSITY UPPER ENGINEERING SCHOOL San Sebastian´ Robot Control and Programming: Class notes Dr. Emilio Jose´ Sanchez´ Tapia August, 2010 Servicio de Publicaciones de la Universidad de Navarra 987‐84‐8081‐293‐1 ii Viaje a ’Agra de Cimientos’ Era yo todav´ıa un estudiante de doctorado cuando cayo´ en mis manos una tesis de la cual me llamo´ especialmente la atencion´ su cap´ıtulo de agradecimientos. Bueno, realmente la tesis no contaba con un cap´ıtulo de ’agradecimientos’ sino mas´ bien con un cap´ıtulo alternativo titulado ’viaje a Agra de Cimientos’. En dicho capitulo, el ahora ya doctor redacto´ un pequeno˜ cuento epico´ inventado por el´ mismo. Esta pequena˜ historia relataba las aventuras de un caballero, al mas´ puro estilo ’Tolkiano’, que cabalgaba en busca de un pueblo recondito.´ Ya os podeis´ imaginar que dicho caballero, no era otro sino el´ mismo, y que su viaje era mas´ bien una odisea en la cual tuvo que superar mil y una pruebas hasta conseguir su objetivo, llegar a Agra de Cimientos (terminar su tesis). Solo´ deciros que para cada una de esas pruebas tuvo la suerte de encontrar a una mano amiga que le ayudara. En mi caso, no voy a presentarte una tesis, sino los apuntes de la asignatura ”Robot Control and Programming´´ que se imparte en ingles.´ Aunque yo no tengo tanta imaginacion´ como la de aquel doctorando para poder contaros una historia, s´ı que he tenido la suerte de encontrar a muchas personas que me han ayudado en mi viaje hacia ’Agra de Cimientos’. Y eso es, amigo lector, al abrir estas notas de clase vas a ser testigo del final de un viaje que he realizado de la mano de mucha gente que de alguna forma u otra han contribuido en su mejora.
    [Show full text]
  • Creating and Running a Dynamic Analysis a Force Simulating The
    Creating and Running a Dynamic Analysis A force simulating the engine firing load (acting along the negative X-direction) will be added to the piston for a dynamic simulation. It will be more realistic if the force can be applied when the piston starts moving to the left (negative X-direction) and can be applied only for a selected short period. In order to do so, we will have to define measures that monitor the position of the piston for the firing load to be activated. Unfortunately, such a capability is not available in COSMOSMotion. Therefore, the force is simplified as a step function of 3 lbf along the negative X-direction applied for 0.1 seconds. The force will be defined as a point force at the center point of the end face of the piston, as shown in Figure 5-21. Before we add the force, we will turn off the angular velocity driver defined at the joint Revolute2 in the previous simulation. We will have to delete the simulation before we can make any changes to the From the browser, expand the Constraints branch, and then the Joints branch. Right click Revolute to bring up the Edit Mate-Defined Joint dialog box (Figure 5-22). Pull-down the Motion Type and choose Free. Click Apply to accept the change. Note that if you run a simulation now, nothing will happen since there is no motion driver or force defined (gravity has been turned off). Now we are ready to add the force. The force can be added from the browser by expanding the Forces branch, right clicking the Action Only node, and choosing Add Action-Only Force, as shown in Figure 5- 23.
    [Show full text]
  • Nyku: a Social Robot for Children with Autism Spectrum Disorders
    University of Denver Digital Commons @ DU Electronic Theses and Dissertations Graduate Studies 2020 Nyku: A Social Robot for Children With Autism Spectrum Disorders Dan Stephan Stoianovici University of Denver Follow this and additional works at: https://digitalcommons.du.edu/etd Part of the Disability Studies Commons, Electrical and Computer Engineering Commons, and the Robotics Commons Recommended Citation Stoianovici, Dan Stephan, "Nyku: A Social Robot for Children With Autism Spectrum Disorders" (2020). Electronic Theses and Dissertations. 1843. https://digitalcommons.du.edu/etd/1843 This Thesis is brought to you for free and open access by the Graduate Studies at Digital Commons @ DU. It has been accepted for inclusion in Electronic Theses and Dissertations by an authorized administrator of Digital Commons @ DU. For more information, please contact [email protected],[email protected]. Nyku : A Social Robot for Children with Autism Spectrum Disorders A Thesis Presented to the Faculty of the Daniel Felix Ritchie School of Engineering and Computer Science University of Denver In Partial Fulfillment of the Requirements for the Degree Master of Science by Dan Stoianovici August 2020 Advisor: Dr. Mohammad H. Mahoor c Copyright by Dan Stoianovici 2020 All Rights Reserved Author: Dan Stoianovici Title: Nyku: A Social Robot for Children with Autism Spectrum Disorders Advisor: Dr. Mohammad H. Mahoor Degree Date: August 2020 Abstract The continued growth of Autism Spectrum Disorders (ASD) around the world has spurred a growth in new therapeutic methods to increase the positive outcomes of an ASD diagnosis. It has been agreed that the early detection and intervention of ASD disorders leads to greatly increased positive outcomes for individuals living with the disorders.
    [Show full text]
  • A Review of Parallel Processing Approaches to Robot Kinematics and Jacobian
    Technical Report 10/97, University of Karlsruhe, Computer Science Department, ISSN 1432-7864 A Review of Parallel Processing Approaches to Robot Kinematics and Jacobian Dominik HENRICH, Joachim KARL und Heinz WÖRN Institute for Real-Time Computer Systems and Robotics University of Karlsruhe, D-76128 Karlsruhe, Germany e-mail: [email protected] Abstract Due to continuously increasing demands in the area of advanced robot control, it became necessary to speed up the computation. One way to reduce the computation time is to distribute the computation onto several processing units. In this survey we present different approaches to parallel computation of robot kinematics and Jacobian. Thereby, we discuss both the forward and the reverse problem. We introduce a classification scheme and classify the references by this scheme. Keywords: parallel processing, Jacobian, robot kinematics, robot control. 1 Introduction Due to continuously increasing demands in the area of advanced robot control, it became necessary to speed up the computation. Since it should be possible to control the motion of a robot manipulator in real-time, it is necessary to reduce the computation time to less than the cycle rate of the control loop. One way to reduce the computation time is to distribute the computation over several processing units. There are other overviews and reviews on parallel processing approaches to robotic problems. Earlier overviews include [Lee89] and [Graham89]. Lee takes a closer look at parallel approaches in [Lee91]. He tries to find common features in the different problems of kinematics, dynamics and Jacobian computation. The latest summary is from Zomaya et al. [Zomaya96].
    [Show full text]
  • Arxiv:2102.12942V3 [Cs.RO] 30 Mar 2021 Drawback of These Strategies Is That They Are Extremely Sensitive to Inaccuracies in the Model
    Structured Prediction for CRiSP Inverse Kinematics Learning with Misspecified Robot Models Gian Maria Marconi∗,1,2 Raffaello Camoriano∗,2 Lorenzo Rosasco2,3,4 Carlo Ciliberto5 [email protected] raff[email protected] [email protected] [email protected] Abstract With the recent advances in machine learning, problems that traditionally would require accurate modeling to be solved analytically can now be successfully approached with data-driven strategies. Among these, computing the inverse kinematics of a redundant robot arm poses a significant challenge due to the non-linear structure of the robot, the hard joint constraints and the non-invertible kinematics map. Moreover, most learning algorithms consider a completely data-driven approach, while often useful information on the structure of the robot is available and should be positively exploited. In this work, we present a simple, yet effective, approach for learning the inverse kinematics. We introduce a structured prediction algorithm that combines a data-driven strategy with the model provided by a forward kinematics function – even when this function is misspecified – to accurately solve the problem. The proposed approach ensures that predicted joint configurations are well within the robot’s constraints. We also provide statistical guarantees on the generalization properties of our estimator as well as an empirical evaluation of its performance on trajectory reconstruction tasks. 1 Introduction Computing the inverse kinematics of a robot is a well-known key problem in several applications requiring robot control [20]. This task consists in finding a set of joint configurations that would result in a given pose of the end effector, and is traditionally solved by assuming access to an accurate model of the robot and employing geometric or numerical optimization techniques.
    [Show full text]
  • A Closed-Form Solution for the Inverse Kinematics of the 2N-DOF Hyper-Redundant Manipulator Based on General Spherical Joint
    applied sciences Article A Closed-Form Solution for the Inverse Kinematics of the 2n-DOF Hyper-Redundant Manipulator Based on General Spherical Joint Ya’nan Lou , Pengkun Quan, Haoyu Lin, Dongbo Wei and Shichun Di * School of Mechatronics Engineering, Harbin Institute of Technology, Harbin 150001, China; [email protected] (Y.L.); [email protected] (P.Q.); [email protected] (H.L.); [email protected] (D.W.) * Correspondence: [email protected]; Tel.: +86-1390-4605-946 Abstract: This paper presents a closed-form inverse kinematics solution for the 2n-degree of freedom (DOF) hyper-redundant serial manipulator with n identical universal joints (UJs). The proposed algorithm is based on a novel concept named as general spherical joint (GSJ). In this work, these universal joints are modeled as general spherical joints through introducing a virtual revolution between two adjacent universal joints. This virtual revolution acts as the third revolute DOF of the general spherical joint. Remarkably, the proposed general spherical joint can also realize the decoupling of position and orientation just as the spherical wrist. Further, based on this, the universal joint angles can be solved if all of the positions of the general spherical joints are known. The position of a general spherical joint can be determined by using three distances between this unknown general spherical joint and another three known ones. Finally, a closed-form solution for the whole manipulator is solved by applying the inverse kinematics of single general spherical joint section using these positions. Simulations are developed to verify the validity of the proposed closed-form inverse kinematics model.
    [Show full text]
  • Forward and Inverse Kinematics Analysis of Denso Robot
    Proceedings of the International Symposium of Mechanism and Machine Science, 2017 AzC IFToMM – Azerbaijan Technical University 11-14 September 2017, Baku, Azerbaijan Forward and Inverse Kinematics Analysis of Denso Robot Mehmet Erkan KÜTÜK 1*, Memik Taylan DAŞ2, Lale Canan DÜLGER1 1*Mechanical Engineering Department, University of Gaziantep Gaziantep/ Turkey E-mail: [email protected] 2 Mechanical Engineering Department, University of Kırıkkale Abstract used Robotic Toolbox in forward kinematics analysis of A forward and inverse kinematic analysis of 6 axis an industrial robot [4]. DENSO robot with closed form solution is performed in This study includes kinematics of robot arm which is this paper. Robotics toolbox provides a great simplicity to available Gaziantep University, Mechanical Engineering us dealing with kinematics of robots with the ready Department, Mechatronics Lab. Forward and Inverse functions on it. However, making calculations in kinematics analysis are performed. Robotics Toolbox is traditional way is important to dominate the kinematics also applied to model Denso robot system. A GUI is built which is one of the main topics of robotics. Robotic for practical use of robotic system. toolbox in Matlab® is used to model Denso robot system. GUI studies including Robotic Toolbox are given with 2. Robot Arm Kinematics simulation examples. Keywords: Robot Kinematics, Simulation, Denso The robot kinematics can be categorized into two Robot, Robotic Toolbox, GUI main parts; forward and inverse kinematics. Forward kinematics problem is not difficult to perform and there is no complexity in deriving the equations in contrast to the 1. Introduction inverse kinematics. Especially nonlinear equations make the inverse kinematics problem complex.
    [Show full text]