All Projects → ivalab → grasp_multiObject

ivalab / grasp_multiObject

Licence: other
Robotic grasp dataset for multi-object multi-grasp evaluation with RGB-D data. This dataset is annotated using the same protocal as Cornell Dataset, and can be used as multi-object extension of Cornell Dataset.

Programming Languages

matlab
3953 projects

Projects that are alternatives of or similar to grasp multiObject

robotic-grasping
Antipodal Robotic Grasping using GR-ConvNet. IROS 2020.
Stars: ✭ 131 (+122.03%)
Mutual labels:  robotics, grasping
graspnet-baseline
Baseline model for "GraspNet-1Billion: A Large-Scale Benchmark for General Object Grasping" (CVPR 2020)
Stars: ✭ 146 (+147.46%)
Mutual labels:  robotics, grasping
graspnetAPI
Toolbox for our GraspNet-1Billion dataset.
Stars: ✭ 105 (+77.97%)
Mutual labels:  grasping, grasp
AI-Lab
🔬 Absolutely comfort lab for me to work around with my own AIs and to empirically observe how powerful and impactful these technologies are. I do love these technologies!
Stars: ✭ 19 (-67.8%)
Mutual labels:  robotics
SLAM AND PATH PLANNING ALGORITHMS
This repository contains the solutions to all the exercises for the MOOC about SLAM and PATH-PLANNING algorithms given by professor Claus Brenner at Leibniz University. This repository also contains my personal notes, most of them in PDF format, and many vector graphics created by myself to illustrate the theoretical concepts. Hope you enjoy it! :)
Stars: ✭ 107 (+81.36%)
Mutual labels:  robotics
Tinymovr
Compact brushless motor controller with integrated absolute encoder and CAN Bus.
Stars: ✭ 90 (+52.54%)
Mutual labels:  robotics
TORA.jl
Trajectory Optimization for Robot Arms
Stars: ✭ 27 (-54.24%)
Mutual labels:  robotics
academy
🎓 Video tutorials, slide decks and other training materials for developers learning about the FIWARE ecosystem.
Stars: ✭ 12 (-79.66%)
Mutual labels:  robotics
MeshCatMechanisms.jl
3D Visualization of mechanisms and URDFs using MeshCat.jl and RigidBodyDynamics.jl
Stars: ✭ 36 (-38.98%)
Mutual labels:  robotics
robo-playground
Games and examples built for RoboMaster EP with RoboMasterPy | 与你的大疆机甲大师愉快玩耍,基于RoboMasterPy构建
Stars: ✭ 33 (-44.07%)
Mutual labels:  robotics
robocup-firmware
Georgia Tech RoboJackets Firmware for the RoboCup Small Size League
Stars: ✭ 22 (-62.71%)
Mutual labels:  robotics
RoboticsAcademy
Learn Robotics with JdeRobot
Stars: ✭ 160 (+171.19%)
Mutual labels:  robotics
trac ik
ROS 2 port of `trac_ik`, an alternative Inverse Kinematics solver to the popular inverse Jacobian methods in KDL.
Stars: ✭ 14 (-76.27%)
Mutual labels:  robotics
PnC
Planning and Control Algorithms for Robotics
Stars: ✭ 22 (-62.71%)
Mutual labels:  robotics
brax
Massively parallel rigidbody physics simulation on accelerator hardware.
Stars: ✭ 1,208 (+1947.46%)
Mutual labels:  robotics
neonavigation
A 2-D/3-DOF seamless global/local mobile robot motion planner package for ROS
Stars: ✭ 199 (+237.29%)
Mutual labels:  robotics
MuJoCo RL UR5
A MuJoCo/Gym environment for robot control using Reinforcement Learning. The task of agents in this environment is pixel-wise prediction of grasp success chances.
Stars: ✭ 108 (+83.05%)
Mutual labels:  robotics
XBotControl
XBotControl framework: XBotCore + OpenSoT + CartesI/O
Stars: ✭ 23 (-61.02%)
Mutual labels:  robotics
erwhi-hedgehog
Erwhi Hedgehog main repository
Stars: ✭ 31 (-47.46%)
Mutual labels:  robotics
RCM
RCM is a simple CRM application designed for Auto Parts Store made with ASP.NET Core based on DDD, CQRS and SOLID Principles.
Stars: ✭ 29 (-50.85%)
Mutual labels:  grasp

grasp_multiObject

Robotic grasp dataset for multi-object multi-grasp evaluation with RGB-D data.
This dataset is annotated using the same protocal as Cornell Dataset, and can be used as multi-object extension of Cornell Dataset.

drawing


Usage

Download RGB-D data and put into grasp_multiObject/rgbd/

Each testing data has one RGB image (rgb_xxxx) and one depth image (depth_xxxx).
The corresponding grasp annotation (rgb_xxxx_annotations) can be found in grasp_multiObject/annotation/

Generate RG-D data?

mkdir rgd
run rgbd2rgd

you will have RG-D data in grasp_multiObject/rgd/

Crop images?

mkdir rgd_cropped320
mkdir rgb_cropped320
run image2txt

you will have cropped RGB and RGD images in grasp_multiObject/rgd_cropped320/ and grasp_multiObject/rgb_cropped320/, respectively.

also, you will have corresponding annotation files, as well as a full list of image path.

Visualize grasp?

run visualizationGripper

this file shows a simple example to visualize ground truth grasps

Annotate your own data?

git clone https://github.com/ivalab/grasp_annotation_tool

you can annotate grasps on your own data with this simple tool!
Both dataset and annotation tool can also be found here

Citation

If you find it helpful for your research, please consider citing:

@inproceedings{chu2018deep,
  title = {Real-World Multiobject, Multigrasp Detection},
  author = {F. Chu and R. Xu and P. A. Vela},
  journal = {IEEE Robotics and Automation Letters},
  year = {2018},
  volume = {3},
  number = {4},
  pages = {3355-3362},
  DOI = {10.1109/LRA.2018.2852777},
  ISSN = {2377-3766},
  month = {Oct}
}

If you encounter any questions, please contact me at fujenchu[at]gatech[dot]edu

Note that the project description data, including the texts, logos, images, and/or trademarks, for each open source project belongs to its rightful owner. If you wish to add or remove any projects, please contact us at [email protected].