All Projects → boschresearch → pcg_gazebo_pkgs

boschresearch / pcg_gazebo_pkgs

Licence: Apache-2.0 license
[DEPRECATED] Procedural generation library for Gazebo (please refer to https://github.com/boschresearch/pcg_gazebo)

Programming Languages

python
139335 projects - #7 most used programming language
Jupyter Notebook
11667 projects
HTML
75241 projects
CMake
9771 projects

Projects that are alternatives of or similar to pcg gazebo pkgs

raspimouse sim
ROS package suite for Raspberry Pi Mouse Simulator
Stars: ✭ 23 (-41.03%)
Mutual labels:  gazebo
Autonomus Indoor Drone
Final year project, autonomus indoor drone developed in ROS using DWM1001 dev-board
Stars: ✭ 26 (-33.33%)
Mutual labels:  gazebo
turtlebot rrt
Rapidly Exploring Random Tree (RRT) global path planning plugin for ROS Kinetic Kame
Stars: ✭ 86 (+120.51%)
Mutual labels:  gazebo
ign-math
General purpose math library for robot applications.
Stars: ✭ 35 (-10.26%)
Mutual labels:  gazebo
linorobot2
Autonomous mobile robots (2WD, 4WD, Mecanum Drive)
Stars: ✭ 97 (+148.72%)
Mutual labels:  gazebo
docker-ros-x11
A docker environment with ROS, Gazebo, X11 and Tensorflow
Stars: ✭ 29 (-25.64%)
Mutual labels:  gazebo
terrain generator
A wizard that generates terrains for Gazebo using height maps.
Stars: ✭ 46 (+17.95%)
Mutual labels:  gazebo
dockerfiles
Dockerfiles I use for development
Stars: ✭ 64 (+64.1%)
Mutual labels:  gazebo
ar-tu-do
ROS & Gazebo project for 1/10th scale self-driving race cars
Stars: ✭ 65 (+66.67%)
Mutual labels:  gazebo
summit xl sim
Packages for the simulation of the Summit XL, Summit XL HL and Summit-X (including X-WAM) robots
Stars: ✭ 32 (-17.95%)
Mutual labels:  gazebo
autonomous landing uav
ROS packages of the Autonomous landing system of a UAV in Gazebo
Stars: ✭ 44 (+12.82%)
Mutual labels:  gazebo
smart grasping sandbox
A public sandbox for Shadow's Smart Grasping System
Stars: ✭ 69 (+76.92%)
Mutual labels:  gazebo
ur-reaching-reinforcement-learning
Reinforcement learning using rlkit, UR5, Robotiq gripper on ROS(Robot Operating System)
Stars: ✭ 53 (+35.9%)
Mutual labels:  gazebo
gzweb
Web client for Gazebo classic simulation
Stars: ✭ 36 (-7.69%)
Mutual labels:  gazebo
open manipulator simulations
ROS Simulation for OpenManipulator
Stars: ✭ 15 (-61.54%)
Mutual labels:  gazebo
Pavilion
Unreal-based Gazebo Alternative
Stars: ✭ 30 (-23.08%)
Mutual labels:  gazebo
RoboticsAcademy
Learn Robotics with JdeRobot
Stars: ✭ 160 (+310.26%)
Mutual labels:  gazebo
Autonomous-Parking-System
Automatic Parking is an autonomous car maneuvering system (part of ADAS) that moves a vehicle from a traffic lane into a parking spot to perform parallel parking. The automatic parking system aims to enhance the comfort and safety of driving in constrained environments where much attention and experience is required to steer the car. The parking…
Stars: ✭ 39 (+0%)
Mutual labels:  gazebo
diffbot
DiffBot is an autonomous 2wd differential drive robot using ROS Noetic on a Raspberry Pi 4 B. With its SLAMTEC Lidar and the ROS Control hardware interface it's capable of navigating in an environment using the ROS Navigation stack and making use of SLAM algorithms to create maps of unknown environments.
Stars: ✭ 172 (+341.03%)
Mutual labels:  gazebo
Autonomous-Drifting
Autonomous Drifting using Reinforcement Learning
Stars: ✭ 83 (+112.82%)
Mutual labels:  gazebo

Procedural Generation for Gazebo

Build Status GitHub issues License

The Procedural Generation for Gazebo package is an Open Source Project extending the simulation capabilities of the robotics simulator Gazebo for automation and scripting of Gazebo simulations.

Visit the documentation page for more information.

Purpose of the project

This software is a research prototype.

The software is not ready for production use. It has neither been developed nor tested for a specific use case. However, the license conditions of the applicable Open Source licenses allow you to adapt the software to your needs. Before using it in a safety relevant setting, make sure that the software fulfills your requirements and adjust it according to any applicable safety standards (e.g. ISO 26262).

Requirements

Installation from source

Clone the repository into your catkin workspace

cd ~/catkin_ws/src
git clone https://github.com/boschresearch/pcg_gazebo_pkgs.git

then install the dependencies (replace kinetic for the ROS distribution you are using)

cd ~/catkin_ws
rosdep install --from-paths src --ignore-src -r -y

and install an additional dependency from trimesh

sudo apt install libspatialindex-dev

and then run catkin build.

Installation of Python dependencies

The Python dependencies for the pcg_gazebo library can be found in pcg_libraries/requirements.txt. Since some of them cannot be resolved using rosdep, the missing dependencies are going to be installed in pip using the default python version in the target system in the user space.

License

Procedural Generation for Gazebo is open-sourced under the Apache-2.0 license. See the LICENSE file for details.

For a list of other open source components included in Procedural Generation for Gazebo package, see the file 3rd-party-licenses.txt.

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