I am looking forward to next video of tutorials. Great Job Sir !!
@trifle99324 жыл бұрын
Can't wait to see another video on setting multiple drones to achieve feature like search & rescue!! Good work!!
@ha__sh54374 жыл бұрын
Very respectful 👍🏻🙏🏻
@SolvingOptimizationProblems4 жыл бұрын
Thank you very much for the code!
@beywalid39293 жыл бұрын
how we can run swarm with YOLO
@naveedhussain44894 жыл бұрын
how can i start from scratch to drone swarm please?
@niloofar_gh_r87812 жыл бұрын
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 Жыл бұрын
Perfect! Thank you!
@FO-ti6wh4 жыл бұрын
Is it possible to simulate fixed wing UAVs with Gazebo in windows?
@IntelligentQuads4 жыл бұрын
There are fixed wing simulations in gazebo. Take a look at ardupilot_gazebo repo on GitHub
@ngocphinguyen68074 жыл бұрын
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?
@IntelligentQuads4 жыл бұрын
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
@ngocphinguyen68074 жыл бұрын
@@IntelligentQuads I fixed the problem. Thank you very much and I am waiting for next videos.
@omerdeniz9794 жыл бұрын
@@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
@neoxd86034 жыл бұрын
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 .
@IntelligentQuads4 жыл бұрын
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.
@neoxd86034 жыл бұрын
@@IntelligentQuads what do you mean by that ?
@neoxd86034 жыл бұрын
@@IntelligentQuads how can i contact you ? I have a project to make with a swarm of drones .
@IntelligentQuads4 жыл бұрын
@@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
@shahzaib1111114 жыл бұрын
could you figure out why link is down everytime? i am having same issue!
@-mammy2 жыл бұрын
link 1 down error pls help
@mikeyjoyce28442 жыл бұрын
you need to run qgroundcontrol while youre running the command to start the drone
@ben_cav Жыл бұрын
I resolved this issue by switching my ardupilot_gazebo repo from the dev branch to master branch. (Was accidentally using the wrong branch)
@nikhilreddymaddela68293 жыл бұрын
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