All Projects → jacknlliu → ros-docker-images

jacknlliu / ros-docker-images

Licence: MIT License
🐳 Bring ROS to any Linux distributions.

Programming Languages

Dockerfile
14818 projects
shell
77523 projects
python
139335 projects - #7 most used programming language

Projects that are alternatives of or similar to ros-docker-images

Awesome Robotics
A curated list of awesome links and software libraries that are useful for robots.
Stars: ✭ 478 (+3086.67%)
Mutual labels:  robotics, simulation, ros
Plankton
Open source simulator for maritime robotics researchers
Stars: ✭ 51 (+240%)
Mutual labels:  robotics, simulation, ros
ROS-TCP-Connector
No description or website provided.
Stars: ✭ 123 (+720%)
Mutual labels:  robotics, simulation, ros
Webots
Webots Robot Simulator
Stars: ✭ 1,324 (+8726.67%)
Mutual labels:  robotics, simulation, ros
Ros Academy For Beginners
中国大学MOOC《机器人操作系统入门》代码示例 ROS tutorial
Stars: ✭ 861 (+5640%)
Mutual labels:  robotics, simulation, ros
smart grasping sandbox
A public sandbox for Shadow's Smart Grasping System
Stars: ✭ 69 (+360%)
Mutual labels:  robotics, simulation, ros
rosbots setup tools
Set up ROS, OpenCV and other ROSbots modules for your ROBbots robot
Stars: ✭ 97 (+546.67%)
Mutual labels:  robotics, ros
RoboticsAcademy
Learn Robotics with JdeRobot
Stars: ✭ 160 (+966.67%)
Mutual labels:  robotics, ros
igvc-software
The code base for the RoboNav team's IGVC robot.
Stars: ✭ 78 (+420%)
Mutual labels:  robotics, ros
bht-ams-playerstage
Player/Stage SLAM
Stars: ✭ 35 (+133.33%)
Mutual labels:  robotics, simulation
linorobot2
Autonomous mobile robots (2WD, 4WD, Mecanum Drive)
Stars: ✭ 97 (+546.67%)
Mutual labels:  robotics, ros
trac ik
ROS 2 port of `trac_ik`, an alternative Inverse Kinematics solver to the popular inverse Jacobian methods in KDL.
Stars: ✭ 14 (-6.67%)
Mutual labels:  robotics, ros
toy code
No description or website provided.
Stars: ✭ 78 (+420%)
Mutual labels:  simulation, ros
aruw-vision-platform-2019
ARUW's vision code from the 2019 season. Published here, read-only, for public reference.
Stars: ✭ 37 (+146.67%)
Mutual labels:  robotics, ros
Virtual-Robot-Challenge
How-to on simulating a robot with V-REP and controlling it with ROS
Stars: ✭ 83 (+453.33%)
Mutual labels:  simulation, ros
erwhi-hedgehog
Erwhi Hedgehog main repository
Stars: ✭ 31 (+106.67%)
Mutual labels:  robotics, ros
2019-UGRP-DPoom
2019 DGIST DPoom project under UGRP : SBC and RGB-D camera based full autonomous driving system for mobile robot with indoor SLAM
Stars: ✭ 35 (+133.33%)
Mutual labels:  robotics, ros
ROS-GPS
GPS Localization with ROS, OSM and rviz
Stars: ✭ 19 (+26.67%)
Mutual labels:  robotics, ros
robotic-warehouse
Multi-Robot Warehouse (RWARE): A multi-agent reinforcement learning environment
Stars: ✭ 62 (+313.33%)
Mutual labels:  robotics, simulation
bio ik
MoveIt kinematics_base plugin based on particle optimization & GA
Stars: ✭ 104 (+593.33%)
Mutual labels:  robotics, ros

ros-docker-images

docker startup demo

ROS desktop-full docker images with Qt C++ debug tool-chain for Fedora and other Linux users who do not use Ubuntu.

This project aims to build an All-in-One development environment for robot learning including robotics and deep reinforcement learning and a portable platform for intelligent robot applications.

Features

  • integrated with open source AMD and Intel GPU driver, and NVIDIA driver manually installation instruction
  • support gazebo simulation
  • including QtCreator and RoboWare as ROS IDE which supports build and debug your ROS packages
  • including terminator, a multi-windows supported free terminal emulator
  • including ranger - a console file manager with VI key bindings
  • including ros-desktop-full packages, currently support indigo and kinetic version
  • including a light weight file manager GUI application pcmanfm

Usage

  • Pull docker image
$ docker pull jacknlliu/ros:kinetic-ide-init

See it on docker hub.

  • set X access on your host for docker containers
$ xhost +
  • Run
docker run --privileged  \
 --security-opt label=disable  \
 --security-opt seccomp=unconfined  \
 --env="DISPLAY" --env QT_X11_NO_MITSHM=1  \
 --volume="/tmp/.X11-unix:/tmp/.X11-unix:rw"  \
 --volume="/home/<your_user_name>/Workspace:/data:rw"  \
 --volume="/path/to/gazebo_models:/home/ros/.gazebo/models:rw"  \
 --name="ros_kinetic"  \
 jacknlliu/ros:kinetic-ide-init terminator

NOTE: /home/<your_user_name>/Workspace defines your workspace according to your own workspace to share between your host and docker container,

/path/to/gazebo_models defines your gazebo models directory path.

Run the above command just in the first time, later please just run the container with its name, this will keep things easy.

$ docker start ros_kinetic
  • Troubleshooting with NVIDIA video card
    If you use NVIDIA video card, you should follow this instruction.

  • Run ros docker images on multiple hosts, please refer to robot-manipulation-cluster.

Known Issues and Limitations

  • It's a little large image.
  • common issues about NVIDIA GPU driver

Reference

LICENSE

This project is distributed under MIT License.

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].