[ROS Projects] - GMapping - Exploring ROS with a 2 wheeled robot - Part 13

Поделиться
HTML-код
  • Опубликовано: 11 сен 2024

Комментарии • 34

  • @H3MAESSAM
    @H3MAESSAM 6 лет назад +3

    thank you marco for this great series of tutorials.

  • @giannispetsas3014
    @giannispetsas3014 7 месяцев назад

    Thanks a lot.!

  • @sriperumbhudurkrishnavamsh504
    @sriperumbhudurkrishnavamsh504 3 года назад

    Thank you so much!

  • @nadersoliman623
    @nadersoliman623 6 лет назад +1

    thank u very much for this great tutorial

  • @ibrahimhlldmr
    @ibrahimhlldmr 4 года назад +2

    i wondered that. is gmappin algorithm of SLAM?
    right?

  • @rohitmehta6449
    @rohitmehta6449 4 года назад

    My fixed frame is set to /map also my map is formed properly unless after some time when the robot rotates or moves for a little while the orientation of the map changes and map is not formed properly. It starts to overlap on the formed region.

  • @Panaxis
    @Panaxis 5 лет назад +2

    How do you get the map visualization? When I run it I am only getting the laser data

    • @user-td3kx4ec6h
      @user-td3kx4ec6h 5 лет назад

      Use rviz for visualization

    • @TheConstruct
      @TheConstruct  5 лет назад +3

      You need to do several things:
      1. Use rviz for map visualization
      2. In rviz add a map visualizer
      3. Configure the map visualizer to the topic /map
      4. Make sure the fixed frame of the rviz is set to /map
      Then you should be able to visualize the map

    • @ranikinnal
      @ranikinnal 3 года назад

      @@TheConstruct i have done the above still unable to get the map visualization

  • @drilyasmeo
    @drilyasmeo 3 года назад

    Thanx Dear Robot Master! I saw most of the mapping demos/tutorial with manual driving the robot. This is the first I watched with autonomous drive (using Bug algo). Great !!...Can you make or refer to video of mapping with Multiple Robots working synchronously?

  • @afrahussain8798
    @afrahussain8798 3 года назад

    Is anybody else having trouble finding the files in the description?

  • @rafaelmartorano6844
    @rafaelmartorano6844 4 года назад +1

    Por favor, você poderia me dizer se é preciso saber programação para o uso do lidar? obrigado.

    • @marco.arruda
      @marco.arruda 3 года назад

      Olá Rafael! Depende de como será usado.. Você tem um dispositivo plug-and-play e quer apenas adicionar o lidar? Ou desenvolver algo utilizando o sensor?

  • @maniverma9447
    @maniverma9447 3 года назад

    How to create this myself?

  • @eogksalsrnr1989
    @eogksalsrnr1989 4 года назад

    Thank you for your video, and I could run your project after cloning it.
    I am wondering what I need to do when I would like to try other real data set of existing famous maps such as "Intel," "MIT Killian Court," "MIT CSAIL," "Freiburg bldg 79" etc.
    I am also wondering if you can obtain the error of trajectory between ground truth and estimate.
    I would appreciate your help.

  • @kyozho3912
    @kyozho3912 4 года назад +1

    hi, sorry i'm new with ROS i need your help. when i'm cloning your repo 'Two Wheeled Robot - Motion Planning" in my src workspace. then i "catkin_make" i have error and showing this message;
    CMake Error at /opt/ros/kinetic/share/catkin/cmake/catkinConfig.cmake:83 (find_package):
    Could not find a package configuration file provided by "gazebo_msgs" with
    any of the following names:
    gazebo_msgsConfig.cmake
    gazebo_msgs-config.cmake
    Add the installation prefix of "gazebo_msgs" to CMAKE_PREFIX_PATH or set
    "gazebo_msgs_DIR" to a directory containing one of the above files. If
    "gazebo_msgs" provides a separate development package or SDK, be sure it
    has been installed.
    Call Stack (most recent call first):
    two-wheeled-robot-motion-planning/CMakeLists.txt:10 (find_package)
    -- Configuring incomplete, errors occurred!
    See also "/home/ubuntu/ydlidar_ws/build/CMakeFiles/CMakeOutput.log".
    See also "/home/ubuntu/ydlidar_ws/build/CMakeFiles/CMakeError.log".
    Makefile:864: recipe for target 'cmake_check_build_system' failed
    make: *** [cmake_check_build_system] Error 1
    Invoking "make cmake_check_build_system" failed
    do you know how to solve this?

    • @TheConstruct
      @TheConstruct  4 года назад +1

      you have to install in your computer the ROS package ros-melodic-gazebo-msgs

    • @kyozho3912
      @kyozho3912 4 года назад

      @@TheConstruct hi, so the gazebo need to installed in "Computer/local" not in "Robot"? my ROS Computer is Noetic so its should be ros-noetic-gazebo-msgs in my case?

    • @TheConstruct
      @TheConstruct  4 года назад +1

      @@kyozho3912 yes install in local, not in robot.
      In order to install that package do the following command:
      sudo apt-get install ros-noetic-gazebo-ros-pkgs

    • @kyozho3912
      @kyozho3912 4 года назад

      @@TheConstruct hi thanks in advance.
      I got this after roslaunch gmapping.launch;
      ERROR: cannot launch node of type [gmapping/slam_gmapping]: gmapping
      i notice there is no gmapping for noetic version based on wiki, so its dead end for me haha

    • @TheConstruct
      @TheConstruct  4 года назад +1

      @@kyozho3912 Not necessariyl. What I would recommend you is to download the source code of gmapping and then try to compile it in Noetic. I suspect many changes but you still have a chance.

  • @MarcusVinicius-lq3fe
    @MarcusVinicius-lq3fe 3 года назад

    Oi Marco tudo bem? Marco gostei do teu tutorial já usei também gmapping anteriormente. Você saberia me dizer se O Autoware.Ai usa o Gmapping ou outro pkg? Estou tentando carregar dados do laserScan no tópico OccupancyGrid mas não sei se usar o Gmapping vai dar certo por cima desse outro pcl mapa?..se puder me dar umas dicas de como fazer isso responda nesse link por favor answers.ros.org/question/367056/costmap_generator-workbut-it-topic-semanticscostmap_generatoroccupancy_grid-do-not-have-data/#377423
    answers.ros.org/question/377308/autowareai-perception-failure-agent-not-detected-in-rviz/
    Muito obrigado

  • @shadyashraf1031
    @shadyashraf1031 Год назад

    Hi I am launching the file, but I am getting this error : RROR: cannot launch node of type [gmapping/slam_gmapping]: gmapping
    ROS path [0]=/opt/ros/noetic/share/ros
    ROS path [1]=/home/chady/catkin_ws/src
    ROS path [2]=/opt/ros/noetic/share
    [ERROR] [1687344549.939149827]: Could not find parameter robot_description on parameter server
    [robot_state_publisher-1] process has died [pid 40746, exit code 1, cmd /opt/ros/noetic/lib/robot_state_publisher/robot_state_publisher __name:=robot_state_publisher __log:=/home/chady/.ros/log/bb4e7404-101e-11ee-852c-55270613f758/robot_state_publisher-1.log].
    log file: /home/chady/.ros/lo
    explain this erro