1,130 research outputs found

    Reachability-based Trajectory Design

    Full text link
    Autonomous mobile robots have the potential to increase the availability and accessibility of goods and services throughout society. However, to enable public trust in such systems, it is critical to certify that they are safe. This requires formally specifying safety, and designing motion planning methods that can guarantee safe operation (note, this work is only concerned with planning, not perception). The typical paradigm to attempt to ensure safety is receding-horizon planning, wherein a robot creates a short plan, then executes it while creating its next short plan in an iterative fashion, allowing a robot to incorporate new sensor information over time. However, this requires a robot to plan in real time. Therefore, the key challenge in making safety guarantees lies in balancing performance (how quickly a robot can plan) and conservatism (how cautiously a robot behaves). Existing methods suffer from a tradeoff between performance and conservatism, which is rooted in the choice of model used describe a robot; accuracy typically comes at the price of computation speed. To address this challenge, this dissertation proposes Reachability-based Trajectory Design (RTD), which performs real-time, receding-horizon planning with a simplified planning model, and ensures safety by describing the model error using a reachable set of the robot. RTD begins with the offline design of a continuum of parameterized trajectories for the plan- ning model; each trajectory ends with a fail-safe maneuver such as braking to a stop. RTD then computes the robot’s Forward Reachable Set (FRS), which contains all points in workspace reach- able by the robot for each parameterized trajectory. Importantly, the FRS also contains the error model, since a robot can typically never track planned trajectories perfectly. Online (at runtime), the robot intersects the FRS with sensed obstacles to provably determine which trajectory plans could cause collisions. Then, the robot performs trajectory optimization over the remaining safe trajectories. If no new safe plan can be found, the robot can execute its previously-found fail-safe maneuver, enabling perpetual safety. This dissertation begins by presenting RTD as a theoretical framework, then presents three representations of a robot’s FRS, using (1) sums-of-squares (SOS) polynomial programming, (2) zonotopes (a special type of convex polytope), and (3) rotatotopes (a generalization of zonotopes that enable representing a robot’s swept volume). To enable real-time planning, this work also de- velops an obstacle representation that enables provable safety while treating obstacles as discrete, finite sets of points. The practicality of RTD is demonstrated on four different wheeled robots (using the SOS FRS), two quadrotor aerial robots (using the zonotope FRS), and one manipulator robot (using the rotatotope FRS). Over thousands of simulations and dozens of hardware trials, RTD performs safe, real-time planning in arbitrary and challenging environments. In summary, this dissertation proposes RTD as a general purpose, practical framework for provably safe, real-time robot motion planning.PHDMechanical EngineeringUniversity of Michigan, Horace H. Rackham School of Graduate Studieshttp://deepblue.lib.umich.edu/bitstream/2027.42/162884/1/skousik_1.pd

    A New Method for Generating Safe Motions for Humanoid Robots

    Get PDF
    International audienceThis paper introduces a new method for planning safe motions for complex systems such as humanoid robots. Motion planning can be seen as a Semi-Infinite Programming problem (SIP) since it involves a finite number of variables over an infinite set of constraints. Most methods solve the SIP problem by transforming it into a finite programming one by using a discretization over a prescribed grid. We show that this approach is risky because it can lead to motions which violate one or several constraints. Then we introduce our new method for planning safe motions. It uses Interval Analysis techniques in order to achieve a safe discretization of the constraints. We show how to implement this method and use it with state-of-the-art constrained optimization packages. Then, we illustrate its capabilities for planning safe motions for the HOAP-3 humanoid robot

    Safe Motion Planning Computation for Databasing Balanced Movement of Humanoid Robots

    Get PDF
    International audienceMotion databasing is an important topic in robotics research. Humanoid robots have a large number of degrees of freedom and their motions have to satisfy a set of constraints (balance, maximal joint torque velocity and angle values). Thus motion planning cannot efficiently be done on-line. The computation of optimal motions is performed off-line to create databases that transform the problem of large computation time into a problem of large memory space. Motion planning can be seen as a Semi-Infinite Programming problem (SIP) since it involves a finite number of variables over an infinite set of constraints. Most methods solve the SIP problem by transforming it into a finite programming one using a discretization over a prescribed grid. We show that this approach is risky because it can lead to motions which may violate one or several constraints. Then we introduce our new method for planning safe motions. It uses Interval Analysis techniques in order to achieve a safe discretization of the constraints. We show how to implement this method and use it with state-of-the-art constrained optimization packages. Then, we illustrate its capabilities for planning safe motions dedicated to the HOAP-3 humanoid 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

    Self-motion control of kinematically redundant robot manipulators

    Get PDF
    Thesis (Master)--Izmir Institute of Technology, Mechanical Engineering, Izmir, 2012Includes bibliographical references (leaves: 88-92)Text in English; Abstract: Turkish and Englishxvi,92 leavesRedundancy in general provides space for optimization in robotics. Redundancy can be defined as sensor/actuator redundancy or kinematic redundancy. The redundancy considered in this thesis is the kinematic redundancy where the total degrees-of-freedom of the robot is more than the total degrees-of-freedom required for the task to be executed. This provides infinite number of solutions to perform the same task, thus, various subtasks can be carried out during the main-task execution. This work utilizes the property of self-motion for kinematically redundant robot manipulators by designing the general subtask controller that controls the joint motion in the null-space of the Jacobian matrix. The general subtask controller is implemented for various subtasks in this thesis. Minimizing the total joint motion, singularity avoidance, posture optimization for static impact force objectives, which include maximizing/minimizing the static impact force magnitude, and static and moving obstacle (point to point) collision avoidance are the subtasks considered in this thesis. New control architecture is developed to accomplish both the main-task and the previously mentioned subtasks. In this architecture, objective function for each subtask is formed. Then, the gradient of the objective function is used in the subtask controller to execute subtask objective while tracking a given end-effector trajectory. The tracking of the end-effector is called main-task. The SCHUNK LWA4-Arm robot arm with seven degrees-of-freedom is developed first in SolidWorks® as a computer-aided-design (CAD) model. Then, the CAD model is converted to MATLAB® Simulink model using SimMechanics CAD translator to be used in the simulation tests of the controller. Kinematics and dynamics equations of the robot are derived to be used in the controllers. Simulation test results are presented for the kinematically redundant robot manipulator operating in 3D space carrying out the main-task and the selected subtasks for this study. The simulation test results indicate that the developed controller’s performance is successful for all the main-task and subtask objectives

    Trajectory planning for industrial robot using genetic algorithms

    Full text link
    En las últimas décadas, debido la importancia de sus aplicaciones, se han propuesto muchas investigaciones sobre la planificación de caminos y trayectorias para los manipuladores, algunos de los ámbitos en los que pueden encontrarse ejemplos de aplicación son; la robótica industrial, sistemas autónomos, creación de prototipos virtuales y diseño de fármacos asistido por ordenador. Por otro lado, los algoritmos evolutivos se han aplicado en muchos campos, lo que motiva el interés del autor por investigar sobre su aplicación a la planificación de caminos y trayectorias en robots industriales. En este trabajo se ha llevado a cabo una búsqueda exhaustiva de la literatura existente relacionada con la tesis, que ha servido para crear una completa base de datos utilizada para realizar un examen detallado de la evolución histórica desde sus orígenes al estado actual de la técnica y las últimas tendencias. Esta tesis presenta una nueva metodología que utiliza algoritmos genéticos para desarrollar y evaluar técnicas para la planificación de caminos y trayectorias. El conocimiento de problemas específicos y el conocimiento heurístico se incorporan a la codificación, la evaluación y los operadores genéticos del algoritmo. Esta metodología introduce nuevos enfoques con el objetivo de resolver el problema de la planificación de caminos y la planificación de trayectorias para sistemas robóticos industriales que operan en entornos 3D con obstáculos estáticos, y que ha llevado a la creación de dos algoritmos (de alguna manera similares, con algunas variaciones), que son capaces de resolver los problemas de planificación mencionados. El modelado de los obstáculos se ha realizado mediante el uso de combinaciones de objetos geométricos simples (esferas, cilindros, y los planos), de modo que se obtiene un algoritmo eficiente para la prevención de colisiones. El algoritmo de planificación de caminos se basa en técnicas de optimización globales, usando algoritmos genéticos para minimizar una función objetivo considerando restricciones para evitar las colisiones con los obstáculos. El camino está compuesto de configuraciones adyacentes obtenidas mediante una técnica de optimización construida con algoritmos genéticos, buscando minimizar una función multiobjetivo donde intervienen la distancia entre los puntos significativos de las dos configuraciones adyacentes, así como la distancia desde los puntos de la configuración actual a la final. El planteamiento del problema mediante algoritmos genéticos requiere de una modelización acorde al procedimiento, definiendo los individuos y operadores capaces de proporcionar soluciones eficientes para el problema.Abu-Dakka, FJM. (2011). Trajectory planning for industrial robot using genetic algorithms [Tesis doctoral no publicada]. Universitat Politècnica de València. https://doi.org/10.4995/Thesis/10251/10294Palanci

    NASA Center for Intelligent Robotic Systems for Space Exploration

    Get PDF
    NASA's program for the civilian exploration of space is a challenge to scientists and engineers to help maintain and further develop the United States' position of leadership in a focused sphere of space activity. Such an ambitious plan requires the contribution and further development of many scientific and technological fields. One research area essential for the success of these space exploration programs is Intelligent Robotic Systems. These systems represent a class of autonomous and semi-autonomous machines that can perform human-like functions with or without human interaction. They are fundamental for activities too hazardous for humans or too distant or complex for remote telemanipulation. To meet this challenge, Rensselaer Polytechnic Institute (RPI) has established an Engineering Research Center for Intelligent Robotic Systems for Space Exploration (CIRSSE). The Center was created with a five year $5.5 million grant from NASA submitted by a team of the Robotics and Automation Laboratories. The Robotics and Automation Laboratories of RPI are the result of the merger of the Robotics and Automation Laboratory of the Department of Electrical, Computer, and Systems Engineering (ECSE) and the Research Laboratory for Kinematics and Robotic Mechanisms of the Department of Mechanical Engineering, Aeronautical Engineering, and Mechanics (ME,AE,&M), in 1987. This report is an examination of the activities that are centered at CIRSSE

    Dynamic movement primitives: volumetric obstacle avoidance

    Get PDF
    Dynamic Movement Primitives (DMPs) are a framework for learning a trajectory from a demonstration. The trajectory can be learned efficiently after only one demonstration, and it is immediate to adapt it to new goal positions and time duration. Moreover, the trajectory is also robust against perturbations. However, obstacle avoidance for DMPs is still an open problem. In this work, we propose an extension of DMPs to support volumetric obstacle avoidance based on the use of superquadric potentials. We show the advantages of this approach when obstacles have known shape, and we extend it to unknown objects using minimal enclosing ellipsoids. A simulation and experiments with a real robot validate the framework, and we make freely available our implementation

    Advanced Strategies for Robot Manipulators

    Get PDF
    Amongst the robotic systems, robot manipulators have proven themselves to be of increasing importance and are widely adopted to substitute for human in repetitive and/or hazardous tasks. Modern manipulators are designed complicatedly and need to do more precise, crucial and critical tasks. So, the simple traditional control methods cannot be efficient, and advanced control strategies with considering special constraints are needed to establish. In spite of the fact that groundbreaking researches have been carried out in this realm until now, there are still many novel aspects which have to be explored

    Optimal Motion Planning for Manipulator Arms Using Nonlinear Programming

    Get PDF
    corecore