454 research outputs found

    A novel multiple-heuristic approach for singularity-free motion planning of spatial parallel manipulators

    Get PDF
    The issue of motion planning for closed-loop mechanisms, such as parallel manipulators or robots, is still an open question. This paper proposes a novel approach for motion planning of spatial parallel robots. The framework for the geometric modeling is based on the visibility graph methodology. It is opted for a multiple-heuristics approach, where different influences are integrated in a multiplicative way within the heuristic cost function. Since the issue of singularities is a fundamental one for parallel robots, it is emphasized on the avoidance of such configurations. To include singularity-free planning within the heuristic approach, two heuristic functions are proposed, the inverse local dexterity as well as a novel defined "next-singularity" function, in such a way, well conditioned motions can be provided by a single planning procedure. The success of the method is illustrated by some examples. © 2008 Cambridge University Press

    Generation of the global workspace roadmap of the 3-RPR using rotary disk search

    Full text link
    Path planning for parallel manipulators in the configuration space can be a challenging task due to the existence of multiple direct kinematic solutions. Hence the aim of this paper is to define a generalised hierarchical path planning scheme for trajectory generation between two configurations in the configuration space for manipulators that exhibit more than one solution in their direct kinematics. This process is applied to the 3-RPR mechanism, constrained to a 2-DOF system by setting active joint parameter ρ1 to a constant. The overall reachable workspace is discretised and deconstructed into smaller patches, which are then stitched together creating a global workspace roadmap. Using the roadmap, path feasibility is obtained and local path planning is used to generate a complete trajectory. This method can determine a singularity-free path between any two connectible points in the configuration space, including assembly mode changes. © 2014 Elsevier Ltd

    Path planning and assembly mode-changes of 6-DOF Stewart-Gough-type parallel manipulators

    Full text link
    © 2016 International Federation for the Promotion of Mechanism and Machine Science The Stewart-Gough platform (SGP) is a six degree-of-freedom (DOF) parallel manipulator whose reachable workspace is complex due to its closed-loop configuration and six DOF outputs. As such, methods of path planning that involve storing the entire reachable workspace in memory at high resolutions are not feasible due to this six-dimensional workspace. In addition, complete path planning algorithms struggle in higher dimensional applications without significant customisations. As a result, many workspace analysis algorithms and path planning schemes use iterative techniques, particularly when tracking the manipulator's many direct kinematic solutions. The aim of this paper is to present the viability of singularity-free path planning in the Stewart-Gough platform's 6-dimensional workspace on modern-day computing systems by demonstrating its assembly mode-changing capability. The entire workspace volume is found using flood-fill algorithms with smooth and singularity-free trajectories generated within this known workspace. Workspace volume analysis was also performed with results comparable to other works

    Path planning for robotic truss assembly

    Get PDF
    A new Potential Fields approach to the robotic path planning problem is proposed and implemented. Our approach, which is based on one originally proposed by Munger, computes an incremental joint vector based upon attraction to a goal and repulsion from obstacles. By repetitively adding and computing these 'steps', it is hoped (but not guaranteed) that the robot will reach its goal. An attractive force exerted by the goal is found by solving for the the minimum norm solution to the linear Jacobian equation. A repulsive force between obstacles and the robot's links is used to avoid collisions. Its magnitude is inversely proportional to the distance. Together, these forces make the goal the global minimum potential point, but local minima can stop the robot from ever reaching that point. Our approach improves on a basic, potential field paradigm developed by Munger by using an active, adaptive field - what we will call a 'flexible' potential field. Active fields are stronger when objects move towards one another and weaker when they move apart. An adaptive field's strength is individually tailored to be just strong enough to avoid any collision. In addition to the local planner, a global planning algorithm helps the planner to avoid local field minima by providing subgoals. These subgoals are based on the obstacles which caused the local planner to fail. A best-first search algorithm A* is used for graph search

    Applications of parallel computing in robotics problems

    Get PDF
    "December 2013.""A Thesis presented to the Faculty of the Graduate School University of Missouri In Partial Fulfillment Of the Requirements for the Degree Master of Science."Thesis advisor: Dr. Guilherme N. DeSouza.Many typical robotics problems involve search in high-dimensional spaces, where real-time execution is hard to be achieved. This thesis presents two case studies of parallel computation in such robotics problems. More specifically, two problems of motion planning-the Inverse Kinematics of robotic manipulators and Path Planning for mobile robots-are investigated and the contributions of parallel algorithms are highlighted. For the Inverse Kinematics problem, a novel and fast solution is proposed for general serial manipulators. This new approach relies on the computation of multiple (parallel) numerical estimations of the inverse Jacobian while it selects the current best path to the desire con- figuration of the end-effector. Unlike other iterative methods, our method converges very quickly, achieving sub-millimeter accuracy in 20.48ms in average. We demonstrate such high accuracy and the real-time performance of our method by testing it with six different robots, at both non-singular and singular configurations, including a 7-DoF redundant robot. The algorithm is implemented in C/C++ using a configurable number of POSIX threads, and it can be easily expanded to use many-core GPUs. For the Path Planning problem, a solution to the problem of smooth path planning for mobile robots in dynamic and unknown environments is presented. A novel concept of Time-Warped Grids is introduced to predict the pose of obstacles on a grid-based map and avoid collisions. The algorithm is implemented using C/C++ and the CUDA programming environment, and combines stochastic estimation (Kalman filter), Harmonic Potential Fields and a Rubber Band model, and it translates naturally into the parallel paradigm of GPU programing. The proposed method was tested using several simulation scenarios for the Pioneer P3- DX robot, which demonstrated the robustness of the algorithm by finding the optimum path in terms of smoothness, distance, and collision-free either in static or dynamic environments, even with a very large number of obstacles.Includes bibliographical references (pages 70-78)

    Design, Control and Motion Planning for a Novel Modular Extendable Robotic Manipulator

    Get PDF
    This dissertation discusses an implementation of a design, control and motion planning for a novel extendable modular redundant robotic manipulator in space constraints, which robots may encounter for completing required tasks in small and constrained environment. The design intent is to facilitate the movement of the proposed robotic manipulator in constrained environments, such as rubble piles. The proposed robotic manipulator with multi Degree of Freedom (m-DOF) links is capable of elongating by 25% of its nominal length. In this context, a design optimization problem with multiple objectives is also considered. In order to identify the benefits of the proposed design strategy, the reachable workspace of the proposed manipulator is compared with that of the Jet Propulsion Laboratory (JPL) serpentine robot. The simulation results show that the proposed manipulator has a relatively efficient reachable workspace, needed in constrained environments. The singularity and manipulability of the designed manipulator are investigated. In this study, we investigate the number of links that produces the optimal design architecture of the proposed robotic manipulator. The total number of links decided by a design optimization can be useful distinction in practice. Also, we have considered a novel robust bio-inspired Sliding Mode Control (SMC) to achieve favorable tracking performance for a class of robotic manipulators with uncertainties. To eliminate the chattering problem of the conventional sliding mode control, we apply the Brain Emotional Learning Based Intelligent Control (BELBIC) to adaptively adjust the control input law in sliding mode control. The on-line computed parameters achieve favorable system robustness in process of parameter uncertainties and external disturbances. The simulation results demonstrate that our control strategy is effective in tracking high speed trajectories with less chattering, as compared to the conventional sliding mode control. The learning process of BLS is shown to enhance the performance of a new robust controller. Lastly, we consider the potential field methodology to generate a desired trajectory in small and constrained environments. Also, Obstacle Collision Avoidance (OCA) is applied to obtain an inverse kinematic solution of a redundant robotic manipulator

    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

    Selected topics in robotics for space exploration

    Get PDF
    Papers and abstracts included represent both formal presentations and experimental demonstrations at the Workshop on Selected Topics in Robotics for Space Exploration which took place at NASA Langley Research Center, 17-18 March 1993. The workshop was cosponsored by the Guidance, Navigation, and Control Technical Committee of the NASA Langley Research Center and the Center for Intelligent Robotic Systems for Space Exploration (CIRSSE) at RPI, Troy, NY. Participation was from industry, government, and other universities with close ties to either Langley Research Center or to CIRSSE. The presentations were very broad in scope with attention given to space assembly, space exploration, flexible structure control, and telerobotics

    Inverse Kinematic Analysis of Robot Manipulators

    Get PDF
    An important part of industrial robot manipulators is to achieve desired position and orientation of end effector or tool so as to complete the pre-specified task. To achieve the above stated goal one should have the sound knowledge of inverse kinematic problem. The problem of getting inverse kinematic solution has been on the outline of various researchers and is deliberated as thorough researched and mature problem. There are many fields of applications of robot manipulators to execute the given tasks such as material handling, pick-n-place, planetary and undersea explorations, space manipulation, and hazardous field etc. Moreover, medical field robotics catches applications in rehabilitation and surgery that involve kinematic, dynamic and control operations. Therefore, industrial robot manipulators are required to have proper knowledge of its joint variables as well as understanding of kinematic parameters. The motion of the end effector or manipulator is controlled by their joint actuator and this produces the required motion in each joints. Therefore, the controller should always supply an accurate value of joint variables analogous to the end effector position. Even though industrial robots are in the advanced stage, some of the basic problems in kinematics are still unsolved and constitute an active focus for research. Among these unsolved problems, the direct kinematics problem for parallel mechanism and inverse kinematics for serial chains constitute a decent share of research domain. The forward kinematics of robot manipulator is simpler problem and it has unique or closed form solution. The forward kinematics can be given by the conversion of joint space to Cartesian space of the manipulator. On the other hand inverse kinematics can be determined by the conversion of Cartesian space to joint space. The inverse kinematic of the robot manipulator does not provide the closed form solution. Hence, industrial manipulator can achieve a desired task or end effector position in more than one configuration. Therefore, to achieve exact solution of the joint variables has been the main concern to the researchers. A brief introduction of industrial robot manipulators, evolution and classification is presented. The basic configurations of robot manipulator are demonstrated and their benefits and drawbacks are deliberated along with the applications. The difficulties to solve forward and inverse kinematics of robot manipulator are discussed and solution of inverse kinematic is introduced through conventional methods. In order to accomplish the desired objective of the work and attain the solution of inverse kinematic problem an efficient study of the existing tools and techniques has been done. A review of literature survey and various tools used to solve inverse kinematic problem on different aspects is discussed. The various approaches of inverse kinematic solution is categorized in four sections namely structural analysis of mechanism, conventional approaches, intelligence or soft computing approaches and optimization based approaches. A portion of important and more significant literatures are thoroughly discussed and brief investigation is made on conclusions and gaps with respect to the inverse kinematic solution of industrial robot manipulators. Based on the survey of tools and techniques used for the kinematic analysis the broad objective of the present research work is presented as; to carry out the kinematic analyses of different configurations of industrial robot manipulators. The mathematical modelling of selected robot manipulator using existing tools and techniques has to be made for the comparative study of proposed method. On the other hand, development of new algorithm and their mathematical modelling for the solution of inverse kinematic problem has to be made for the analysis of quality and efficiency of the obtained solutions. Therefore, the study of appropriate tools and techniques used for the solution of inverse kinematic problems and comparison with proposed method is considered. Moreover, recommendation of the appropriate method for the solution of inverse kinematic problem is presented in the work. Apart from the forward kinematic analysis, the inverse kinematic analysis is quite complex, due to its non-linear formulations and having multiple solutions. There is no unique solution for the inverse kinematics thus necessitating application of appropriate predictive models from the soft computing domain. Artificial neural network (ANN) can be gainfully used to yield the desired results. Therefore, in the present work several models of artificial neural network (ANN) are used for the solution of the inverse kinematic problem. This model of ANN does not rely on higher mathematical formulations and are adept to solve NP-hard, non-linear and higher degree of polynomial equations. Although intelligent approaches are not new in this field but some selected models of ANN and their hybridization has been presented for the comparative evaluation of inverse kinematic. The hybridization scheme of ANN and an investigation has been made on accuracies of adopted algorithms. On the other hand, any Optimization algorithms which are capable of solving various multimodal functions can be implemented to solve the inverse kinematic problem. To overcome the problem of conventional tool and intelligent based method the optimization based approach can be implemented. In general, the optimization based approaches are more stable and often converge to the global solution. The major problem of ANN based approaches are its slow convergence and often stuck in local optimum point. Therefore, in present work different optimization based approaches are considered. The formulation of the objective function and associated constrained are discussed thoroughly. The comparison of all adopted algorithms on the basis of number of solutions, mathematical operations and computational time has been presented. The thesis concludes the summary with contributions and scope of the future research work
    corecore