1,465 research outputs found

    Terrain Aware Traverse Planning for Mars Rovers

    Get PDF
    NASA is proposing a Mars Sample Return mission, to be completed within one Martian year, that will require enhanced autonomy to perform its duties faster, safer, and more efficiently. With its main purpose being to retrieve samples possibly tens of kilometers away, it will need to drive beyond line-of-sight to get to its target more quickly than any rovers before. This research proposes a new methodology to support a sample return mission and is divided into three compo-nents: map preparation (map of traversability, i.e., ability of a terrain to sustain the traversal of a vehicle), path planning (pre-planning and replanning), and terrain analysis. The first component aims at creating a better knowledge of terrain traversability to support planning, by predicting rover slip and drive speed along the traverse using orbital data. By overlapping slope, rock abundance and terrain types at the same location, the expected drive velocity is obtained. By combining slope and thermal data, additional information about the experienced slip is derived, indicating whether it will be low (less than 30%) or medium to high (more than 30%). The second component involves planning the traverse for one Martian day (or sol) at a time, based on the map of expected drive speed. This research proposes to plan, offline, several paths traversable in one sol. Once online, the rover chooses the fastest option (the path cost being calculated using the distance divided by the expected velocity). During its drive, the rover monitors the terrain via analysis of its experienced wheel slip and actual speed. This information is then passed along the different pre-planned paths over a given distance (e.g., 25 m) and the map of traversability is locally updated given this new knowledge. When an update occurs, the rover calculates the new time of arrival of the various paths and replans its route if necessary. When tested in a simulation study on maps of the Columbia Hills, Mars, the rover successfully updates the map given new information drawn from a modified map used as ground truth for simulation purposes and replans its traverse when needed. The third component describes a method to assess the soil in-situ in case of dangerous terrain detected during the map update, or if the monitoring is not enough to confirm the traversability predicted by the map. The rover would deploy a shear vane instrument to compute intrinsic terrain parameters, information then propagated ahead of the rover to update the map and replan if necessary. Experiments in a laboratory setting as well as in the field showed promising results, the mounted shear vane giving values close to the expected terrain parameters of the tested soils

    Coupling Vision and Proprioception for Navigation of Legged Robots

    Full text link
    We exploit the complementary strengths of vision and proprioception to develop a point-goal navigation system for legged robots, called VP-Nav. Legged systems are capable of traversing more complex terrain than wheeled robots, but to fully utilize this capability, we need a high-level path planner in the navigation system to be aware of the walking capabilities of the low-level locomotion policy in varying environments. We achieve this by using proprioceptive feedback to ensure the safety of the planned path by sensing unexpected obstacles like glass walls, terrain properties like slipperiness or softness of the ground and robot properties like extra payload that are likely missed by vision. The navigation system uses onboard cameras to generate an occupancy map and a corresponding cost map to reach the goal. A fast marching planner then generates a target path. A velocity command generator takes this as input to generate the desired velocity for the walking policy. A safety advisor module adds sensed unexpected obstacles to the occupancy map and environment-determined speed limits to the velocity command generator. We show superior performance compared to wheeled robot baselines, and ablation studies which have disjoint high-level planning and low-level control. We also show the real-world deployment of VP-Nav on a quadruped robot with onboard sensors and computation. Videos at https://navigation-locomotion.github.ioComment: CVPR 2022 final version. Website at https://navigation-locomotion.github.i

    RLOC: Terrain-Aware Legged Locomotion using Reinforcement Learning and Optimal Control

    Full text link
    We present a unified model-based and data-driven approach for quadrupedal planning and control to achieve dynamic locomotion over uneven terrain. We utilize on-board proprioceptive and exteroceptive feedback to map sensory information and desired base velocity commands into footstep plans using a reinforcement learning (RL) policy trained in simulation over a wide range of procedurally generated terrains. When ran online, the system tracks the generated footstep plans using a model-based controller. We evaluate the robustness of our method over a wide variety of complex terrains. It exhibits behaviors which prioritize stability over aggressive locomotion. Additionally, we introduce two ancillary RL policies for corrective whole-body motion tracking and recovery control. These policies account for changes in physical parameters and external perturbations. We train and evaluate our framework on a complex quadrupedal system, ANYmal version B, and demonstrate transferability to a larger and heavier robot, ANYmal C, without requiring retraining.Comment: 19 pages, 15 figures, 6 tables, 1 algorithm, submitted to T-RO; under revie

    Online Optimization-based Gait Adaptation of Quadruped Robot Locomotion

    Get PDF
    Quadruped robots demonstrated extensive capabilities of traversing complex and unstructured environments. Optimization-based techniques gave a relevant impulse to the research on legged locomotion. Indeed, by designing the cost function and the constraints, we can guarantee the feasibility of a motion and impose high-level locomotion tasks, e.g., tracking of a reference velocity. This allows one to have a generic planning approach without the need to tailor a specific motion for each terrain, as in the heuristic case. In this context, Model Predictive Control (MPC) can compensate for model inaccuracies and external disturbances, thanks to the high-frequency replanning. The main objective of this dissertation is to develop a Nonlinear MPC (NMPC)-based locomotion framework for quadruped robots. The aim is to obtain an algorithm which can be extended to different robots and gaits; in addition, I sought to remove some assumptions generally done in the literature, e.g., heuristic reference generator and user-defined gait sequence. The starting point of my work is the definition of the Optimal Control Problem to generate feasible trajectories for the Center of Mass. It is descriptive enough to capture the linear and angular dynamics of the robot as a whole. A simplified model (Single Rigid Body Dynamics model) is used for the system dynamics, while a novel cost term maximizes leg mobility to improve robustness in the presence of nonflat terrain. In addition, to test the approach on the real robot, I dedicated particular effort to implementing both a heuristic reference generator and an interface for the controller, and integrating them into the controller framework developed previously by other team members. As a second contribution of my work, I extended the locomotion framework to deal with a trot gait. In particular, I generalized the reference generator to be based on optimization. Exploiting the Linear Inverted Pendulum model, this new module can deal with the underactuation of the trot when only two legs are in contact with the ground, endowing the NMPC with physically informed reference trajectories to be tracked. In addition, the reference velocities are used to correct the heuristic footholds, obtaining contact locations coherent with the motion of the base, even though they are not directly optimized. The model used by the NMPC receives as input the gait sequence, thus with the last part of my work I developed an online multi-contact planner and integrated it into the MPC framework. Using a machine learning approach, the planner computes the best feasible option, even in complex environments, in a few milliseconds, by ranking online a set of discrete options for footholds, i.e., which leg to move and where to step. To train the network, I designed a novel function, evaluated offline, which considers the value of the cost of the NMPC and robustness/stability metrics for each option. These methods have been validated with simulations and experiments over the three years. I tested the NMPC on the Hydraulically actuated Quadruped robot (HyQ) of the IIT’s Dynamic Legged Systems lab, performing omni-directional motions on flat terrain and stepping on a pallet (both static and relocated during the motion) with a crawl gait. The trajectory replanning is performed at high-frequency, and visual information of the terrain is included to traverse uneven terrain. A Unitree Aliengo quadruped robot is used to execute experiments with the trot gait. The optimization-based reference generator allows the robot to reach a fixed goal and recover from external pushes without modifying the structure of the NMPC. Finally, simulations with the Solo robot are performed to validate the neural network-based contact planning. The robot successfully traverses complex scenarios, e.g., stepping stones, with both walk and trot gaits, choosing the footholds online. The achieved results improved the robustness and the performance of the quadruped locomotion. High-frequency replanning, dealing with a fixed goal, recovering after a push, and the automatic selection of footholds could help the robots to accomplish important tasks for the humans, for example, providing support in a disaster response scenario or inspecting an unknown environment. In the future, the contact planning will be transferred to the real hardware. Possible developments foresee the optimization of the gait timings, i.e., stance and swing duration, and a framework which allows the automatic transition between gaits

    Actuation-Aware Simplified Dynamic Models for Robotic Legged Locomotion

    Get PDF
    In recent years, we witnessed an ever increasing number of successful hardware implementations of motion planners for legged robots. If one common property is to be identified among these real-world applications, that is the ability of online planning. Online planning is forgiving, in the sense that it allows to relentlessly compensate for external disturbances of whatever form they might be, ranging from unmodeled dynamics to external pushes or unexpected obstacles and, at the same time, follow user commands. Initially replanning was restricted only to heuristic-based planners that exploit the low computational effort of simplified dynamic models. Such models deliberately only capture the main dynamics of the system, thus leaving to the controllers the issue of anchoring the desired trajectory to the whole body model of the robot. In recent years, however, we have seen a number of new approaches attempting to increase the accuracy of the dynamic formulation without trading-off the computational efficiency of simplified models. In this dissertation, as an example of successful hardware implementation of heuristics and simplified model-based locomotion, I describe the framework that I developed for the generation of an omni-directional bounding gait for the HyQ quadruped robot. By analyzing the stable limit cycles for the sagittal dynamics and the Center of Pressure (CoP) for the lateral stabilization, the described locomotion framework is able to achieve a stable bounding while adapting to terrains of mild roughness and to sudden changes of the user desired linear and angular velocities. The next topic reported and second contribution of this dissertation is my effort to formulate more descriptive simplified dynamic models, without trading off their computational efficiency, in order to extend the navigation capabilities of legged robots to complex geometry environments. With this in mind, I investigated the possibility of incorporating feasibility constraints in these template models and, in particular, I focused on the joint torques limits which are usually neglected at the planning stage. In this direction, the third contribution discussed in this thesis is the formulation of the so called actuation wrench polytope (AWP), defined as the set of feasible wrenches that an articulated robot can perform given its actuation limits. Interesected with the contact wrench cone (CWC), this yields a new 6D polytope that we name feasible wrench polytope (FWP), defined as the set of all wrenches that a legged robot can realize given its actuation capabilities and the friction constraints. Results are reported where, thanks to efficient computational geometry algorithms and to appropriate approximations, the FWP is employed for a one-step receding horizon optimization of center of mass trajectory and phase durations given a predefined step sequence on rough terrains. For the sake of reachable workspace augmentation, I then decided to trade off the generality of the FWP formulation for a suboptimal scenario in which a quasi-static motion is assumed. This led to the definition of the, so called, local/instantaneous actuation region and of the global actuation/feasible region. They both can be seen as different variants of 2D linear subspaces orthogonal to gravity where the robot is guaranteed to place its own center of mass while being able to carry its own body weight given its actuation capabilities. These areas can be intersected with the well known frictional support region, resulting in a 2D linear feasible region, thus providing an intuitive tool that enables the concurrent online optimization of actuation consistent CoM trajectories and target foothold locations on rough terrains

    Planetary Rover Inertial Navigation Applications: Pseudo Measurements and Wheel Terrain Interactions

    Get PDF
    Accurate localization is a critical component of any robotic system. During planetary missions, these systems are often limited by energy sources and slow spacecraft computers. Using proprioceptive localization (e.g., using an inertial measurement unit and wheel encoders) without external aiding is insufficient for accurate localization. This is mainly due to the integrated and unbounded errors of the inertial navigation solutions and the drifted position information from wheel encoders caused by wheel slippage. For this reason, planetary rovers often utilize exteroceptive (e.g., vision-based) sensors. On the one hand, localization with proprioceptive sensors is straightforward, computationally efficient, and continuous. On the other hand, using exteroceptive sensors for localization slows rover driving speed, reduces rover traversal rate, and these sensors are sensitive to the terrain features. Given the advantages and disadvantages of both methods, this thesis focuses on two objectives. First, improving the proprioceptive localization performance without significant changes to the rover operations. Second, enabling adaptive traversability rate based on the wheel-terrain interactions while keeping the localization reliable. To achieve the first objective, we utilized the zero-velocity, zero-angular rate updates, and non-holonomicity of a rover to improve rover localization performance even with the limited available sensor usage in a computationally efficient way. Pseudo-measurements generated from proprioceptive sensors when the rover is stationary conditions and the non-holonomic constraints while traversing can be utilized to improve the localization performance without any significant changes to the rover operations. Through this work, it is observed that a substantial improvement in localization performance, without the aid of additional exteroceptive sensor information. To achieve the second objective, the relationship between the estimation of localization uncertainty and wheel-terrain interactions through slip-ratio was investigated. This relationship was exposed with a Gaussian process with time series implementation by using the slippage estimation while the rover is moving. Then, it is predicted when to change from moving to stationary conditions by mapping the predicted slippage into localization uncertainty prediction. Instead of a periodic stopping framework, the method introduced in this work is a slip-aware localization method that enables the rover to stop more frequently in high-slip terrains whereas stops rover less frequently for low-slip terrains while keeping the proprioceptive localization reliable

    An Intelligent Architecture for Legged Robot Terrain Classification Using Proprioceptive and Exteroceptive Data

    Get PDF
    In this thesis, we introduce a novel architecture called Intelligent Architecture for Legged Robot Terrain Classification Using Proprioceptive and Exteroceptive Data (iARTEC ) . The proposed architecture integrates different terrain characterization and classification with other robotic system components. Within iARTEC , we consider the problem of having a legged robot autonomously learn to identify different terrains. Robust terrain identification can be used to enhance the capabilities of legged robot systems, both in terms of locomotion and navigation. For example, a robot that has learned to differentiate sand from gravel can autonomously modify (or even select a different) path in favor of traversing over a better terrain. The same knowledge of the terrain type can also be used to guide a robot in order to avoid specific terrains. To tackle this problem, we developed four approaches for terrain characterization, classification, path planning, and control for a mobile legged robot. We developed a particle system inspired approach to estimate the robot footâ ground contact interaction forces. The approach is derived from the well known Bekkerâ s theory to estimate the contact forces based on its point contact model concepts. It is realistically model real-time 3-dimensional contact behaviors between rigid body objects and the soil. For a real-time capable implementation of this approach, its reformulated to use a lookup table generated from simple contact experiments of the robot foot with the terrain. Also, we introduced a short-range terrain classifier using the robot embodied data. The classifier is based on a supervised machine learning approach to optimize the classifier parameters and terrain it using proprioceptive sensor measurements. The learning framework preprocesses sensor data through channel reduction and filtering such that the classifier is trained on the feature vectors that are closely associated with terrain class. For the long-range terrain type prediction using the robot exteroceptive data, we present an online visual terrain classification system. It uses only a monocular camera with a feature-based terrain classification algorithm which is robust to changes in illumination and view points. For this algorithm, we extract local features of terrains using Speed Up Robust Feature (SURF). We encode the features using the Bag of Words (BoW) technique, and then classify the words using Support Vector Machines (SVMs). In addition, we described a terrain dependent navigation and path planning approach that is based on E* planer and employs a proposed metric that specifies the navigation costs associated terrain types. This generated path naturally avoids obstacles and favors terrains with lower values of the metric. At the low level, a proportional input-scaling controller is designed and implemented to autonomously steer the robot to follow the desired path in a stable manner. iARTEC performance was tested and validated experimentally using several different sensing modalities (proprioceptive and exteroceptive) and on the six legged robotic platform CREX. The results show that the proposed architecture integrating the aforementioned approaches with the robotic system allowed the robot to learn both robot-terrain interaction and remote terrain perception models, as well as the relations linking those models. This learning mechanism is performed according to the robot own embodied data. Based on the knowledge available, the approach makes use of the detected remote terrain classes to predict the most probable navigation behavior. With the assigned metric, the performance of the robot on a given terrain is predicted. This allows the navigation of the robot to be influenced by the learned models. Finally, we believe that iARTEC and the methods proposed in this thesis can likely also be implemented on other robot types (such as wheeled robots), although we did not test this option in our work
    corecore