Shantanu Thakar

Email : shantanuthakar -at- gmail -dot- com

I am Applied Scientist at Robotics AI at Amazon since June 2021. My work is focused on bridging the gap between perception and manipulation. I completed my PhD in Mechanical Engineering with a focus on Robotic motion planning from USC. I was advised by a Prof. Satyandra K. Gupta at the Realization of Robotic Systems Laboratory based out of the Center for Advanced Manufacturing at USC. My research interests include artificial intelligence and machine learning for robotic perception and motion planning.

The applications I worked on include trajectory planning of high degree of freedom robotic systems like mobile manipulators, high speed grasping of objects, area-coverage planning and constrained trajectory generation. A full list of my publications can be found here.





Research

COVID-19 Disinfection Robot (ADAMMS-UV)

Summary

Led a team of researchers for the development of ADAMMS-UV (Agile Dexterous Autonomous Mobile Manipulation System-UV), a semi-autonomous mobile manipulator to perform disinfection tasks in public spaces such as offices, labs, schools, hotels, and dorms using UV light. The UV light mounted robots currently in markets have a UV column on a mobile base that goes around in rooms and stands still at certain places in the room so that surfaces that are exposed to the light are disinfected. ADAMMS-UV is a semi-autonomous mobile manipulator that uses a UV light wand mounted on a robotic arm to reach spaces that cannot be treated by such UV source mounted robots. In addition, it also has a large UV light source to disinfect large open spaces. It can use the gripper to open drawers, closets and manipulate objects to perform a detailed sanitization on hard to reach surfaces. UV light is a proven disinfectant. Coronavirus on a surface can be killed when exposed to UV light of appropriate intensity for a sufficient amount of time. ADAMMS-UV can hold a UV wand over a surface and move it the right speed. The robot can do this task consistently without making any mistake. This task will be physically taxing and risky for humans.


ADAMMS-UV was featured on Forbes.com, IEEE Spectrum and The Institute Magazines, NBC, Forrester Market Research, Mashable.com, Daily Trojan, News Break, USC Viterbi School News and USC Annenberg Media


April 2020

Area-coverage planning for spray-based disinfection with a mobile manipulator (ADAMMS-SD)

Summary

Manual disinfection can be a time-consuming, risky, labor-intensive, and mundane, and humans may fail to disinfect critical areas due to the resulting fatigue. Autonomous or semi-autonomous mobile manipulators mounted with a spray nozzle at the end-effector can be very effective in spraying disinfectant liquid for deep disinfection of objects and surfaces. Such a robot must autonomously perceive the surface to be disinfected, plan for paths of the nozzle to spray the entire surface, and execute the motion of the robot to follow this path. In this work, we present a framework to disinfect surfaces represented by their point clouds and execute motions with a mobile manipulator. The first step is to project the point cloud on a plane and generate a polygon. On the polygon, we then generate multiple spray paths using our branch and bound-based tree search algorithms such that the spray paths cover the entire area of the polygon and reduce wastage of spray disinfectant. An appropriate spray path is chosen using a robot capability map-based selection criterion. We generate mobile manipulator trajectories using successive refinement-based parametric optimization so that the paths for the nozzle are followed accurately. Once we have the mobile manipulator path that results in the spray nozzle following the chosen spray path, we need to make sure that the joint velocities of the mobile manipulator are regulated appropriately such that each point on the surface receives enough disinfectant spray. To this end, we compute the time intervals between the robot path waypoints such that enough disinfectant liquid is sprayed on all points of the point cloud that results in thorough disinfection of the surface, and the particular robot path is executed in the minimum possible time. We have implemented this framework and methodologies on five test scenarios in simulation using our ADAMMS-SD (Agile Dexterous Autonomous Mobile Manipulation System for Surface Disinfection) robot.


Jan 2021

Global Trajectory Planning for Part Transport using Mobile Manipulators

Summary

We introduce an algorithm for path planning for a mobile manipulator in a global sense. The mobile manipulator has to start from an initial location, pick up a part and go to the goal location in the minimum time. We define Grasping Area as an area around the part, in which if the robot is located, the manipulator can reach to grasp the part. The planning algorithm for the mobile base is a search based scheme with heuristics designed to bias the search towards the Grasping Area initially and then towards the goal after the part has been picked up. The time taken by the manipulator to pick up the part is added to the cost to go of certain nodes in the search tree. For the manipulator, we have implemented an inverse kinematics based planner.
Key Points :

  • A single planner for the motion from start to goal via grasping area
  • Any Manipulator planner can be integrated with this
  • Capable of picking up parts while mobile base is translating, turning or stationary

The paper can be found here


March 2018

Manipulator Motion Planning for Part Pick-up and Transport Operations from a Moving Base

Summary

In the previous work, we presented a global searcg based algorithm for the motion planning of the mobile base for part pick-up and transportation. We assumed that the manipulator motion is simplistic and used only as a heuristic to determine the approximate time-delay it adds to the mobile base motion. In this work, we plan for the manipulator motion in a cluttered environment. We present a planning framework to determine when the manipulator motion should begin and end and where grasping should begin and end. Further, we present 3 techniques to improve computation time and decrease the time the manipulator is in motion along the mobile base path. Here the grasping happens when the gripper is stationary with respect to the part and the manipulator conpensates for the motion of the mobile base as it moves along its pre-defined trajectory. The video shows the resulting motions of the manipulator.


2019-20

Local Trajectory Planning of Mobile Manipulators for Time-Optimal Part-Pick Up with a Moving Gripper

Summary

We have developed an optimization based algorithm for trajectory planning of mobile manipulator, such that the gripper attached to the end-effector follows a trajectory so as to have a desired probability of grasping of a part under pose uncertainty. Each DoF of the robot is a polynomial in time and the parameters are the optimization variables. The constraints on the system include the non-holonomic motion of the mobile base, the joint and rate limits for each joint, the gripper velocity constraints and the minimum probability constraints for successful grasping. The objective function is the trajectory time. Finally, a sequential refinement based non-linear optimization is implemented by successively adding constraints.
Key Points :

  • This is a local planner and can be used as a motion primitive for the previous global graph search based planner
  • The mobile robot compensates for the motion of the gripper
  • Results in picking of parts while in motion


The paper can be found here


September 2018

Active Learning for High Speed Grasping under Pose Uncertainty

Summary

The probability constraints mentioned in the previous summary is described here. We build a probability meta model for successful grasping of parts under pose uncertainty with a moving gripper for various gripper speeds and gripper closing speeds. For this we use SVM based active learning to create a boundary between successful and failed part poses for a pair of gripper speed and closing speed. This vastly decreases the number of simulations required to determine the probability for a given level of uncertainty as compared to Monte Carlo simulations. A details of this and the above trajectory planning is shown in the following video.


The paper can be found here


More information on this work can be found here


September 2018

Constrained Trajectory Planning for High DoF Systems

Summary

We pose the problem of path-constrained trajectory generation for synchronous motion of multi-robot systems as a non-linear optimization problem. Our method determines appropriate parametric representation for the configuration variables, generates an approximate solution as a starting point for the optimization method, and uses successive refinement techniques to solve the problem in a computationally efficient manner. We have demonstrated the effectiveness of the proposed method on challenging simulation and physical experiments with high degrees of freedom robotic systems.


September 2018

Task Assignment and Motion Planning for Bi-Manual Mobile Manipulation

Summary

We present a two-layered architecture for task-agent assignment and motion planning of Bi-manual Mobile manipulators for executing complex tasks. We use search trees in temporal windows to determine feasible task assignments ofagents using task and spatial constraint-based heuristics. We also introduce a caching scheme for moving between different trees so as to avoid re-planning of those portions of the robot motion that were successful. This greatly reduces the number of calls to the motion planner as compared to direct motion planning after task-agent assignment. We have shown our approach works on a set of complex tasks with significantly lower computation times.


Multi-arm mobile manipulators can be represented as a combination of multiple robotic agents from the perspective of task-assignment and motion planning. Depending upon the task, agents might collaborate or work independently. Integrating motion planning with task-agent assignment is a computationally slow process as infeasible assignments can only be detected through expensive motion planning queries. We present three speed-up techniques for addressing this problem- (1) spatial constraint checking using conservative surrogates for motion planners, (2) instantiating symbolic conditions for pruning infeasible assignments, and (3) efficiently caching and reusing previously generated motion plans. We show that the developed method is useful for real-world operations that require complex interaction and coordination among high-DOF robotic agents.


The paper can be found here


March 2019

Sampling-based point-to-point motion planning for nonholonomic mobile manipulators

Summary

Determining a feasible path for a nonholonomic mobile manipulator operating in congested environments is challenging. Sampling-based methods, especially bi-directional tree search based approaches are amongst the most promising candidates for quickly finding feasible paths. However, sampling uniformly when using these methods may result in high computation time for nonholonomic mobile manipulator motion planning. This paper introduces two techniques to accelerate the motion planning. The first one is coordinated focusing for the manipulator and the mobile base based on the information from robot surroundings. The second one is a heuristic for making connections between the two search trees, which is challenging owing to the nonholonomic constraints on the mobile base. Incorporating these two techniques into the bi-directional RRT framework, results in about 5x faster and 10x more successful computation of paths as compared to the baseline method.



March 2020

Context-Dependent Search for Generating Paths for Redundant Manipulators in Cluttered Environments

Summary

We present a context-dependent bi-directional tree-search framework for point-to-point path planning for manipulators. Conceptually, our framework is composed of six modules: tree selection, focus selection, node selection, target selection, extend selection and connection type selection. Each module consists of a set of interchangeable strategies. By exploiting synergistic interaction between these strategies and selecting appropriate strategies based the contextual cues from the search state, we show an instance of our framework that computes high-quality solutions in a variety of complex scenarios with a low failure rate. We also show that some popular path planning methods in the literature can be easily represented in our framework. We compare our approach with these popular methods in a diverse set of test scenarios. We report a 15-fold reduction in failure rate coupled with at least a 26% drop in solution sub-optimality when compared to the best of the alternative methods.


March 2020

Virtual Target based Path Following

Summary

A new guidance logic for UAV path following using a virtual target is presented. The desired heading of the UAV follows an instantaneous circular arc which is tangential to the path at the virtual target position. Considering straight line and circular paths, a linear analysis of the resulting error dynamics presents a faster convergence as compared to existing methods. With no overshoot in the response, the method presents smooth following for higher look-ahead distances with respect to the virtual target. Comparative simulations are carried out complying with the analytic findings. The work highlights a simple guidance logic with a faster convergence and greater robustness with respect choice of the virtual target.


The paper can be found here


Aug 2015 - Mar 2016

Design and Navigation of Spherical Robot

Summary

The project invloved designing of a yoke and double pendulum actuated spherical robot. A PID control based turning motion primitive is designed to navigate the robot. Overhead cameras indoors and GPS outdoors along with IMU give the position of the robot. Patent for the design of the robot is pending.


Jul 2014 - May 2015


Robots

Mobile MAnipulator

Inspector Bot + UR5 + Robotiq 2-fingered gripper. Git repo coming soon.



KUKA iiwa 14

Assembly using two KUKA iiwa.