scispace - formally typeset
Search or ask a question

Showing papers in "The International Journal of Robotics Research in 2011"


Journal ArticleDOI
TL;DR: In this paper, the authors studied the asymptotic behavior of the cost of the solution returned by stochastic sampling-based path planning algorithms as the number of samples increases.
Abstract: During the last decade, sampling-based path planning algorithms, such as probabilistic roadmaps (PRM) and rapidly exploring random trees (RRT), have been shown to work well in practice and possess theoretical guarantees such as probabilistic completeness. However, little effort has been devoted to the formal analysis of the quality of the solution returned by such algorithms, e.g. as a function of the number of samples. The purpose of this paper is to fill this gap, by rigorously analyzing the asymptotic behavior of the cost of the solution returned by stochastic sampling-based algorithms as the number of samples increases. A number of negative results are provided, characterizing existing algorithms, e.g. showing that, under mild technical conditions, the cost of the solution returned by broadly used sampling-based algorithms converges almost surely to a non-optimal value. The main contribution of the paper is the introduction of new algorithms, namely, PRM* and RRT*, which are provably asymptotically optimal, i.e. such that the cost of the returned solution converges almost surely to the optimum. Moreover, it is shown that the computational complexity of the new algorithms is within a constant factor of that of their probabilistically complete (but not asymptotically optimal) counterparts. The analysis in this paper hinges on novel connections between stochastic sampling-based path planning algorithms and the theory of random geometric graphs.

3,438 citations


Journal ArticleDOI
TL;DR: A new formulation of appearance-only SLAM suitable for very large scale place recognition that incorporates robustness against perceptual aliasing and substantially outperforms the standard term-frequency inverse-document-frequency (tf-idf) ranking measure.
Abstract: We describe a new formulation of appearance-only SLAM suitable for very large scale place recognition. The system navigates in the space of appearance, assigning each new observation to either a new or a previously visited location, without reference to metric position. The system is demonstrated performing reliable online appearance mapping and loop-closure detection over a 1000 km trajectory, with mean filter update times of 14 ms. The scalability of the system is achieved by defining a sparse approximation to the FAB-MAP model suitable for implementation using an inverted index. Our formulation of the problem is fully probabilistic and naturally incorporates robustness against perceptual aliasing. We also demonstrate that the approach substantially outperforms the standard term-frequency inverse-document-frequency (tf-idf) ranking measure. The 1000 km data set comprising almost a terabyte of omni-directional and stereo imagery is available for use, and we hope that it will serve as a benchmark for future systems.

661 citations


Journal ArticleDOI
TL;DR: This paper describes an algorithm, based on the unscented Kalman filter, for self-calibration of the transform between a camera and an inertial measurement unit (IMU), which demonstrates accurate estimation of both the calibration parameters and the local scene structure.
Abstract: Visual and inertial sensors, in combination, are able to provide accurate motion estimates and are well suited for use in many robot navigation tasks. However, correct data fusion, and hence overall performance, depends on careful calibration of the rigid body transform between the sensors. Obtaining this calibration information is typically difficult and time-consuming, and normally requires additional equipment. In this paper we describe an algorithm, based on the unscented Kalman filter, for self-calibration of the transform between a camera and an inertial measurement unit (IMU). Our formulation rests on a differential geometric analysis of the observability of the camera—IMU system; this analysis shows that the sensor-to-sensor transform, the IMU gyroscope and accelerometer biases, the local gravity vector, and the metric scene structure can be recovered from camera and IMU measurements alone. While calibrating the transform we simultaneously localize the IMU and build a map of the surroundings, all without additional hardware or prior knowledge about the environment in which a robot is operating. We present results from simulation studies and from experiments with a monocular camera and a low-cost IMU, which demonstrate accurate estimation of both the calibration parameters and the local scene structure.

555 citations


Journal ArticleDOI
TL;DR: An integrated approach to ‘loop-closure’, that is the recognition of previously seen locations and the topological re-adjustment of the traveled path, is described, where loop-closure can be performed without the need to re-compute past trajectories or perform bundle adjustment.
Abstract: We describe a model to estimate motion from monocular visual and inertial measurements. We analyze the model and characterize the conditions under which its state is observable, and its parameters are identifiable. These include the unknown gravity vector, and the unknown transformation between the camera coordinate frame and the inertial unit. We show that it is possible to estimate both state and parameters as part of an on-line procedure, but only provided that the motion sequence is â??rich enoughâ??, a condition that we characterize explicitly. We then describe an efficient implementation of a filter to estimate the state and parameters of this model, including gravity and camera-to-inertial calibration. It runs in real-time on an embedded platform. We report experiments of continuous operation, without failures, re-initialization, or re-calibration, on paths of length up to 30 km. We also describe an integrated approach to â??loop-closureâ??, that is the recognition of previously seen locations and the topological re-adjustment of the traveled path. It represents visual features relative to the global orientation reference provided by the gravity vector estimated by the filter, and relative to the scale provided by their known position within the map; these features are organized into â??locationsâ?? defined by visibility constraints, represented in a topological graph, where loop-closure can be performed without the need to re-compute past trajectories or perform bundle adjustment. The software infrastructure as well as the embedded platform is described in detail in a previous technical report.

512 citations


Journal ArticleDOI
TL;DR: MOPED, a framework for Multiple Object Pose Estimation and Detection that seamlessly integrates single-image and multi-image object recognition and pose estimation in one optimized, robust, and scalable framework is presented.
Abstract: We present MOPED, a framework for Multiple Object Pose Estimation and Detection that seamlessly integrates single-image and multi-image object recognition and pose estimation in one optimized, robust, and scalable framework. We address two main challenges in computer vision for robotics: robust performance in complex scenes, and low latency for real-time operation. We achieve robust performance with Iterative Clustering Estimation (ICE), a novel algorithm that iteratively combines feature clustering with robust pose estimation. Feature clustering quickly partitions the scene and produces object hypotheses. The hypotheses are used to further refine the feature clusters, and the two steps iterate until convergence. ICE is easy to parallelize, and easily integrates single- and multi-camera object recognition and pose estimation. We also introduce a novel object hypothesis scoring function based on M-estimator theory, and a novel pose clustering algorithm that robustly handles recognition outliers. We achieve scalability and low latency with an improved feature matching algorithm for large databases, a GPU/CPU hybrid architecture that exploits parallelism at all levels, and an optimized resource scheduler. We provide extensive experimental results demonstrating state-of-the-art performance in terms of recognition, scalability, and latency in real-world robotic applications.

455 citations


Journal ArticleDOI
TL;DR: A broad survey of developments in active vision in robotic applications over the last 15 years is provided, e.g. object recognition and modeling, site reconstruction and inspection, surveillance, tracking and search, as well as robotic manipulation and assembly, localization and mapping, navigation and exploration.
Abstract: In this paper we provide a broad survey of developments in active vision in robotic applications over the last 15 years. With increasing demand for robotic automation, research in this area has received much attention. Among the many factors that can be attributed to a high-performance robotic system, the planned sensing or acquisition of perceptions on the operating environment is a crucial component. The aim of sensor planning is to determine the pose and settings of vision sensors for undertaking a vision-based task that usually requires obtaining multiple views of the object to be manipulated. Planning for robot vision is a complex problem for an active system due to its sensing uncertainty and environmental uncertainty. This paper describes such problems arising from many applications, e.g. object recognition and modeling, site reconstruction and inspection, surveillance, tracking and search, as well as robotic manipulation and assembly, localization and mapping, navigation and exploration. A bundle of solutions and methods have been proposed to solve these problems in the past. They are summarized in this review while enabling readers to easily refer solution methods for practical applications. Representative contributions, their evaluations, analyses, and future research trends are also addressed in an abstract level.

398 citations


Journal ArticleDOI
TL;DR: A new approach to robot motion planning that takes into account the sensors and the controller that will be used during the execution of the robot’s path, based on the linear-quadratic controller with Gaussian models of uncertainty is presented.
Abstract: In this paper we present LQG-MP (linear-quadratic Gaussian motion planning), a new approach to robot motion planning that takes into account the sensors and the controller that will be used during the execution of the robot’s path. LQG-MP is based on the linear-quadratic controller with Gaussian models of uncertainty, and explicitly characterizes in advance (i.e. before execution) the a priori probability distributions of the state of the robot along its path. These distributions can be used to assess the quality of the path, for instance by computing the probability of avoiding collisions. Many methods can be used to generate the required ensemble of candidate paths from which the best path is selected; in this paper we report results using rapidly exploring random trees (RRT). We study the performance of LQG-MP with simulation experiments in three scenarios: (A) a kinodynamic car-like robot, (B) multi-robot planning with differential-drive robots, and (C) a 6-DOF serial manipulator. We also present a method that applies Kalman smoothing to make paths Ck-continuous and apply LQG-MP to precomputed roadmaps using a variant of Dijkstra’s algorithm to efficiently find high-quality paths.

373 citations


Journal ArticleDOI
TL;DR: Five experiments are presented that highlight different aspects of MABEL and the feedback design method, ranging from basic elements such as stable walking and robustness under perturbations, to energy efficiency and a walking speed of 1.5 m s−1 (3.4 mph).
Abstract: The planar bipedal testbed MABEL contains springs in its drivetrain for the purpose of enhancing both energy efficiency and agility of dynamic locomotion. While the potential energetic benefits of springs are well documented in the literature, feedback control designs that effectively realize this potential are lacking. In this paper, we extend and apply the methods of virtual constraints and hybrid zero dynamics, originally developed for rigid robots with a single degree of underactuation, to MABEL, a bipedal walker with a novel compliant transmission and multiple degrees of underactuation. A time-invariant feedback controller is designed such that the closed-loop system respects the natural compliance of the open-loop system and realizes exponentially stable walking gaits. Five experiments are presented that highlight different aspects of MABEL and the feedback design method, ranging from basic elements such as stable walking and robustness under perturbations, to energy efficiency and a walking speed of 1.5 m s−1 (3.4 mph). The experiments also compare two feedback implementations of the virtual constraints, one based on PD control of Westervelt et al., and a second that implements a full hybrid zero dynamics controller. On MABEL, the full hybrid zero dynamics controller yields a much more faithful realization of the desired virtual constraints and was instrumental in achieving more rapid walking.

352 citations


Journal ArticleDOI
TL;DR: The vehicle path trajectory in these data sets contains several large- and small-scale loop closures, which should be useful for testing various state-of-the-art computer vision and simultaneous localization and mapping algorithms.
Abstract: In this paper we describe a data set collected by an autonomous ground vehicle testbed, based upon a modified Ford F-250 pickup truck. The vehicle is outfitted with a professional (Applanix POS-LV) and consumer (Xsens MTi-G) inertial measurement unit, a Velodyne three-dimensional lidar scanner, two push-broom forward-looking Riegl lidars, and a Point Grey Ladybug3 omnidirectional camera system. Here we present the time-registered data from these sensors mounted on the vehicle, collected while driving the vehicle around the Ford Research Campus and downtown Dearborn, MI, during November-December 2009. The vehicle path trajectory in these data sets contains several large- and small-scale loop closures, which should be useful for testing various state-of-the-art computer vision and simultaneous localization and mapping algorithms.

343 citations


Journal ArticleDOI
TL;DR: A manipulation planning framework that allows robots to plan in the presence of constraints on end-effector pose, as well as other common constraints, and proves probabilistic completeness for the planning approach is presented.
Abstract: We present a manipulation planning framework that allows robots to plan in the presence of constraints on end-effector pose, as well as other common constraints. The framework has three main components: constraint representation, constraint-satisfaction strategies, and a general planning algorithm. These components come together to create an efficient and probabilistically complete manipulation planning algorithm called the Constrained BiDirectional Rapidly-exploring Random Tree (RRT) - CBiRRT2. The underpinning of our framework for pose constraints is our Task Space Regions (TSRs) representation. TSRs are intuitive to specify, can be efficiently sampled, and the distance to a TSR can be evaluated very quickly, making them ideal for sampling-based planning. Most importantly, TSRs are a general representation of pose constraints that can fully describe many practical tasks. For more complex tasks, such as manipulating articulated objects, TSRs can be chained together to create more complex end-effector pose constraints. TSRs can also be intersected, a property that we use to plan with pose uncertainty. We provide a detailed description of our framework, prove probabilistic completeness for our planning approach, and describe several real-world example problems that illustrate the efficiency and versatility of the TSR framework.

327 citations


Journal ArticleDOI
TL;DR: A floating-base inverse dynamics controller that allows for robust, compliant locomotion over unperceived obstacles and the generalization ability of this controller is demonstrated by presenting results from testing performed by an independent external test team on terrain that has never been shown to us.
Abstract: We present a control architecture for fast quadruped locomotion over rough terrain. We approach the problem by decomposing it into many sub-systems, in which we apply state-of-the-art learning, planning, optimization, and control techniques to achieve robust, fast locomotion. Unique features of our control strategy include: (1) a system that learns optimal foothold choices from expert demonstration using terrain templates, (2) a body trajectory optimizer based on the Zero-Moment Point (ZMP) stability criterion, and (3) a floating-base inverse dynamics controller that, in conjunction with force control, allows for robust, compliant locomotion over unperceived obstacles. We evaluate the performance of our controller by testing it on the LittleDog quadruped robot, over a wide variety of rough terrains of varying difficulty levels. The terrain that the robot was tested on includes rocks, logs, steps, barriers, and gaps, with obstacle sizes up to the leg length of the robot. We demonstrate the generalization ability of this controller by presenting results from testing performed by an independent external test team on terrain that has never been shown to us.

Journal ArticleDOI
TL;DR: The results show that the power of variable impedance control is made available to a wide variety of robotic systems and practical applications and can be used not only for planning but also to derive variable gain feedback controllers in realistic scenarios.
Abstract: One of the hallmarks of the performance, versatility, and robustness of biological motor control is the ability to adapt the impedance of the overall biomechanical system to different task requirements and stochastic disturbances. A transfer of this principle to robotics is desirable, for instance to enable robots to work robustly and safely in everyday human environments. It is, however, not trivial to derive variable impedance controllers for practical high degree-of-freedom (DOF) robotic tasks. In this contribution, we accomplish such variable impedance control with the reinforcement learning (RL) algorithm PI2 (Policy Improvement with Path Integrals). PI2 is a model-free, sampling-based learning method derived from first principles of stochastic optimal control. The PI 2 algorithm requires no tuning of algorithmic parameters besides the exploration noise. The designer can thus fully focus on the cost function design to specify the task. From the viewpoint of robotics, a particular useful property of PI2 is that it can scale to problems of many DOFs, so that reinforcement learning on real robotic systems becomes feasible. We sketch the PI2 algorithm and its theoretical properties, and how it is applied to gain scheduling for variable impedance control. We evaluate our approach by presenting results on several simulated and real robots. We consider tasks involving accurate tracking through via points, and manipulation tasks requiring physical contact with the environment. In these tasks, the optimal strategy requires both tuning of a reference trajectory and the impedance of the end-effector. The results show that we can use path integral based reinforcement learning not only for planning but also to derive variable gain feedback controllers in realistic scenarios. Thus, the power of variable impedance control is made available to a wide variety of robotic systems and practical applications.

Journal ArticleDOI
TL;DR: A constructive control design for stabilization of non-periodic trajectories of underactuated robots, using a transverse linearization about the desired motion and providing exponential orbital stability of the target trajectory of the original nonlinear system.
Abstract: We propose a constructive control design for stabilization of non-periodic trajectories of underactuated robots. An important example of such a system is an underactuated “dynamic walking” biped robot traversing rough or uneven terrain. The stabilization problem is inherently challenging due to the nonlinearity, open-loop instability, hybrid (impact) dynamics, and target motions which are not known in advance. The proposed technique is to compute a transverse linearization about the desired motion: a linear impulsive system which locally represents “transversal” dynamics about a target trajectory. This system is then exponentially stabilized using a modified receding-horizon control design, providing exponential orbital stability of the target trajectory of the original nonlinear system. The proposed method is experimentally verified using a compass-gait walker: a two-degree-of-freedom biped with hip actuation but pointed stilt-like feet. The technique is, however, very general and can be applied to a wide variety of hybrid nonlinear systems.

Journal ArticleDOI
TL;DR: The design and optimization of a wall-climbing robot along with the incorporation of autonomous adhesion recovery and a motion planning implementation are presented, resulting in Waalbot II, an untethered 85 g robot able to climb on smooth vertical surfaces with up to a 100 g payload or on planar surfaces of any orientation at speeds up to 5 cm/s.
Abstract: This paper presents the design and optimization of a wall-climbing robot along with the incorporation of autonomous adhesion recovery and a motion planning implementation. The result is Waalbot II, an untethered 85 g robot able to climb on smooth vertical surfaces with up to a 100 g payload (117% body mass) or, when unburdened, on planar surfaces of any orientation at speeds up to 5 cm/s. Bio-inspired climbing mechanisms, such as Waalbot II’s gecko-like fibrillar adhesives, passive peeling, and force sensing, improve the overall climbing capabilities compared with initial versions, resulting in the ability to climb on non-smooth surfaces as well as on inverted smooth surfaces. Robot length scale optimization reveals and quantifies trends in the theoretical factor of safety and payload carrying capabilities. Autonomous adhesion recovery behavior provides additional climbing robustness without additional mechanical complexity to mitigate degradation and contamination. An implementation of a motion planner, designed to take into account Waalbot II’s kinematic constraints, results in the ability to navigate to a goal in complex three-dimensional environments while properly planning plane-to-plane transitions and avoiding obstacles. Experiments verified the improved climbing capabilities of Waalbot II as well as its novel semi-autonomous adhesion recovery behavior and motion planning.

Journal ArticleDOI
TL;DR: This work addresses the fact that robot configurations may admit multiple payload equilibrium solutions by developing constraints for the robot configuration that guarantee the existence of a unique payload pose and formulate individual robot control laws that enforce these constraints and enable the design of non-trivial payload motion plans.
Abstract: We consider the planning and control of multiple aerial robots manipulating and transporting a payload in three dimensions via cables. Individual robot control laws and motion plans enable the control of the payload (position and orientation) along a desired trajectory. We address the fact that robot configurations may admit multiple payload equilibrium solutions by developing constraints for the robot configuration that guarantee the existence of a unique payload pose. Further, we formulate individual robot control laws that enforce these constraints and enable the design of non-trivial payload motion plans. Finally, we propose two quality measures for motion plan design that minimize individual robot motion and maximize payload stability along the trajectory. The methods proposed in the work are evaluated through simulation and experimentation with a team of three quadrotors.

Journal ArticleDOI
TL;DR: The approach integrates both shape and appearance information into an articulated Iterative Closest Point approach to track the robot’s manipulator and the object and provides very good 3D models even when the object is highly symmetric and lacks visual features and the manipulator motion is noisy.
Abstract: Recognizing and manipulating objects is an important task for mobile robots performing useful services in everyday environments. While existing techniques for object recognition related to manipulation provide very good results even for noisy and incomplete data, they are typically trained using data generated in an offline process. As a result, they do not enable a robot to acquire new object models as it operates in an environment. In this paper we develop an approach to building 3D models of unknown objects based on a depth camera observing the robot's hand while moving an object. The approach integrates both shape and appearance information into an articulated Iterative Closest Point approach to track the robot's manipulator and the object. Objects are modeled by sets of surfels, which are small patches providing occlusion and appearance information. Experiments show that our approach provides very good 3D models even when the object is highly symmetric and lacks visual features and the manipulator motion is noisy. Autonomous object modeling represents a step toward improved semantic understanding, which will eventually enable robots to reason about their environments in terms of objects and their relations rather than through raw sensor data.

Journal ArticleDOI
TL;DR: This paper utilizes Büchi automata to produce an automaton (which can be thought of as a graph) whose runs satisfy the temporal-logic specification, and presents a graph algorithm that computes a run corresponding to the optimal robot path.
Abstract: In this paper we present a method for automatically generating optimal robot paths satisfying high-level mission specifications. The motion of the robot in the environment is modeled as a weighted transition system. The mission is specified by an arbitrary linear temporal-logic (LTL) formula over propositions satisfied at the regions of a partitioned environment. The mission specification contains an optimizing proposition, which must be repeatedly satisfied. The cost function that we seek to minimize is the maximum time between satisfying instances of the optimizing proposition. For every environment model, and for every formula, our method computes a robot path that minimizes the cost function. The problem is motivated by applications in robotic monitoring and data-gathering. In this setting, the optimizing proposition is satisfied at all locations where data can be uploaded, and the LTL formula specifies a complex data-collection mission. Our method utilizes BA¼chi automata to produce an automaton (which can be thought of as a graph) whose runs satisfy the temporal-logic specification. We then present a graph algorithm that computes a run corresponding to the optimal robot path. We present an implementation for a robot performing data collection in a road-network platform.

Journal ArticleDOI
TL;DR: This study introduces a novel representation of the relations between objects at decisive time points during a manipulation by encoding the essential changes in a visual scenery in a condensed way such that a robot can recognize and learn a manipulation without prior object knowledge.
Abstract: Recognizing manipulations performed by a human and the transfer and execution of this by a robot is a difficult problem. We address this in the current study by introducing a novel representation of the relations between objects at decisive time points during a manipulation. Thereby, we encode the essential changes in a visual scenery in a condensed way such that a robot can recognize and learn a manipulation without prior object knowledge. To achieve this we continuously track image segments in the video and construct a dynamic graph sequence. Topological transitions of those graphs occur whenever a spatial relation between some segments has changed in a discontinuous way and these moments are stored in a transition matrix called the semantic event chain (SEC). We demonstrate that these time points are highly descriptive for distinguishing between different manipulations. Employing simple sub-string search algorithms, SECs can be compared and type-similar manipulations can be recognized with high confidence. As the approach is generic, statistical learning can be used to find the archetypal SEC of a given manipulation class. The performance of the algorithm is demonstrated on a set of real videos showing hands manipulating various objects and performing different actions. In experiments with a robotic arm, we show that the SEC can be learned by observing human manipulations, transferred to a new scenario, and then reproduced by the machine.

Journal ArticleDOI
TL;DR: This paper proposes to use a robot-tweezer manipulation system for automatic transportation of biological cells and performs experiments on transporting live cells to demonstrate the effectiveness of the proposed approach.
Abstract: The positioning of biological cells has become increasingly important in biomedical research such as drug discovery, cell-to-cell interaction, and tissue engineering. Significant demand for both accuracy and productivity in cell manipulation highlights the need for automated cell transportation with integrated robotics and micro/nano-manipulation technologies. Optical tweezers, which use highly focused low-power laser beams to trap and manipulate particles at the micro/nanoscale, can be treated as special robot 'end-effectors' to manipulate biological objects in a noninvasive way. In this paper, we propose to use a robot-tweezer manipulation system for automatic transportation of biological cells. A dynamics equation of the cell in an optical trap is analyzed. Closed-loop controllers are designed for positioning single cells as well as multiple cells. A synchronization control technology is utilized for multicell transportation with maintained cell pattern. Experiments are performed on transporting live cells to demonstrate the effectiveness of the proposed approach.

Journal ArticleDOI
TL;DR: A novel algorithm is proposed which provably learns a compact, accurate model directly from sequences of action-observation pairs, and is evaluated in a simulated, vision-based mobile robot planning task, showing that the learned PSR captures the essential features of the environment and enables successful and efficient planning.
Abstract: A central problem in artificial intelligence is to choose actions to maximize reward in a partially observable, uncertain environment. To do so, we must learn an accurate environment model, and then plan to maximize reward. Unfortunately, learning algorithms often recover a model that is too inaccurate to support planning or too large and complex for planning to succeed; or they require excessive prior domain knowledge or fail to provide guarantees such as statistical consistency. To address this gap, we propose a novel algorithm which provably learns a compact, accurate model directly from sequences of action-observation pairs. We then evaluate the learner by closing the loop from observations to actions. In more detail, we present a spectral algorithm for learning a predictive state representation (PSR), and evaluate it in a simulated, vision-based mobile robot planning task, showing that the learned PSR captures the essential features of the environment and enables successful and efficient planning. Our algorithm has several benefits which have not appeared together in any previous PSR learner: it is computationally efficient and statistically consistent; it handles high-dimensional observations and long time horizons; and, our close-the-loop experiments provide an end-to-end practical test.

Journal ArticleDOI
TL;DR: This paper presents a highly general algorithm, Random-MMP, that repeatedly attempts mode switches sampled at random and applies the planner to a manipulation task on the Honda humanoid robot, where the robot is asked to push an object to a desired location on a cluttered table.
Abstract: Robots that perform complex manipulation tasks must be able to generate strategies that make and break contact with the object. This requires reasoning in a motion space with a particular multi-modal structure, in which the state contains both a discrete mode (the contact state) and a continuous configuration (the robot and object poses). In this paper we address multi-modal motion planning in the common setting where the state is high-dimensional, and there are a continuous infinity of modes. We present a highly general algorithm, Random-MMP, that repeatedly attempts mode switches sampled at random. A major theoretical result is that Random-MMP is formally reliable and scalable, and its running time depends on certain properties of the multi-modal structure of the problem that are not explicitly dependent on dimensionality. We apply the planner to a manipulation task on the Honda humanoid robot, where the robot is asked to push an object to a desired location on a cluttered table, and the robot is restricted to switch between walking, reaching, and pushing modes. Experiments in simulation and on the real robot demonstrate that Random-MMP solves problem instances that require several carefully chosen pushes in minutes on a PC.

Journal ArticleDOI
TL;DR: This paper presents two applications of reachable sets used to design and implement a backflip maneuver for a quadrotor helicopter and a decentralized collision avoidance algorithm for multiple quadrotors.
Abstract: The control of complex non-linear systems can be aided by modeling each system as a collection of simplified hybrid modes, with each mode representing a particular operating regime defined by the system dynamics or by a region of the state space in which the system operates. Guarantees on the safety and performance of such hybrid systems can still be challenging to generate, however. Reachability analysis using a dynamic game formulation with Hamilton—Jacobi methods provides a useful way to generate these types of guarantees, and the technique is flexible enough to analyze a wide variety of systems. This paper presents two applications of reachable sets, both focused on guaranteeing the safety and performance of robotic aerial vehicles. In the first example, reachable sets are used to design and implement a backflip maneuver for a quadrotor helicopter. In the second, reachability analysis is used to design a decentralized collision avoidance algorithm for multiple quadrotors. The theory for both examples is explained, and successful experimental results are presented from flight tests on the STARMAC quadrotor helicopter platform.

Journal ArticleDOI
TL;DR: A motion planning algorithm is described for bounding over rough terrain with the LittleDog robot, and a feedback controller based on transverse linearization was implemented, and shown in simulation to stabilize perturbations in the presence of noise and time delays.
Abstract: A motion planning algorithm is described for bounding over rough terrain with the LittleDog robot. Unlike walking gaits, bounding is highly dynamic and cannot be planned with quasi-steady approximations. LittleDog is modeled as a planar five-link system, with a 16-dimensional state space; computing a plan over rough terrain in this high-dimensional state space that respects the kinodynamic constraints due to underactuation and motor limits is extremely challenging. Rapidly Exploring Random Trees (RRTs) are known for fast kinematic path planning in high-dimensional configuration spaces in the presence of obstacles, but search efficiency degrades rapidly with the addition of challenging dynamics. A computationally tractable planner for bounding was developed by modifying the RRT algorithm by using: (1) motion primitives to reduce the dimensionality of the problem; (2) Reachability Guidance, which dynamically changes the sampling distribution and distance metric to address differential constraints and discontinuous motion primitive dynamics; and (3) sampling with a Voronoi bias in a lower-dimensional “task space” for bounding. Short trajectories were demonstrated to work on the robot, however open-loop bounding is inherently unstable. A feedback controller based on transverse linearization was implemented, and shown in simulation to stabilize perturbations in the presence of noise and time delays.

Journal ArticleDOI
TL;DR: The LittleDog platform was designed by Boston Dynamics with funding from DARPA to enable rapid advances in the state of the art of rough-terrain locomotion algorithms and served as a cross-team common platform that allowed direct comparison of results across multiple research teams.
Abstract: LittleDog is a small four-legged robot designed for research on legged locomotion. The LittleDog platform was designed by Boston Dynamics with funding from DARPA to enable rapid advances in the state of the art of rough-terrain locomotion algorithms. In addition to providing a fleet of 12 robots with baseline software and development tools, LittleDog served as a cross-team common platform that allowed direct comparison of results across multiple research teams. Here we report the details of this robotic system.

Journal ArticleDOI
TL;DR: An approach is presented whereby small, unmanned aircraft can land on walls and a planar dynamic model is used to evaluate pitch-up maneuvers and determine suspension parameters that satisfy constraints on the contact forces for a range of flight velocities.
Abstract: An approach is presented whereby small, unmanned aircraft can land on walls. The approach is demonstrated with a plane that uses an ultrasonic sensor to initiate a pitch-up maneuver as it flies toward a wall. The plane contacts the wall with spines that engage asperities on the surface. A non-linear suspension absorbs the kinetic energy while keeping the spines attached. A planar dynamic model is used to evaluate pitch-up maneuvers and determine suspension parameters that satisfy constraints on the contact forces for a range of flight velocities. Simulations conducted using the model are compared with data obtained using high-speed video and a force plate embedded in a wall.

Journal ArticleDOI
TL;DR: A cost function is proposed that can be specialized to represent widely different multi-robot deployment tasks and it is shown that geometric and probabilistic deployment strategies that were previously seen as distinct are in fact related through this cost function, and differ only in the value of a single parameter.
Abstract: This paper unifies and extends several different existing strategies for deploying groups of robots in an environment. A cost function is proposed that can be specialized to represent widely different multi-robot deployment tasks. It is shown that geometric and probabilistic deployment strategies that were previously seen as distinct are in fact related through this cost function, and differ only in the value of a single parameter. These strategies are also related to potential field-based controllers through the same cost function, though the relationship is not as simple. Distributed controllers are then obtained from the gradient of the cost function and are proved to converge to a local minimum of the cost function. Three special cases are derived as examples: a Voronoi-based coverage control task, a probabilistic minimum variance task, and a task using artificial potential fields. The performance of the three different controllers are compared in simulation. A result is also proved linking multi-robot deployment to non-convex optimization problems, and multi-robot consensus (i.e. all robots moving to the same point) to convex optimization problems, which implies that multi-robot deployment is inherently more difficult than multi-robot consensus.

Journal ArticleDOI
TL;DR: This work presents a novel approach to legged locomotion over rough terrain that is thoroughly rooted in optimization, relying on a hierarchy of fast, anytime algorithms to plan a set of footholds, along with the dynamic body motions required to execute them.
Abstract: We present a novel approach to legged locomotion over rough terrain that is thoroughly rooted in optimization. This approach relies on a hierarchy of fast, anytime algorithms to plan a set of footholds, along with the dynamic body motions required to execute them. Components within the planning framework coordinate to exchange plans, cost-to-go estimates, and ‘certificates’ that ensure the output of an abstract high-level planner can be realized by lower layers of the hierarchy. The burden of careful engineering of cost functions to achieve desired performance is substantially mitigated by a simple inverse optimal control technique. Robustness is achieved by real-time re-planning of the full trajectory, augmented by reflexes and feedback control. We demonstrate the successful application of our approach in guiding the LittleDog quadruped robot over a variety of types of rough terrain. Other novel aspects of our past research efforts include a variety of pioneering inverse optimal control techniques as well as a system for planning using arbitrary pre-recorded robot behavior.

Journal ArticleDOI
TL;DR: This paper introduces a notion of optimal coordinates defining a body frame that rotates very little in response to shape changes, while still meeting the requirements of the geometric mechanics theory on which the vector fields and height functions are based.
Abstract: The locomotion of articulated mechanical systems is often complex and unintuitive, even when considered with the aid of reduction principles from geometric mechanics. In this paper, we present two tools for gaining insights into the underlying principles of locomotion: connection vector fields and connection height functions. Connection vector fields illustrate the geometric structure of the relationship between internal shape changes and the system body velocities they produce. Connection height functions measure the curvature of their respective vector fields and capture the net displacement over any cyclic shape change, or gait , allowing for the intuitive selection of gaits to produce desired displacements. Height function approaches have been previously attempted, but such techniques have been severely limited by their basis in a rotating body frame, and have only been useful for calculating planar rotations and infinitesimal translations. We circumvent this limitation by introducing a notion of optimal coordinates defining a body frame that rotates very little in response to shape changes, while still meeting the requirements of the geometric mechanics theory on which the vector fields and height functions are based. In these optimal coordinates, the height functions provide close approximations of the net displacement resulting from a broad selection of possible gaits.

Journal ArticleDOI
TL;DR: A control method is presented that produces an approximate compensation of an exoskeleton’s inertia, making the natural frequency of the exoskeletons-assisted leg larger than that of the unaided leg.
Abstract: Limited research has been done on exoskeletons to enable faster movements of the lower extremities. An exoskeleton’s mechanism can actually hinder agility by adding weight, inertia and friction to the legs; compensating inertia through control is particularly difficult due to instability issues. The added inertia will reduce the natural frequency of the legs, probably leading to lower step frequency during walking. We present a control method that produces an approximate compensation of an exoskeleton’s inertia. The aim is making the natural frequency of the exoskeleton-assisted leg larger than that of the unaided leg. The method uses admittance control to compensate for the weight and friction of the exoskeleton. Inertia compensation is emulated by adding a feedback loop consisting of low-pass filtered acceleration multiplied by a negative gain. This gain simulates negative inertia in the low-frequency range. We tested the controller on a statically supported, single-degree-of-freedom exoskeleton that assists swing movements of the leg. Subjects performed movement sequences, first unassisted and then using the exoskeleton, in the context of a computer-based task resembling a race. With zero inertia compensation, the steady-state frequency of the leg swing was consistently reduced. Adding inertia compensation enabled subjects to recover their normal frequency of swing.

Journal ArticleDOI
TL;DR: The system employs a library of specialized perception routines that solve different, well-defined perceptual sub-tasks and can be combined into composite perceptual activities including the construction of an object model database, multimodal object classification, and object model reconstruction for grasping.
Abstract: In this article we describe an object perception system for autonomous robots performing everyday manipulation tasks in kitchen environments. The perception system gains its strengths by exploiting that the robots are to perform the same kinds of tasks with the same objects over and over again. It does so by learning the object representations necessary for the recognition and reconstruction in the context of pick-and-place tasks. The system employs a library of specialized perception routines that solve different, well-defined perceptual sub-tasks and can be combined into composite perceptual activities including the construction of an object model database, multimodal object classification, and object model reconstruction for grasping. We evaluate the effectiveness of our methods, and give examples of application scenarios using our personal robotic assistants acting in a human living environment.