20 Basic Drone Swarm Simulation and Control Using Ardupilot and Gazebo

แชร์
ฝัง
  • เผยแพร่เมื่อ 6 ก.ย. 2024

ความคิดเห็น • 25

  • @trifle9932
    @trifle9932 4 ปีที่แล้ว +1

    Can't wait to see another video on setting multiple drones to achieve feature like search & rescue!! Good work!!

  • @vaveileinn8402
    @vaveileinn8402 4 ปีที่แล้ว +3

    I am looking forward to next video of tutorials. Great Job Sir !!

  • @SolvingOptimizationProblems
    @SolvingOptimizationProblems 4 ปีที่แล้ว +3

    Thank you very much for the code!

  • @ha__sh5437
    @ha__sh5437 3 ปีที่แล้ว +3

    Very respectful 👍🏻🙏🏻

  • @niloofar_gh_r8781
    @niloofar_gh_r8781 2 ปีที่แล้ว +1

    Hi, I have recently watched this video, everything goes right, until writing command "roslaunch iq_simrunway.launch" in terminal, and i receive this error "command not found: roslaunch", I will appreciate if anyone can help me. In addition, I have installed Gazebo on my mac.

  • @ben_cav
    @ben_cav ปีที่แล้ว

    Perfect! Thank you!

  • @beywalid3929
    @beywalid3929 3 ปีที่แล้ว +2

    how we can run swarm with YOLO

  • @ngocphinguyen6807
    @ngocphinguyen6807 4 ปีที่แล้ว +2

    I found the problem when I use the command: roslaunch iq_sim runway.launch
    Error Code 11 Msg: Unable to find uri[model://drone1]
    Could you help me?

    • @IntelligentQuads
      @IntelligentQuads  4 ปีที่แล้ว +3

      make sure you run the bellow code and source the .bashrc in the terminal that you plan to run the gazebo sim in
      echo "export GAZEBO_MODEL_PATH=${GAZEBO_MODEL_PATH}:$HOME/catkin_ws/src/iq_sim/models" >> ~/.bashrc

    • @ngocphinguyen6807
      @ngocphinguyen6807 4 ปีที่แล้ว +2

      @@IntelligentQuads I fixed the problem. Thank you very much and I am waiting for next videos.

    • @omerdeniz979
      @omerdeniz979 3 ปีที่แล้ว +2

      @@ngocphinguyen6807 Hey man, I'm getting the same mistake. How did you solve the problem?
      I wrote this code (echo "export GAZEBO_MODEL_PATH=${GAZEBO_MODEL_PATH}:$HOME/catkin_ws/src/iq_sim/models" >> ~/.bashrc" )into the terminal. But nothing changed

  • @naveedhussain4489
    @naveedhussain4489 3 ปีที่แล้ว +1

    how can i start from scratch to drone swarm please?

  • @FO-ti6wh
    @FO-ti6wh 3 ปีที่แล้ว +1

    Is it possible to simulate fixed wing UAVs with Gazebo in windows?

    • @IntelligentQuads
      @IntelligentQuads  3 ปีที่แล้ว +2

      There are fixed wing simulations in gazebo. Take a look at ardupilot_gazebo repo on GitHub

  • @neoxd8603
    @neoxd8603 4 ปีที่แล้ว +1

    Hi . I m getting link dawn for every drone when i use sim_vehicle.py . i followed every step in your tutorial and used the link above and still i m not getting done .

    • @IntelligentQuads
      @IntelligentQuads  4 ปีที่แล้ว +1

      I honestly cannot tell you why that happens, but I know that for whatever reason if you launch them in the right order, with the lowest instance being first and the highest instance being last it will launch properly.

    • @neoxd8603
      @neoxd8603 4 ปีที่แล้ว

      @@IntelligentQuads what do you mean by that ?

    • @neoxd8603
      @neoxd8603 4 ปีที่แล้ว

      @@IntelligentQuads how can i contact you ? I have a project to make with a swarm of drones .

    • @IntelligentQuads
      @IntelligentQuads  4 ปีที่แล้ว

      @@neoxd8603 the best way to contact me is through discord. Here is the link to the IQ discord.
      discord.gg/xZjXaAf
      Feel free to dm me

    • @shahzaib111111
      @shahzaib111111 4 ปีที่แล้ว +1

      could you figure out why link is down everytime? i am having same issue!

  • @-mammy
    @-mammy 2 ปีที่แล้ว +1

    link 1 down error pls help

    • @mikeyjoyce2844
      @mikeyjoyce2844 2 ปีที่แล้ว +2

      you need to run qgroundcontrol while youre running the command to start the drone

    • @ben_cav
      @ben_cav ปีที่แล้ว +1

      I resolved this issue by switching my ardupilot_gazebo repo from the dev branch to master branch. (Was accidentally using the wrong branch)

  • @nikhilreddymaddela6829
    @nikhilreddymaddela6829 3 ปีที่แล้ว +1

    r
    roslaunch iq_sim runway.launch
    RLException: [runway.launch] is neither a launch file in package [iq_sim] nor is [iq_sim] a launch file name
    The traceback for the exception was written to the log file
    I think are there any changed in model.srdf file