Giter VIP home page Giter VIP logo

warehouse_gazebo's Introduction

L1Br: a Warehouse Robot Simulation

Description

Inspired by robots like the Kiva robot, the L1Br is a robot for distribution centers simulated through the gazebo. Using the control implemented in the robot, we can move around the warehouse,go under the shelves and activate the lift tray system,adapt the speed of the robot and perform the monitoring of several sensors. In order to bring simulation as close as possible to reality, we have implemented the laser sensor with an angle opening of 135ยฐ making it possible to calculate the distance to avoid collisions with the shelves,walls and even other robots, a camera at the bottom of the robot for reading qrcodes used to locate the robot, sensors such as wheel odometry and IMU are also present.

Status: ๐Ÿšง In progress ๐Ÿšง

Application Demo

warehouse_simulation

Click on the image below to watch a demonstration of the simulation:

Warehouse Gazebo Simulation

Contents

Requirements

Installation

In your workspace inside the src folder, place the robot_description and robot_control packages then do the following command to install the packages:

catkin_make

Running the Simulation

How to run the simulation environment

You can now use the following command to start the environment (use these commands within your workspace):

source ./devel/setup.bash
roslaunch robot_description spawn.launch

If all goes well you will see L1Br inside the middle of the warehouse.

How to run the robot control

If you want to move the robot through the warehouse use the following commands:

source ./devel/setup.bash
roslaunch robot_control control.launch

To move the tray open another terminal and use the command below with "data: 1" to go up and "data: 0" to go down:

rostopic pub -1 /my_robot/joint1_position_controller/command std_msgs/Float64 "data: 0"

How to run the Rviz

To use sensors like camera and optical sensor we created a shortcut through Rviz:

source ./devel/setup.bash 
roslaunch robot_description rviz.launch

How to change the map

The default map for the simulation is the LASER laboratory

WhatsApp Image 2022-02-14 at 10 18 31

It's possible to change it through the command line. In the example let's change it to the warehouse map:

roslaunch robot_description spawn.launch world:=warehouse

It works with any .world map

How to change the laser sensor

The default laser sensor is the rplidar sensor, but is possible to change it to the regular lidar sensor through the spawn.launch file

WhatsApp Image 2022-02-14 at 10 48 46

warehouse_gazebo's People

Contributors

claudiosouzabrito avatar jorgelz13 avatar

Recommend Projects

  • React photo React

    A declarative, efficient, and flexible JavaScript library for building user interfaces.

  • Vue.js photo Vue.js

    ๐Ÿ–– Vue.js is a progressive, incrementally-adoptable JavaScript framework for building UI on the web.

  • Typescript photo Typescript

    TypeScript is a superset of JavaScript that compiles to clean JavaScript output.

  • TensorFlow photo TensorFlow

    An Open Source Machine Learning Framework for Everyone

  • Django photo Django

    The Web framework for perfectionists with deadlines.

  • D3 photo D3

    Bring data to life with SVG, Canvas and HTML. ๐Ÿ“Š๐Ÿ“ˆ๐ŸŽ‰

Recommend Topics

  • javascript

    JavaScript (JS) is a lightweight interpreted programming language with first-class functions.

  • web

    Some thing interesting about web. New door for the world.

  • server

    A server is a program made to process requests and deliver data to clients.

  • Machine learning

    Machine learning is a way of modeling and interpreting data that allows a piece of software to respond intelligently.

  • Game

    Some thing interesting about game, make everyone happy.

Recommend Org

  • Facebook photo Facebook

    We are working to build community through open source technology. NB: members must have two-factor auth.

  • Microsoft photo Microsoft

    Open source projects and samples from Microsoft.

  • Google photo Google

    Google โค๏ธ Open Source for everyone.

  • D3 photo D3

    Data-Driven Documents codes.