592 research outputs found

    A Quadratic Programming Approach to Quasi-Static Whole-Body Manipulation

    Get PDF
    This paper introduces a local motion planning method for robotic systems with manipulating limbs, moving bases (legged or wheeled), and stance stability constraints arising from the presence of gravity. We formulate the problem of selecting local motions as a linearly constrained quadratic program (QP), that can be solved efficiently. The solution to this QP is a tuple of locally optimal joint velocities. By using these velocities to step towards a goal, both a path and an inverse-kinematic solution to the goal are obtained. This formulation can be used directly for real-time control, or as a local motion planner to connect waypoints. This method is particularly useful for high-degree-of-freedom mobile robotic systems, as the QP solution scales well with the number of joints. We also show how a number of practically important geometric constraints (collision avoidance, mechanism self-collision avoidance, gaze direction, etc.) can be readily incorporated into either the constraint or objective parts of the formulation. Additionally, motion of the base, a particular joint, or a particular link can be encouraged/discouraged as desired. We summarize the important kinematic variables of the formulation, including the stance Jacobian, the reach Jacobian, and a center of mass Jacobian. The method is easily extended to provide sparse solutions, where the fewest number of joints are moved, by iteration using Tibshirani’s method to accommodate an l_1 regularizer. The approach is validated and demonstrated on SURROGATE, a mobile robot with a TALON base, a 7 DOF serial-revolute torso, and two 7 DOF modular arms developed at JPL/Caltech

    A General Framework for Hierarchical Redundancy Resolution Under Arbitrary Constraints

    Full text link
    The increasing interest in autonomous robots with a high number of degrees of freedom for industrial applications and service robotics demands control algorithms to handle multiple tasks as well as hard constraints efficiently. This paper presents a general framework in which both kinematic (velocity- or acceleration-based) and dynamic (torque-based) control of redundant robots are handled in a unified fashion. The framework allows for the specification of redundancy resolution problems featuring a hierarchy of arbitrary (equality and inequality) constraints, arbitrary weighting of the control effort in the cost function and an additional input used to optimize possibly remaining redundancy. To solve such problems, a generalization of the Saturation in the Null Space (SNS) algorithm is introduced, which extends the original method according to the features required by our general control framework. Variants of the developed algorithm are presented, which ensure both efficient computation and optimality of the solution. Experiments on a KUKA LBRiiwa robotic arm, as well as simulations with a highly redundant mobile manipulator are reported.Comment: 19 pages, 19 figures, submitted to the IEE

    Kontextsensitive Körperregulierung für redundante Roboter

    Get PDF
    In the past few decades the classical 6 degrees of freedom manipulators' dominance has been challenged by the rise of 7 degrees of freedom redundant robots. Similarly, with increased availability of humanoid robots in academic research, roboticists suddenly have access to highly dexterous platforms with multiple kinematic chains capable of undertaking multiple tasks simultaneously. The execution of lower-priority tasks, however, are often done in task/scenario specific fashion. Consequently, these systems are not scalable and slight changes in the application often implies re-engineering the entire control system and deployment which impedes the development process over time. This thesis introduces an alternative systematic method of addressing the secondary tasks and redundancy resolution called, context aware body regulation. Contexts consist of one or multiple tasks, however, unlike the conventional definitions, the tasks within a context are not rigidly defined and maintain some level of abstraction. For instance, following a particular trajectory constitutes a concrete task while performing a Cartesian motion with the end-effector represents an abstraction of the same task and is more appropriate for context formulation. Furthermore, contexts are often made up of multiple abstract tasks that collectively describe a reoccurring situation. Body regulation is an umbrella term for a collection of schemes for addressing the robots' redundancy when a particular context occurs. Context aware body regulation offers several advantages over traditional methods. Most notably among them are reusability, scalability and composability of contexts and body regulation schemes. These three fundamental concerns are realized theoretically by in-depth study and through mathematical analysis of contexts and regulation strategies; and are practically implemented by a component based software architecture that complements the theoretical aspects. The findings of the thesis are applicable to any redundant manipulator and humanoids, and allow them to be used in real world applications. Proposed methodology presents an alternative approach for the control of robots and offers a new perspective for future deployment of robotic solutions.Im Verlauf der letzten Jahrzehnte wich der Einfluss klassischer Roboterarme mit 6 Freiheitsgraden zunehmend denen neuer und vielfältigerer Manipulatoren mit 7 Gelenken. Ebenso stehen der Forschung mit den neuartigen Humanoiden inzwischen auch hoch-redundante Roboterplattformen mit mehreren kinematischen Ketten zur Verfügung. Diese überaus flexiblen und komplexen Roboter-Kinematiken ermöglichen generell das gleichzeitige Verfolgen mehrerer priorisierter Bewegungsaufgaben. Die Steuerung der weniger wichtigen Aufgaben erfolgt jedoch oft in anwendungsspezifischer Art und Weise, welche die Skalierung der Regelung zu generellen Kontexten verhindert. Selbst kleine Änderungen in der Anwendung bewirken oft schon, dass große Teile der Robotersteuerung überarbeitet werden müssen, was wiederum den gesamten Entwicklungsprozess behindert. Diese Dissertation stellt eine alternative, systematische Methode vor um die Redundanz neuer komplexer Robotersysteme zu bewältigen und vielfältige, priorisierte Bewegungsaufgaben parallel zu steuern: Die so genannte kontextsensitive Körperregulierung. Darin bestehen Kontexte aus einer oder mehreren Bewegungsaufgaben. Anders als in konventionellen Anwendungen sind die Aufgaben nicht fest definiert und beinhalten eine gewisse Abstraktion. Beispielsweise stellt das Folgen einer bestimmten Trajektorie eine sehr konkrete Bewegungsaufgabe dar, während die Ausführung einer Kartesischen Bewegung mit dem Endeffektor eine Abstraktion darstellt, die für die Kontextformulierung besser geeignet ist. Kontexte setzen sich oft aus mehreren solcher abstrakten Aufgaben zusammen und beschreiben kollektiv eine sich wiederholende Situation. Durch die Verwendung der kontextsensitiven Körperregulierung ergeben sich vielfältige Vorteile gegenüber traditionellen Methoden: Wiederverwendbarkeit, Skalierbarkeit, sowie Komponierbarkeit von Konzepten. Diese drei fundamentalen Eigenschaften werden in der vorliegenden Arbeit theoretisch mittels gründlicher mathematischer Analyse aufgezeigt und praktisch mittels einer auf Komponenten basierenden Softwarearchitektur realisiert. Die Ergebnisse dieser Dissertation lassen sich auf beliebige redundante Manipulatoren oder humanoide Roboter anwenden und befähigen diese damit zur realen Anwendung außerhalb des Labors. Die hier vorgestellte Methode zur Regelung von Robotern stellt damit eine neue Perspektive für die zukünftige Entwicklung von robotischen Lösungen dar

    A unified motion planning approach for redundant and non-redundant manipulators with actuator constraints

    Get PDF
    The term trajectory planning has been used to refer to the process of determining the time history of joint trajectory of each joint variable corresponding to a specified trajectory of the end effector. The trajectory planning problem was solved as a purely kinematic problem. The drawback is that there is no guarantee that the actuators can deliver the effort necessary to track the planned trajectory. To overcome this limitation, a motion planning approach which addresses the kinematics, dynamics, and feedback control of a manipulator in a unified framework was developed. Actuator constraints are taken into account explicitly and a priori in the synthesis of the feedback control law. Therefore the result of applying the motion planning approach described is not only the determination of the entire set of joint trajectories but also a complete specification of the feedback control strategy which would yield these joint trajectories without violating actuator constraints. The effectiveness of the unified motion planning approach is demonstrated on two problems which are of practical interest in manipulator robotics

    Minimum Jerk Trajectory Planning for Trajectory Constrained Redundant Robots

    Get PDF
    In this dissertation, we develop an efficient method of generating minimal jerk trajectories for redundant robots in trajectory following problems. We show that high jerk is a local phenomenon, and therefore focus on optimizing regions of high jerk that occur when using traditional trajectory generation methods. The optimal trajectory is shown to be located on the foliation of self-motion manifolds, and this property is exploited to express the problem as a minimal dimension Bolza optimal control problem. A numerical algorithm based on ideas from pseudo-spectral optimization methods is proposed and applied to two example planar robot structures with two redundant degrees of freedom. When compared with existing trajectory generation methods, the proposed algorithm reduces the integral jerk of the examples by 75% and 13%. Peak jerk is reduced by 98% and 33%. Finally a real time controller is proposed to accurately track the planned trajectory given real-time measurements of the tool-tip\u27s following error

    Safety-related Tasks within the Set-Based Task-Priority Inverse Kinematics Framework

    Full text link
    In this paper we present a framework that allows the motion control of a robotic arm automatically handling different kinds of safety-related tasks. The developed controller is based on a Task-Priority Inverse Kinematics algorithm that allows the manipulator's motion while respecting constraints defined either in the joint or in the operational space in the form of equality-based or set-based tasks. This gives the possibility to define, among the others, tasks as joint-limits, obstacle avoidance or limiting the workspace in the operational space. Additionally, an algorithm for the real-time computation of the minimum distance between the manipulator and other objects in the environment using depth measurements has been implemented, effectively allowing obstacle avoidance tasks. Experiments with a Jaco2^2 manipulator, operating in an environment where an RGB-D sensor is used for the obstacles detection, show the effectiveness of the developed system

    Ein hierarchisches Framework fĂĽr physikalische Mensch-Roboter-Interaktion

    Get PDF
    Robots are becoming more than machines performing repetitive tasks behind safety fences, and are expected to perform multiple complex tasks and work together with a human. For that purpose, modern robots are commonly built with two main characteristics: a large number of joints to increase their versatility and the capability to feel the environment through torque/force sensors. Controlling such complex robots requires the development of sophisticated frameworks capable of handling multiple tasks. Various frameworks have been proposed in the last years to deal with the redundancy caused by a large number of joints. Those hierarchical frameworks prioritize the achievement of the main task with the whole robot capability, while secondary tasks are performed as well as the remaining mobility allows it. This methodology presents considerable drawbacks in applications requiring that the robot respects constraints imposed by, e.g., safety restrictions or physical limitations. One particular case is unilateral constraints imposed by, e.g., joint or workspace limits. To implement them, task hierarchical frameworks rely on the activation of repulsive potential fields when approaching the limit. The performance of the potential field depends on the configuration and speed of the robot. Additionally, speed limitation is commonly required in collaborative scenarios, but it has been insufficiently treated for torque-controlled robots. With the aim of controlling redundant robots in collaborative scenarios, this thesis proposes a framework that handles multiple tasks under multiple constraints. The robot’s reaction to physical interaction must be intuitive and safe for humans: The robot must not impose high forces on the human or react unexpectedly to external forces. The proposed framework uses novel methods to avoid exceeding position, velocity and acceleration limits in joint and Cartesian spaces. A comparative study is carried out between different redundancy resolution solvers to contrast the diverse approaches used to solve the redundancy problem. Widely used projector-based and quadratic programming-based hierarchical solvers were experimentally analyzed when reacting to external forces. Experiments were performed using an industrial redundant collaborative robot. Results demonstrate that the proposed method to handle unilateral constraints produces a safe and expected reaction in the presence of external forces exerted by humans. The robot does not exceed the given limits, while the tasks performed are prioritized hierarchically

    An adaptive compliance Hierarchical Quadratic Programming controller for ergonomic human–robot collaboration

    Get PDF
    This paper proposes a novel Augmented Hierarchical Quadratic Programming (AHQP) framework for multi-tasking control in Human-Robot Collaboration (HRC) which integrates human-related parameters to optimize ergonomics. The aim is to combine parameters that are typical of both industrial applications (e.g. cycle times, productivity) and human comfort (e.g. ergonomics, preference), to identify an optimal trade-off. The augmentation aspect avoids the dependency from a fixed end-effector reference trajectory, which becomes part of the optimization variables and can be used to define a feasible workspace region in which physical interaction can occur. We then demonstrate that the integration of the proposed AHQP in HRC permits the addition of human ergonomics and preference. To achieve this, we develop a human ergonomics function based on the mapping of an ergonomics score, compatible with AHQP formulation. This allows to identify at control level the optimal Cartesian pose that satisfies the active objectives and constraints, that are now linked to human ergonomics. In addition, we build an adaptive compliance framework that integrates both aspects of human preferences and intentions, which are finally tested in several collaborative experiments using the redundant MOCA robot. Overall, we achieve improved human ergonomics and health conditions, aiming at the potential reduction of work-related musculoskeletal disorders

    Optimal redundancy control for robot manipulators

    Get PDF
    Optimal control for kinematically redundant robots is addressed for two different optimization problems. In the first optimization problem, we consider the minimization of the transfer time along a given Cartesian path for a redundant robot. This problem can be solved in two steps, by separating the generation of a joint path associated to the Cartesian path from the exact minimization of motion time under kinematic/dynamic bounds along the obtained parametrized joint path. In this thesis, multiple sub-optimal solutions can be found, depending on how redundancy is locally resolved in the joint space within the first step. A solution method that works at the acceleration level is proposed, by using weighted pseudoinversion, optimizing an inertia-related criterion, and including null-space damping. The obtained results demonstrate consistently good behaviors and definitely faster motion times in comparison with related methods proposed in the literature. The motion time obtained with the proposed method is close to the global time-optimal solution along the same Cartesian path. Furthermore, a reasonable tracking control performance is obtained on the experimental executed motions. In the second optimization problem, we consider the known phenomenon of torque oscillations and motion instabilities that occur in redundant robots during the execution of sufficiently long Cartesian trajectories when the joint torque is instantaneously minimized. In the framework of on-line local redundancy resolution methods, we propose basic variations of the minimum torque scheme to address this issue. Either the joint torque norm is minimized over two successive discrete-time samples using a short preview window, or we minimize the norm of the difference with respect to a desired momentum-damping joint torque, or the two schemes are combined together. The resulting local control methods are all formulated as well-posed linear-quadratic problems, and their closed-form solutions generate also low joint velocities while addressing the primary torque optimization objectives. Stable and consistent behaviors are obtained along short or long Cartesian position trajectories. For the two addressed optimization problems in this thesis, the results are obtained using three different robot systems, namely a 3R planar arm, a 6R Universal Robots UR10, and a 7R KUKA LWR robot

    AI based Robot Safe Learning and Control

    Get PDF
    Introduction This open access book mainly focuses on the safe control of robot manipulators. The control schemes are mainly developed based on dynamic neural network, which is an important theoretical branch of deep reinforcement learning. In order to enhance the safety performance of robot systems, the control strategies include adaptive tracking control for robots with model uncertainties, compliance control in uncertain environments, obstacle avoidance in dynamic workspace. The idea for this book on solving safe control of robot arms was conceived during the industrial applications and the research discussion in the laboratory. Most of the materials in this book are derived from the authors’ papers published in journals, such as IEEE Transactions on Industrial Electronics, neurocomputing, etc. This book can be used as a reference book for researcher and designer of the robotic systems and AI based controllers, and can also be used as a reference book for senior undergraduate and graduate students in colleges and universities
    • …
    corecore