Chapter 3 Dynamics of Rigid Body Systems

Total Page:16

File Type:pdf, Size:1020Kb

Chapter 3 Dynamics of Rigid Body Systems Rigid Body Dynamics Algorithms Roy Featherstone Rigid Body Dynamics Algorithms Roy Featherstone The Austrailian National University Canberra, ACT Austrailia Library of Congress Control Number: 2007936980 ISBN 978-0-387-74314-1 ISBN 978-1-4899-7560-7 (eBook) Printed on acid-free paper. @ 2008 Springer Science+Business Media, LLC All rights reserved. This work may not be translated or copied in whole or in part without the written permission of the publisher (Springer Science+Business Media, LLC, 233 Spring Street, New York, NY 10013, USA), except for brief excerpts in connection with reviews or scholarly analysis. Use in connection with any form of information storage and retrieval, electronic adaptation, computer software, or by similar or dissimilar methodology now known or hereafter developed is forbidden. The use in this publication of trade names, trademarks, service marks and similar terms, even if they are not identified as such, is not to be taken as an expression of opinion as to whether or not they are subject to proprietary rights. 9 8 7 6 5 4 3 2 1 springer.com Preface The purpose of this book is to present a substantial collection of the most efficient algorithms for calculating rigid-body dynamics, and to explain them in enough detail that the reader can understand how they work, and how to adapt them (or create new algorithms) to suit the reader’s needs. The collection includes the following well-known algorithms: the recursive Newton-Euler algo- rithm, the composite-rigid-body algorithm and the articulated-body algorithm. It also includes algorithms for kinematic loops and floating bases. Each algo- rithm is derived from first principles, and is presented both as a set of equations and as a pseudocode program, the latter being designed for easy translation into any suitable programming language. This book also explains some of the mathematical techniques used to for- mulate the equations of motion for a rigid-body system. In particular, it shows how to express dynamics using six-dimensional (6D) vectors, and it explains the recursive formulations that are the basis of the most efficient algorithms. Other topics include: how to construct a computer model of a rigid-body system; ex- ploiting sparsity in the inertia matrix; the concept of articulated-body inertia; the sources of rounding error in dynamics calculations; and the dynamics of physical contact and impact between rigid bodies. Rigid-body dynamics has a tendency to become a sea of algebra. However, this is largely the result of using 3D vectors, and it can be remedied by using a 6D vector notation instead. This book uses a notation based on spatial vectors, in which the linear and angular aspects of rigid-body motion are combined into a unified set of quantities and equations. The result is typically a four- to six- fold reduction in the volume of algebra. The benefit is also felt in the computer code: shorter, clearer programs that are easier to read, write and debug, but are still just as efficient as code using standard 3D vectors. This book is intended to be accessible to a wide audience, ranging from senior undergraduates to researchers and professionals. Readers are assumed to have some prior knowledge of rigid-body dynamics, such as might be obtained from an introductory course on dynamics, or from reading the first few chapters of an introductory text. However, no prior knowledge of 6D vectors is required, as this topic is explained from the beginning in Chapter 2. This book does also contain some advanced material, such as might be of interest to dynamics vi PREFACE experts and scholars of 6D vectors. No software is distributed with this book, but readers can obtain source code for most of the algorithms described here from the author’s web site. This text was originally intended to be a second edition of a book entitled Robot Dynamics Algorithms, which was published back in 1987; but it quickly became clear that there was enough new material to justify the writing of a whole new book. Compared with its predecessor, the most notable new mate- rials to be found here are: explicit pseudocode descriptions of the algorithms; a chapter on how to model rigid-body systems; algorithms to exploit branch- induced sparsity; an enlarged treatment of kinematic loops and floating-base systems; planar vectors (the planar equivalent of spatial vectors); numerical errors and model sensitivity; and guidance on how to implement spatial-vector arithmetic. Contents Preface v 1 Introduction 1 1.1DynamicsAlgorithms........................ 1 1.2SpatialVectors............................ 3 1.3UnitsandNotation.......................... 4 1.4Readers’Guide............................ 5 1.5FurtherReading........................... 6 2 Spatial Vector Algebra 7 2.1MathematicalPreliminaries..................... 7 2.2SpatialVelocity............................ 10 2.3SpatialForce............................. 13 2.4 Pl¨uckerNotation........................... 15 2.5LineVectorsandFreeVectors.................... 16 2.6ScalarProduct............................ 17 2.7UsingSpatialVectors........................ 18 2.8CoordinateTransforms........................ 20 2.9SpatialCrossProducts........................ 23 2.10Differentiation............................ 25 2.11Acceleration.............................. 28 2.12Momentum.............................. 31 2.13Inertia................................. 32 2.14EquationofMotion.......................... 35 2.15InverseInertia............................ 36 2.16PlanarVectors............................ 37 2.17FurtherReading........................... 38 3 Dynamics of Rigid Body Systems 39 3.1EquationsofMotion......................... 40 3.2ConstructingEquationsofMotion................. 42 3.3VectorSubspaces........................... 46 3.4ClassificationofConstraints..................... 50 vii viii CONTENTS 3.5JointConstraints........................... 53 3.6 Dynamics of a Constrained Rigid Body . 57 3.7DynamicsofaMultibodySystem.................. 60 4 Modelling Rigid Body Systems 65 4.1Connectivity............................. 66 4.2Geometry............................... 73 4.3Denavit-HartenbergParameters................... 75 4.4JointModels............................. 78 4.5SphericalMotion........................... 84 4.6ACompleteSystemModel..................... 87 5 Inverse Dynamics 89 5.1AlgorithmComplexity........................ 89 5.2RecurrenceRelations......................... 90 5.3 The Recursive Newton-Euler Algorithm . 92 5.4TheOriginalVersion......................... 97 5.5AdditionalNotes........................... 99 6 Forward Dynamics — Inertia Matrix Methods 101 6.1TheJoint-SpaceInertiaMatrix...................102 6.2 The Composite-Rigid-Body Algorithm . 104 6.3APhysicalInterpretation......................108 6.4Branch-InducedSparsity.......................110 6.5 Sparse Factorization Algorithms . 112 6.6AdditionalNotes...........................117 7 Forward Dynamics — Propagation Methods 119 7.1Articulated-BodyInertia.......................119 7.2 Calculating Articulated-Body Inertias . 123 7.3TheArticulated-BodyAlgorithm..................128 7.4AlternativeAssemblyFormulae...................131 7.5MultipleHandles...........................136 8 Closed Loop Systems 141 8.1EquationsofMotion.........................141 8.2LoopConstraintEquations.....................143 8.3 Constraint Stabilization . 145 8.4LoopJointForces...........................148 8.5SolvingtheEquationsofMotion..................149 8.6 Algorithm for C − τ a ........................152 8.7 Algorithm for K and k .......................154 8.8 Algorithm for G and g ........................156 8.9 Exploiting Sparsity in K and G ..................158 8.10 Some Properties of Closed-Loop Systems . 159 CONTENTS ix 8.11LoopClosureFunctions.......................161 8.12InverseDynamics...........................164 8.13SparseMatrixMethod........................166 9 Hybrid Dynamics and Other Topics 171 9.1HybridDynamics...........................171 9.2 Articulated-Body Hybrid Dynamics . 176 9.3FloatingBases............................179 9.4Floating-BaseForwardDynamics..................181 9.5Floating-BaseInverseDynamics...................183 9.6Gears.................................186 9.7DynamicEquivalence.........................189 10 Accuracy and Efficiency 195 10.1SourcesofError...........................196 10.2TheSensitivityProblem.......................199 10.3Efficiency...............................201 10.4SymbolicSimplification.......................209 11 Contact and Impact 213 11.1SinglePointContact.........................213 11.2MultiplePointContacts.......................216 11.3 A Rigid-Body System with Contacts . 219 11.4InequalityConstraints........................222 11.5SolvingContactEquations......................224 11.6ContactGeometry..........................227 11.7ImpulsiveDynamics.........................230 11.8SoftContact.............................235 11.9FurtherReading...........................239 A Spatial Vector Arithmetic 241 A.1SimplePlanarArithmetic......................241 A.2SimpleSpatialArithmetic......................243 A.3CompactRepresentations......................245 A.4AxialScrewTransforms.......................249 A.5SomeEfficiencyTricks........................252 Bibliography 257 Symbols 265 Index 267 Chapter 1 Introduction Rigid-body dynamics is an old subject that has been rejuvenated and trans- formed by the computer. Today, we can find dynamics calculations in computer games, in animation and virtual-reality software,
Recommended publications
  • Forward and Inverse Dynamics of a Six-Axis Accelerometer Based on a Parallel Mechanism
    sensors Article Forward and Inverse Dynamics of a Six-Axis Accelerometer Based on a Parallel Mechanism Linkang Wang 1 , Jingjing You 1,* , Xiaolong Yang 2, Huaxin Chen 1, Chenggang Li 3 and Hongtao Wu 3 1 College of Mechanical and Electronic Engineering, Nanjing Forestry University, Nanjing 210037, China; [email protected] (L.W.); [email protected] (H.C.) 2 School of Mechanical Engineering, Nanjing University of Science and Technology, Nanjing 210037, China; [email protected] 3 School of Mechanical and Electrical Engineering, Nanjing University of Aeronautics and Astronautics, Nanjing 210016, China; [email protected] (C.L.); [email protected] (H.W.) * Correspondence: [email protected] Abstract: The solution of the dynamic equations of the six-axis accelerometer is a prerequisite for sensor calibration, structural optimization, and practical application. However, the forward dynamic equations (FDEs) and inverse dynamic equations (IDEs) of this type of system have not been completely solved due to the strongly nonlinear coupling relationship between the inputs and outputs. This article presents a comprehensive study of the FDEs and IDEs of the six-axis accelerometer based on a parallel mechanism. Firstly, two sets of dynamic equations of the sensor are constructed based on the Newton–Euler method in the configuration space. Secondly, based on the analytical solution of the sensor branch chain length, the coordination equation between the output signals of the branch chain is constructed. The FDEs of the sensor are established by combining the coordination equations and two sets of dynamic equations. Furthermore, by introducing generalized momentum and Hamiltonian function and using Legendre transformation, the vibration differential equations (VDEs) of the sensor are derived.
    [Show full text]
  • Lie Group Formulation of Articulated Rigid Body Dynamics
    Lie Group Formulation of Articulated Rigid Body Dynamics Junggon Kim 12/10/2012, Ver 2.01 Abstract It has been usual in most old-style text books for dynamics to treat the formulas describing linear(or translational) and angular(or rotational) motion of a rigid body separately. For example, the famous Newton's 2nd law, f = ma, for the translational motion of a rigid body has its partner, so-called the Euler's equation which describes the rotational motion of the body. Separating translation and rotation, however, causes a huge complexity in deriving the equations of motion of articulated rigid body systems such as robots. In Section1, an elegant single equation of motion of a rigid body moving in 3D space is derived using a Lie group formulation. In Section2, the recursive Newton-Euler algorithm (inverse dynamics), Articulated-Body algorithm (forward dynamics) and a generalized recursive algorithm (hybrid dynamics) for open chains or tree-structured articulated body systems are rewritten with the geometric formulation for rigid body. In Section3, dynamics of constrained systems such as a closed loop mechanism will be described. Finally, in Section4, analytic derivatives of the dynamics algorithms, which would be useful for optimization and sensitivity analysis, are presented.1 1 Dynamics of a Rigid Body This section describes the equations of motion of a single rigid body in a geometric manner. 1.1 Rigid Body Motion To describe the motion of a rigid body, we need to represent both the position and orien- tation of the body. Let fBg be a coordinate frame attached to the rigid body and fAg be an arbitrary coordinate frame, and all coordinate frames will be right-handed Cartesian from now on.
    [Show full text]
  • Rigid Body Dynamics 2
    Rigid Body Dynamics 2 CSE169: Computer Animation Instructor: Steve Rotenberg UCSD, Winter 2017 Cross Product & Hat Operator Derivative of a Rotating Vector Let’s say that vector r is rotating around the origin, maintaining a fixed distance At any instant, it has an angular velocity of ω ω dr r ω r dt ω r Product Rule The product rule of differential calculus can be extended to vector and matrix products as well da b da db b a dt dt dt dab da db b a dt dt dt dA B dA dB B A dt dt dt Rigid Bodies We treat a rigid body as a system of particles, where the distance between any two particles is fixed We will assume that internal forces are generated to hold the relative positions fixed. These internal forces are all balanced out with Newton’s third law, so that they all cancel out and have no effect on the total momentum or angular momentum The rigid body can actually have an infinite number of particles, spread out over a finite volume Instead of mass being concentrated at discrete points, we will consider the density as being variable over the volume Rigid Body Mass With a system of particles, we defined the total mass as: n m m i i1 For a rigid body, we will define it as the integral of the density ρ over some volumetric domain Ω m d Angular Momentum The linear momentum of a particle is 퐩 = 푚퐯 We define the moment of momentum (or angular momentum) of a particle at some offset r as the vector 퐋 = 퐫 × 퐩 Like linear momentum, angular momentum is conserved in a mechanical system If the particle is constrained only
    [Show full text]
  • Existence and Uniqueness of Rigid-Body Dynamics With
    EXISTENCE AND UNIQUENESS OF RIGIDBODY DYNAMICS WITH COULOMB FRICTION Pierre E Dup ont Aerospace and Mechanical Engineering Boston University Boston MA USA ABSTRACT For motion planning and verication as well as for mo delbased control it is imp ortanttohavean accurate dynamic system mo del In many cases friction is a signicant comp onent of the mo del When considering the solution of the rigidb o dy forward dynamics problem in systems such as rob ots wecan often app eal to the fundamental theorem of dierential equations to prove the existence and uniqueness of the solution It is known however that when Coulomb friction is added to the dynamic equations the forward dynamic solution may not exist and if it exists it is not necessarily unique In these situations the inverse dynamic problem is illp osed as well Thus there is the need to understand the nature of the existence and uniqueness problems and to know under what conditions these problems arise In this pap er we show that even single degree of freedom systems can exhibit existence and uniqueness problems Next weintro duce compliance in the otherwise rigidb o dy mo del This has two eects First the forward and inverse problems b ecome wellp osed Thus we are guaranteed unique solutions Secondlyweshow that the extra dynamic solutions asso ciated with the rigid mo del are unstable INTRODUCTION To plan motions one needs to know what dynamic b ehavior will o ccur as the result of applying given forces or torques to the system In addition the simulation of motions is useful to verify motion
    [Show full text]
  • Newton Euler Equations of Motion Examples
    Newton Euler Equations Of Motion Examples Alto and onymous Antonino often interloping some obligations excursively or outstrikes sunward. Pasteboard and Sarmatia Kincaid never flits his redwood! Potatory and larboard Leighton never roller-skating otherwhile when Trip notarizes his counterproofs. Velocity thus resulting in the tumbling motion of rigid bodies. Equations of motion Euler-Lagrange Newton-Euler Equations of motion. Motion of examples of experiments that a random walker uses cookies. Forces by each other two examples of example are second kind, we will refer to specify any parameter in. 213 Translational and Rotational Equations of Motion. Robotics Lecture Dynamics. Independence from a thorough description and angular velocity as expected or tofollowa userdefined behaviour does it only be loaded geometry in an appropriate cuts in. An interface to derive a particular instance: divide and author provides a positive moment is to express to output side can be run at all previous step. The analysis of rotational motions which make necessary to decide whether rotations are. For xddot and whatnot in which a very much easier in which together or arena where to use them in two backwards operation complies with respect to rotations. Which influence of examples are true, is due to independent coordinates. On sameor adjacent joints at each moment equation is also be more specific white ellipses represent rotations are unconditionally stable, for motion break down direction. Unit quaternions or Euler parameters are known to be well suited for the. The angular momentum and time and runnable python code. The example will be run physics examples are models can be symbolic generator runs faster rotation kinetic energy.
    [Show full text]
  • Leonhard Euler - Wikipedia, the Free Encyclopedia Page 1 of 14
    Leonhard Euler - Wikipedia, the free encyclopedia Page 1 of 14 Leonhard Euler From Wikipedia, the free encyclopedia Leonhard Euler ( German pronunciation: [l]; English Leonhard Euler approximation, "Oiler" [1] 15 April 1707 – 18 September 1783) was a pioneering Swiss mathematician and physicist. He made important discoveries in fields as diverse as infinitesimal calculus and graph theory. He also introduced much of the modern mathematical terminology and notation, particularly for mathematical analysis, such as the notion of a mathematical function.[2] He is also renowned for his work in mechanics, fluid dynamics, optics, and astronomy. Euler spent most of his adult life in St. Petersburg, Russia, and in Berlin, Prussia. He is considered to be the preeminent mathematician of the 18th century, and one of the greatest of all time. He is also one of the most prolific mathematicians ever; his collected works fill 60–80 quarto volumes. [3] A statement attributed to Pierre-Simon Laplace expresses Euler's influence on mathematics: "Read Euler, read Euler, he is our teacher in all things," which has also been translated as "Read Portrait by Emanuel Handmann 1756(?) Euler, read Euler, he is the master of us all." [4] Born 15 April 1707 Euler was featured on the sixth series of the Swiss 10- Basel, Switzerland franc banknote and on numerous Swiss, German, and Died Russian postage stamps. The asteroid 2002 Euler was 18 September 1783 (aged 76) named in his honor. He is also commemorated by the [OS: 7 September 1783] Lutheran Church on their Calendar of Saints on 24 St. Petersburg, Russia May – he was a devout Christian (and believer in Residence Prussia, Russia biblical inerrancy) who wrote apologetics and argued Switzerland [5] forcefully against the prominent atheists of his time.
    [Show full text]
  • Investigation Into the Utility of the MSC ADAMS Dynamic Software for Simulating
    Investigation into the Utility of the MSC ADAMS Dynamic Software for Simulating Robots and Mechanisms A thesis presented to The faculty of The Russ College of Engineering and Technology of Ohio University In partial fulfillment of the requirements for the degree Master of Science Xiao Xue May 2013 © 2013 Xiao Xue. All Rights Reserved 2 This thesis titled Investigation into the Utility of the MSC ADAMS Dynamic Software for Simulating Robots and Mechanisms by XIAO XUE has been approved for the Department of Mechanical Engineering and the Russ College of Engineering and Technology by Robert L. Williams II Professor of Mechanical Engineering Dennis Irwin Dean, Russ College of Engineering and Technology 3 ABSTRACT XUE, XIAO, M.S., May 2013, Mechanical Engineering Investigation into the Utility of the MSC ADAMS Dynamic Software for Simulating Robots and Mechanisms (pp.143) Director of Thesis: Robert L. Williams II A Slider-Crank mechanism, a 4-bar mechanism, a 2R planar serial robot and a Stewart-Gough parallel manipulator are modeled and simulated in MSC ADAMS/View. Forward dynamics simulation is done on the Stewart-Gough parallel manipulator; Inverse dynamics simulation is done on Slider-Crank mechanism, 2R planar serial robot and 4- bar mechanism. In forward dynamics simulation, the forces are applied in prismatic joints and the Stewart-Gough parallel manipulator is actuated to perform 4 different expected motions. The motion of the platform is measured and compared with the results in MATLAB. An example of inverse dynamics simulation is also performed on it. In the inverse dynamics simulation, the Slider-Crank mechanism and four-bar mechanism both run with constant input angular velocity and the actuating forces are measured and compared with the results in MATLAB.
    [Show full text]
  • Lecture L27 - 3D Rigid Body Dynamics: Kinetic Energy; Instability; Equations of Motion
    J. Peraire, S. Widnall 16.07 Dynamics Fall 2008 Version 2.0 Lecture L27 - 3D Rigid Body Dynamics: Kinetic Energy; Instability; Equations of Motion 3D Rigid Body Dynamics In Lecture 25 and 26, we laid the foundation for our study of the three-dimensional dynamics of rigid bodies by: 1.) developing the framework for the description of changes in angular velocity due to a general motion of a three-dimensional rotating body; and 2.) developing the framework for the effects of the distribution of mass of a three-dimensional rotating body on its motion, defining the principal axes of a body, the inertia tensor, and how to change from one reference coordinate system to another. We now undertake the description of angular momentum, moments and motion of a general three-dimensional rotating body. We approach this very difficult general problem from two points of view. The first is to prescribe the motion in term of given rotations about fixed axes and solve for the force system required to sustain this motion. The second is to study the ”free” motions of a body in a simple force field such as gravitational force acting through the center of mass or ”free” motion such as occurs in a ”zero-g” environment. The typical problems in this second category involve gyroscopes and spinning tops. The second set of problems is by far the more difficult. Before we begin this general approach, we examine a case where kinetic energy can give us considerable insight into the behavior of a rotating body. This example has considerable practical importance and its neglect has been the cause of several system failures.
    [Show full text]
  • An Inverse Dynamics Model for the Analysis, Reconstruction and Prediction of Bipedal Walking
    Pergamon J. Biomechanics, Vol. 28, No. 11, pp. 1369%1376,1995 Copyri& 0 1995 Elsevicr Science Ltd hinted in Great Britain. All rifits reserved 0021-9290/95 $9.50 + .oO 0021-9290(94)00185-J AN INVERSE DYNAMICS MODEL FOR THE ANALYSIS, RECONSTRUCTION AND PREDICTION OF BIPEDAL WALKING Bart Koopman, Henk .I. Grootenboer and Henk J. de Jongh University of Twente, Faculty of Mechanical Engineering, Laboratory of Biomedical Engineering, P.O. Box 217,750O AE Enschede, The Netherlands Abstract-Walkingis a constrainedmovement which may best be observed during the double stance phase when both feet contact the floor. When analyzing a measured movement with an inverse dynamics model, a violation of these constraints will always occur due to measuring errors and deviations of the segments model from reality, leading to inconsistent results. Consistency is obtained by implementing the constraints into the model. This makes it possible to combine the inverse dynamics model with optimization techniques in order to predict walking patterns or to reconstruct non-measured rotations when only a part of the three-dimensional joint rotations is measured. In this paper the outlines of the extended inverse dynamics method are presented, the constraints which detine walking are defined and the optimization procedure is described. The model is applied to analyze a normal walking pattern of which only the hip, knee and ankle flexions/extensions are measured. This input movement is reconstructed to a kinematically and dynam- ically consistent three-dimensional movement, and the joint forces (including the ground reaction forces) and joint moments of force, needed to bring about thts movement are estimated.
    [Show full text]
  • 8.09(F14) Chapter 2: Rigid Body Dynamics
    Chapter 2 Rigid Body Dynamics 2.1 Coordinates of a Rigid Body A set of N particles forms a rigid body if the distance between any 2 particles is fixed: rij ≡ jri − rjj = cij = constant: (2.1) Given these constraints, how many generalized coordinates are there? If we know 3 non-collinear points in the body, the remaing points are fully determined by triangulation. The first point has 3 coordinates for translation in 3 dimensions. The second point has 2 coordinates for spherical rotation about the first point, as r12 is fixed. The third point has one coordinate for circular rotation about the axis of r12, as r13 and r23 are fixed. Hence, there are 6 independent coordinates, as represented in Fig. 2.1. This result is independent of N, so this also applies to a continuous body (in the limit of N ! 1). Figure 2.1: 3 non-collinear points can be fully determined by using only 6 coordinates. Since the distances between any two other points are fixed in the rigid body, any other point of the body is fully determined by the distance to these 3 points. 29 CHAPTER 2. RIGID BODY DYNAMICS The translations of the body require three spatial coordinates. These translations can be taken from any fixed point in the body. Typically the fixed point is the center of mass (CM), defined as: 1 X R = m r ; (2.2) M i i i where mi is the mass of the i-th particle and ri the position of that particle with respect to a fixed origin and set of axes (which will notationally be unprimed) as in Fig.
    [Show full text]
  • 2D Rigid Body Dynamics: Work and Energy
    J. Peraire, S. Widnall 16.07 Dynamics Fall 2008 Version 1.0 Lecture L22 - 2D Rigid Body Dynamics: Work and Energy In this lecture, we will revisit the principle of work and energy introduced in lecture L11-13 for particle dynamics, and extend it to 2D rigid body dynamics. Kinetic Energy for a 2D Rigid Body We start by recalling the kinetic energy expression for a system of particles derived in lecture L11, n 1 2 X 1 02 T = mvG + mir_i ; 2 2 i=1 0 where n is the total number of particles, mi denotes the mass of particle i, and ri is the position vector of Pn particle i with respect to the center of mass, G. Also, m = i=1 mi is the total mass of the system, and vG is the velocity of the center of mass. The above expression states that the kinetic energy of a system of particles equals the kinetic energy of a particle of mass m moving with the velocity of the center of mass, plus the kinetic energy due to the motion of the particles relative to the center of mass, G. For a 2D rigid body, the velocity of all particles relative to the center of mass is a pure rotation. Thus, we can write 0 0 r_ i = ! × ri: Therefore, we have n n n X 1 02 X 1 0 0 X 1 02 2 mir_i = mi(! × ri) · (! × ri) = miri ! ; 2 2 2 i=1 i=1 i=1 0 Pn 02 where we have used the fact that ! and ri are perpendicular.
    [Show full text]
  • AN ALGORITHM for the INVERSE DYNAMICS of N-AXIS GENERAL MANIPULATORS USING KANE's EQUATIONS
    Computers Math. Applic. Vol. 17, No. 12, pp. 1545-1561, 1989 0097-4943/89 $3.00 + 0.00 Printed in Great Britain. All rights reserved Copyright © 1989 Pergamon Press plc AN ALGORITHM FOR THE INVERSE DYNAMICS OF n-AXIS GENERAL MANIPULATORS USING KANE'S EQUATIONS J. ANGELES and O. MA Department of Mechanical Engineering, Robotic Mechanical Systems Laboratory, McGill Research Centre for Intelligent Machines, McGill University, Montrral, Qurbec, Canada A. ROJAS National Autonomous University of Mexico, Villa Obregrn, Mexico (Received 4 April 1988) Abstract--Presented in this paper is an algorithm for the numerical solution of the inverse dynamics of robotic manipulators of the serial type, but otherwise arbitrary. The algorithm is applicable to manipulators containing n joints of the rotational or the prismatic type. For a given set of Hartenberg- Denavit and inertial parameters, as well as for a given trajectory in the space of joint coordinates, the algorithm produces the time histories of the n torques or forces required to drive the manipulator through the prescribed trajectory. The algorithm is based on Kane's dynamical equations of mechanical multibody systems. Moreover, the complexityof the algorithm presented here is lower than that of the most ett~cient inverse-dynamics algorithm reported in the literature. Finally, the applicability of the algorithm is illustrated with two fully solved examples. 1. INTRODUCTION The inverse dynamics of robotic manipulators has been approached with a variety of methods, the most widely applied being those based on the Newton-Euler (NE) and the Euler-Lagrange (EL) formulations [1-11]. Although essentially equivalent [12], the two said formulations regard the dynamics problems associated with rigid-link manipulators from very different viewpoints.
    [Show full text]