Universal Robot with ROS - How to simulate UR5 in Gazebo and code Inverse Kinematics in C++

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

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

  • @hekate1080
    @hekate1080 5 месяцев назад

    wow! From now on I will have a method to simulate any robot! Thank you! Please, keep doing these type of contents :)

  • @cemalhekim
    @cemalhekim 5 месяцев назад

    Thank you a lot! This is a great educational content. One small question tho. Would you think to make a video about UR ROS 2 driver and Gazebo Sim in ROS 2 Iron? Or can I simply follow the same steps on ROS 2 Iron and expect similar results?

    • @learn-robotics-with-ros
      @learn-robotics-with-ros  5 месяцев назад

      Yes! Is in the plan! I can anticipate you that the approach would me the same:
      URDF
      Spawn robot and controller in gazebo using the gazebo ros control plugin
      Create controllers for the joints (make sure that the same type of controller are put in moveit ros_controllers.yaml file)
      Run moveit
      If you have specific needs for your project, feel free to reach me out at ros.master.ai@gmail.com!

  • @Ironlad-bz9ut
    @Ironlad-bz9ut 5 месяцев назад

    hello, i got the gazebo simulation working but my rviz is not showing up

    • @learn-robotics-with-ros
      @learn-robotics-with-ros  5 месяцев назад

      Hi! Are you sure that you have launched the rviz node in the launch file with the moveit pluging?



      If you still have some problems you can book a free call with me here:
      calendly.com/ros-master-ai/30min

    • @Ironlad-bz9ut
      @Ironlad-bz9ut 5 месяцев назад

      To which launch do I need to add this and I am not using gripper now

    • @learn-robotics-with-ros
      @learn-robotics-with-ros  5 месяцев назад

      This is the launch file that Spawn the robot, the controllers and MoveIt with motion planning plugin
      github.com/LearnRoboticsWROS/ur_app_youtube/blob/main/launch%2Fspawn_ur5_gripper.launch

    • @Ironlad-bz9ut
      @Ironlad-bz9ut 5 месяцев назад

      Now is rviz is stuck showing intializing while I am launching spawn_ur5_eff_conttoller.launch

    • @amanchulawala7119
      @amanchulawala7119 3 месяца назад +2

      Check if you are un-pausing the gazebo environment once it loads. This could be a possible reason for the RViz hangup during initialization.