but dronekit doesnot support python 3.so using python 3 for other would work with dronekit?i didnt under stand how python 3 for other and python 2 for dronekit would work together
@@PankajMali i am having problem of using python 3 with dronekit and mavproxy.i am wanting to take telemetry data as well as control drone usng raspberry pi running debian buster.can you provide me with resources and adaquate examples link or some reference
We are sorry, but we don't have maps at this zoom level for this region in Mission Planner (all versions). What is the exact issue with this error? do you have any solution to fix this. If YES then please post here. Thank You
@@PankajMali the problem is: the mode in mission planner is stabilize and I have to change it manually to Guided after I run the code in order to get rid of the error. If I don’t do that then the error in arming the motor will appear. Does that make sense for you?
@@PankajMali this is exactly what is happing after I run the code: Waiting for arming Taking off! Altitude: 0.0 Altitude: 0.0 Altitude: 0.0 Altitude: 0.1 Altitude: 0.2 Altitude: 0.3 Altitude: 0.4 Error: autopilot: Disarming motors Altitude: -0.1
Hii Can you please tell me what code are you using? Are you able to chnge mode from mavproxy terminal ? If yes then change mode to guided and give commands like. ARM THROTTLE >>> TAKEOFF 5. If it performs this then we can go to next step to run a python code to do same task . Please test it and let me know if ny errors.
Hello akshay, Thank you 😊 Nice question ....actually mission planner would be better as it works fine with sitl and also if you ran into some problem you will get a huge community support for troubleshooting your problem. And would recommend to go with ardupilot and gazebo it is more realistic
I am not able to run Dronekit script in python . I have python 3.8 and Ubuntu 20.04 and python has been automatically installed while I was setting up Ardupilot what can I do ??
Hello, can you please share the specific errors you are getting, as i have tested different python versions from 3.6/7/8/9... with ubuntu 20 i didnt find any issue yet.
Bro, I'm a UAV enthusiast just getting into actual autonomous stuff now(Pixhawk & ardupilot which i previously worked isnt really autonomous control). I read online that dronekit has almost no active development and is only kept alive by community in gitter.. Is MAVSDK really an alternative? or if any other is there, please do let me know. so for a beginner like me, where do you think i should start for building an autonomus indoor navigating drone?
Hello jagdish Yeah you are correct, there's not much updates with the ardupilot dronekit documentations. Yes when it comes to fully autonomous vehicles then MAVSDK is the real alternative. You need to go with MavRos for fully autonomous system as you might need to use Lidar or depth cameras and using Mav ros directly with Ros environment in your companion computers stands to be a better choice .
@@PankajMali Thanks for replying! Currently I'm following this project to test and try out MAVSDK circuitcellar.com/research-design-hub/design-solutions/writing-mavsdk-px4-drone-applications/ I have also joined the telegram group you've created and please guide me in this field! Thanks
Hi pankaj, really nice Explanation. Was able to replicate. But while sending entering command in cmd to arm throttle got an error pre arm safety check need position estimate. I have good GPS signal and calibrated couple of times. Any idea what could be the reason ?
Hello Basics, Can you please confirm whether you get 3d fix on the console. Are you simulating the aircraft or you have connected the physical hardware?
Hi Pankaj. My problem for resolved. That was due to the reason that fence was not enabled which triggered the error need position estimate. After ending fence mode this issue resolved. Now trying to complete the simulation before proceeding. Thanks for your help
Thank u so much, ive been stuck for months with errors and i can finally get to work! .. one question tho what drone are u using? I need to order one with dronekit compatibility, what do u recommend? ❤
I have custom build carbon fiber frame designed well for longer endurance, it has rpi and pixhawk with all other add on like , rpi 8mp pi camera , flow sensor and soon it will have lidar To get started you can use any ready to fly frame and add electronics as you need
@@PankajMali yo thats dope but im still a beginner and my focus is more on the software aspect for a uni project, i found good reviews on 3DR solo and ots compatibility with dronekit do u recommend that?
Hi teacher. Thanks for the video. I had a question. I activated the wind speed and wind direction values from the mission planner interface and it gives me the values, but I cannot access the same values through Dronekit Python. How can I do this in Python? In other words, I want to capture two telemetry data from the drone kit in the mission planner. thanks
Hello I know this is 2 years old video but I have question on the mavproxy packages part, the official ardupilot mavproxy page now only shows Python3 installation but we are recommended to use Python 2(Ubuntu 18.04), I tried writing "sudo apt-get install python-dev python-opencv python-wxgtk4.0 python-pip python-matplotlib python-pygame python-lxml python-yaml" but it doesnt work. Do you have a way to solve this issue?
@@PankajMali Hello Im currently running Python 2.7.18 on Ubuntu 20 I used the commands: udo apt-get install python-dev python-opencv python-wxgtk4.0 python-pip python-matplotlib python-lxml python-pygame The output is: Package python-wxgtk4.0 is not available, but is referred to by another package. This may mean that the package is missing, has been obsoleted, or is only available from another source Package python-pip is not available, but is referred to by another package. This may mean that the package is missing, has been obsoleted, or is only available from another source However the following packages replace it: python3-pip E: Package 'python-dev' has no installation candidate E: Unable to locate package python-opencv E: Package 'python-wxgtk4.0' has no installation candidate E: Package 'python-pip' has no installation candidate E: Unable to locate package python-matplotlib E: Unable to locate package python-lxml E: Unable to locate package python-pygame I understand that python 2 is no longer supported but we do need python 2 to run mavproxy and dronekit sitl right
Hello , There are possible 2 reasons 1. Updating mavlink package 2. Wait to get 3d fix or msg like ekf is using gps on the mavproxy terminal. Mostly many people have faced this issue, 1st option have solved the error
Please the Misiion Planner is not arming on my Ubuntu 22.04 when i run the code and when i forcefully arm it says not data recieved int 3 seconds ajnd the timer keeps increasing what could be wrong
hello, after writing a dronekit code and sending it to the drone, I run the code, everything is ok, but while the drone is going to the next waypoint, the altitude is not stable. I am using the simple_go function, and I mentioned the altitude. what could be the problem causing this variation of altitude.
Hello iheb Can you provide more information on the actual thing happening. Is the copter automatically going up and down ? If so then just have a normal manual flight in loiter mode with fast forward flight and check if the copter behavior is the same like in autonomous mission, if its the case then i got a solution to that
This is amazing Mali, what flight controller have you used? If it's PIX, can I use another flight controller, say for instance ardupilot or the popular Multiwi😁 Am planning to work on the same project by April... But I don't know the best flight controller to use.
Good question joe, best is to go with px4 and other options are like you can install arducopter firmware in any flight controller having UART port . Like cc3d , spf3 or any fc if uploaded with arducopter firmware.
Can anyone answer some of my queries? I am a complete beginner inside simulated drones world. 1. How gazebo communicates with ardupilot? (like ground control station used mavlink to send or recieve messages to flight controller), (how gazebo nows to take off when we give command to take off from ground control gui?) 2. Where comes ROS/ROS2? Where comes Mavros? 3. Like how the system work, Ground station DroneSITL BUT where should i place gazebo, ros/ros2, mavproxy?
Hello, 1. Gazebo uses plugins to communicate with arducopter stil 2.ros/ros2 comes with the cpp or python code that you write for your drone to perform the task ...like ros will help to send camera node data to your main code then makes decision and then publish the resultant data to some other node requesting data
I want a realistic drone simulator where there is a lot of things like real trees for a project but I don't know where and how I can get one, please can you propose me one?
Hello there really cool video! As a new drone enthusiast and want to learn drone simulation. I have a bunch of questions is there any way we can chat via zoom Id really appreciate it!
great work brother keep it up, but what if the shape and type of drone are not common like hydrus drone. in this case which software i can use for calibration and simulation of drone. please guide me on this. thank you sir.
Hello dipak, Thank you very much, if you have your own custom robotics designs to be implemented and also simulated them what you can do is like create a model of your robot using any Cad software like fusion 360 ......after that you can use gazebo api and develop your model there like adding linkages and defining the functionality of that particular part . Finally simulate your model in gazebo environment. Consider in part 2 we will see how to simulate a drone in gazebo using ardupilot plugins and if you are developing your own custom plugins for a drone then you can build your own controller program like in ardupilot plugins it has its own pid controller similarly you can design that . Hope this helps you
@@PankajMali thank you so much sir, for gazebo and ardupilot, it is necessary to install cygwin because i face trouble in cygwin and mavproxy. installation of mavproxy is complete but mavproxy map and console can't open.
No need to install cygwin because it is completely recommended to use ubuntu 16,18 mostly on dual boot rather than virtual box. Cygwin may get in trouble if used for ros github.com/punkypankaj/Installing-Gazebo-and-ArduPilot-Plugin
Hello naif, Both the things are same just the difference is on how they are required, If you just want to do some quick setup and have some tests with no more installation process then dronekit sitl works fine ....like in this part of video and it it maintained by 3d robotics And ardupilot sitl can work like dronekit sitl and moreover has plugins for the Irish model which can be simulated in gazebo 3d simulator giving more realistic experience which you will see in part 2 . It is maintained by ardupilot dev team
@@PankajMali sir as u told i am not using any rpi just blindly followed u r tutorial sir....how to change baud rate sir and chck these tx and rx connection sir please explain i am interest and new but struck here
If you get error like Got COMMAND_ACK : NAV_TAKEOFF : FAILED Got COMMAND_ACK : ARM_DISARM :FAILED Then first check if you have 3D fix in the mavproxy terminal and your copter should takeoff always in guided mode, if you havent mention in your python script about mode change then manually change the mode and then arm, still you get the error then its the problem with mavlink. Then install pymavlink==2.4.8 instead of latest one as of now 2.4.14 and you are good to go with it
Hello sampath Whenever you want to change the mode manually you need to send mavlink messages to the simulated vehicle and mavproxy command does the work for that, so in the video at 9:43 you can see the mavproxy teminal open you can just type the command to change mode or any command to manually take control over the vehicle. For example to change mode MAV > mode guided/stabilize/land
Sir in which ubuntu version you have install this?? because i'm trying to install in 20.04 I'm getting error. Error are package error,pip error and many more. please reply sir.
Acchually I am a biginer in coding and as well as in drone industry. I have a quadcopter with pixhawk 2.4.8, I want to run python code through a roseberry pi 3B+ model. So can you please guide me step by step how to do so?
@@PankajMali I'm doing my dissertation on sensor configurations for autonomously landing uavs via ArUco marker detection. I've attempted to install gazebo and ardupilot on a virtual machine running Ubuntu but its not going well. Do you know of any good SITL IDEs that are browser based or windows based that I can code in python and utilise the openCV libraries?
Hello anees, Please provide few more details for what steps you are following and what code you are executing. According to this error try updating mavlink
Hello dude, I'm having an issue hoping you can help me to over pass it, I got when I run QGroundControl : MAV> mode guided STABILIZE> Got COMMAND_ACK: REQUEST_MESSAGE: UNSUPPORTED Got COMMAND_ACK: SET_MESSAGE_INTERVAL: UNSUPPORTED Got COMMAND_ACK: REQUEST_MESSAGE: UNSUPPORTED Got COMMAND_ACK: REQUEST_MESSAGE: UNSUPPORTED AP: APM:Copter V3.3 (d6053245) AP: Frame: QUAD Got COMMAND_ACK: SET_MESSAGE_INTERVAL: UNSUPPORTED Received 526 parameters Saved 526 parameters to mav.parm fence breach GPS lock at 0 meters
Hello fodil, Hope you are doing well. So the issue with set message interval not supported as i see that you have copter v3.3 which doesnt have support for this type of messages. So i suggest you to install copter v 3.6 and above which has all the support for this messages. Also for fence breach error you can change the value for parameter list. I hope it helps you
Usually you wont get this issue in ardupilot if you are using px4 then you will surely get it as it doesnt support this messages. But anyways this issue is related with stream rate ( SRx paramater ) so you have used telemetry port (1or2) depending on that SR1/SR2 message interval frequency has to be changed usually its good to have 50 Hz . You can check that parameter So now before doing any above mentioned changes. Just try to execute your python code on the hardware and see if any error pops up ( which shouldn't occur as per logic)
Hii, can you please paste your code here Also do one more thing Just run ardupilot directory and in the terminal try to change mode to guided if it fails just wait for ekf alignment to get 3d fix After this you try changing mode to guided and takeoff to some height ....if it doesn't takes off then its problem with mavlink library versio
sampath@HP:~/dronekit-python/examples/simple_goto$ python simple_goto.py --connect 127.0.0.1:14550 Traceback (most recent call last): File "simple_goto.py", line 15, in from dronekit import connect, VehicleMode, LocationGlobalRelative ImportError: No module named dronekit i got error no module named dronekit
Please check Github repository for update on python3 packages as in video setup is based on python2 which is deprecated now.
but dronekit doesnot support python 3.so using python 3 for other would work with dronekit?i didnt under stand how python 3 for other and python 2 for dronekit
would work together
@numberthree-gf5zb dronekit works with python3
@@PankajMali i am having problem of using python 3 with dronekit and mavproxy.i am wanting to take telemetry data as well as control drone usng raspberry pi running debian buster.can you provide me with resources and adaquate examples link or some reference
Where is the repository I mean under what name
@@PankajMali please can more better because it is not downloading
Could not have done this without your help!!! Can't wait for part 2. Adding Gazebo will be a nice touch.
Yeah ...thank you marcus❣❣
We are sorry, but we don't have maps at this zoom level for this region in Mission Planner (all versions). What is the exact issue with this error? do you have any solution to fix this. If YES then please post here. Thank You
Dear Pankaj thanks for the video. I have a question: I applied your code (test1) but I have an error with motor
Hii,
Can you please elaborate your error.
@@PankajMali the problem is: the mode in mission planner is stabilize and I have to change it manually to Guided after I run the code in order to get rid of the error. If I don’t do that then the error in arming the motor will appear. Does that make sense for you?
@@PankajMali this is exactly what is happing after I run the code:
Waiting for arming
Taking off!
Altitude: 0.0
Altitude: 0.0
Altitude: 0.0
Altitude: 0.1
Altitude: 0.2
Altitude: 0.3
Altitude: 0.4
Error: autopilot: Disarming motors
Altitude: -0.1
Hii
Can you please tell me what code are you using?
Are you able to chnge mode from mavproxy terminal ? If yes then change mode to guided and give commands like. ARM THROTTLE >>> TAKEOFF 5.
If it performs this then we can go to next step to run a python code to do same task .
Please test it and let me know if ny errors.
If I go directly to mission planner and change the mode to guided, the error will not appear
Are we losing any dronekit functionality/functions by using python e.g. 3.9 instead of 2.7?
Hii,
In general, when transitioning from Python 2 to Python 3, there are syntax differences and some changes in library names.
great video
for SITL iam using QGC . which one would be better mission planner or QGC, because some custom commands dont work in QGC in sitl.
Hello akshay,
Thank you 😊
Nice question ....actually mission planner would be better as it works fine with sitl and also if you ran into some problem you will get a huge community support for troubleshooting your problem.
And would recommend to go with ardupilot and gazebo it is more realistic
@@PankajMali yes i am a begineer in gazebo , Thanks for the suggestion.
So next part is probably made for you and also upcoming videos because everything rounds up and comes to Ros and gazebo simulation
@@PankajMali thanks I'll stay tuned to learn 👍
Much appreciated
I am not able to run Dronekit script in python . I have python 3.8 and Ubuntu 20.04 and python has been automatically installed while I was setting up Ardupilot what can I do ??
Hello, can you please share the specific errors you are getting, as i have tested different python versions from 3.6/7/8/9... with ubuntu 20 i didnt find any issue yet.
Bro, I'm a UAV enthusiast just getting into actual autonomous stuff now(Pixhawk & ardupilot which i previously worked isnt really autonomous control).
I read online that dronekit has almost no active development and is only kept alive by community in gitter.. Is MAVSDK really an alternative? or if any other is there, please do let me know.
so for a beginner like me, where do you think i should start for building an autonomus indoor navigating drone?
Hello jagdish
Yeah you are correct, there's not much updates with the ardupilot dronekit documentations.
Yes when it comes to fully autonomous vehicles then MAVSDK is the real alternative.
You need to go with MavRos for fully autonomous system as you might need to use Lidar or depth cameras and using Mav ros directly with Ros environment in your companion computers stands to be a better choice .
@@PankajMali Thanks for replying!
Currently I'm following this project to test and try out MAVSDK
circuitcellar.com/research-design-hub/design-solutions/writing-mavsdk-px4-drone-applications/
I have also joined the telegram group you've created and please guide me in this field!
Thanks
Yeah sure, next video is on computer vision n then will get started with ROS, mavros for fully indoor autonomous vehicles
@@PankajMali thanks bro for quick response!
All the best!
Thank you🤘
There is no hardware required right?
I am a complete beginner in drones and wanted to learn more about drones. Thanks
Hello nilutpol
Yes you are correct, theres no need of hardware you can just program and simulate those codes and observe the behaviour
@@PankajMali Thanks a lot for this amazing video. Big fan of your work.
@@nilutpolkashyap thank you❣❣
Hi pankaj, really nice Explanation. Was able to replicate. But while sending entering command in cmd to arm throttle got an error pre arm safety check need position estimate. I have good GPS signal and calibrated couple of times. Any idea what could be the reason ?
Hello Basics,
Can you please confirm whether you get 3d fix on the console.
Are you simulating the aircraft or you have connected the physical hardware?
@@PankajMali I have got 3d fix on screen. I'm not simulating but connected the physical hardware.
Hi Pankaj. My problem for resolved. That was due to the reason that fence was not enabled which triggered the error need position estimate. After ending fence mode this issue resolved. Now trying to complete the simulation before proceeding. Thanks for your help
Good luck 👍
Thank u so much, ive been stuck for months with errors and i can finally get to work! .. one question tho what drone are u using? I need to order one with dronekit compatibility, what do u recommend? ❤
I have custom build carbon fiber frame designed well for longer endurance, it has rpi and pixhawk with all other add on like , rpi 8mp pi camera , flow sensor and soon it will have lidar
To get started you can use any ready to fly frame and add electronics as you need
@@PankajMali yo thats dope but im still a beginner and my focus is more on the software aspect for a uni project, i found good reviews on 3DR solo and ots compatibility with dronekit do u recommend that?
Yes i will always recommend that for a good start
@@PankajMali my man.. much respect thanks for taking the time to respond
@@yahya9889 hope it helped you.....thank you ❣❣
Hi teacher. Thanks for the video. I had a question. I activated the wind speed and wind direction values from the mission planner interface and it gives me the values, but I cannot access the same values through Dronekit Python. How can I do this in Python? In other words, I want to capture two telemetry data from the drone kit in the mission planner. thanks
Hello I know this is 2 years old video but I have question on the mavproxy packages part, the official ardupilot mavproxy page now only shows Python3 installation but we are recommended to use Python 2(Ubuntu 18.04), I tried writing "sudo apt-get install python-dev python-opencv python-wxgtk4.0 python-pip python-matplotlib python-pygame python-lxml python-yaml" but it doesnt work.
Do you have a way to solve this issue?
Hello pung what error do you get ?
Last week i have helped a person with installation with the same documentation as in the video it worked fine
@@PankajMali Hello Im currently running Python 2.7.18 on Ubuntu 20
I used the commands: udo apt-get install python-dev python-opencv python-wxgtk4.0 python-pip python-matplotlib python-lxml python-pygame
The output is:
Package python-wxgtk4.0 is not available, but is referred to by another package.
This may mean that the package is missing, has been obsoleted, or
is only available from another source
Package python-pip is not available, but is referred to by another package.
This may mean that the package is missing, has been obsoleted, or
is only available from another source
However the following packages replace it:
python3-pip
E: Package 'python-dev' has no installation candidate
E: Unable to locate package python-opencv
E: Package 'python-wxgtk4.0' has no installation candidate
E: Package 'python-pip' has no installation candidate
E: Unable to locate package python-matplotlib
E: Unable to locate package python-lxml
E: Unable to locate package python-pygame
I understand that python 2 is no longer supported but we do need python 2 to run mavproxy and dronekit sitl right
@@PankajMali Is it still possible to get Mavproxy prerequisite packages for Python 2? The current mavproxy page only has for Python 3
Can you please confirm me about your system is it ubuntu 18
your youtube videos really inspires me :)
Im glad it helps you .....thank you for appreciating ❣❣
hello sir, i cant change the mode from stabilize to guided even tho im giving the command 'mode guided' any help would be appriecate it
Hello ,
There are possible 2 reasons
1. Updating mavlink package
2. Wait to get 3d fix or msg like ekf is using gps on the mavproxy terminal.
Mostly many people have faced this issue, 1st option have solved the error
Please the Misiion Planner is not arming on my Ubuntu 22.04 when i run the code and when i forcefully arm it says not data recieved int 3 seconds ajnd the timer keeps increasing what could be wrong
Theres connection issue
Great video! Which version of Linux are you using. On Ubuntu 20.0.4, pip command does not work as Python 2 and pip seem to have been decommissioned
Hello Asim 👋
Im using ubuntu 16 and also 18
Yeah ubuntu 20 doesn't support
Good explanation, waiting for part 2
Thank you
hello, after writing a dronekit code and sending it to the drone, I run the code, everything is ok, but while the drone is going to the next waypoint, the altitude is not stable. I am using the simple_go function, and I mentioned the altitude. what could be the problem causing this variation of altitude.
Hello iheb
Can you provide more information on the actual thing happening.
Is the copter automatically going up and down ? If so then just have a normal manual flight in loiter mode with fast forward flight and check if the copter behavior is the same like in autonomous mission, if its the case then i got a solution to that
Amazing
Thankyou soo much it worked for me .
Im glad, it helped you
Cool, I look forward to the next video!
Thank you ....part 2 will be out in couple of days 💞
@@PankajMali cool!
This is amazing Mali, what flight controller have you used? If it's PIX, can I use another flight controller, say for instance ardupilot or the popular Multiwi😁
Am planning to work on the same project by April... But I don't know the best flight controller to use.
Good question joe, best is to go with px4 and other options are like you can install arducopter firmware in any flight controller having UART port .
Like cc3d , spf3 or any fc if uploaded with arducopter firmware.
@@PankajMali Thank you for the response.
really inspired by your works bro.....
Thank you
Can anyone answer some of my queries? I am a complete beginner inside simulated drones world.
1. How gazebo communicates with ardupilot? (like ground control station used mavlink to send or recieve messages to flight controller), (how gazebo nows to take off when we give command to take off from ground control gui?)
2. Where comes ROS/ROS2?
Where comes Mavros?
3. Like how the system work,
Ground station DroneSITL BUT where should i place gazebo, ros/ros2, mavproxy?
Hello,
1. Gazebo uses plugins to communicate with arducopter stil
2.ros/ros2 comes with the cpp or python code that you write for your drone to perform the task ...like ros will help to send camera node data to your main code then makes decision and then publish the resultant data to some other node requesting data
Please connect @punky_pankaj on instagram for more details
In the mavproxy terminal I am getting [[Errno 111] Connection refused sleeping], am I missing something?
Thank you.. waiting for part 2
Sure... part 2 will be out with some interesting opencv demonstrations too.
Hey @@PankajMali, nice tutorial. Thank you. Are you going to release the second part soon?
Thank you ....yes, Sure on this weekend.
Waiting for part 2 🔥👏👏
Yup in couple of days
I want a realistic drone simulator where there is a lot of things like real trees for a project but I don't know where and how I can get one, please can you propose me one?
Hello,
You can create you own simulation environment in gazebo , use can even use blender for this.
@@PankajMali thanks for replying.
What is the roadmap to handle gazebo quickly?
Waiting for next part
Will be out on weekend.....hope it helps you ❣❣
brother all is work but "vehicle.mode= VehicleMode()""
-mode not work return same mode! what cai I do??
What error are you getting on the terminal?
nothing showing ! mode return last mode
@@PankajMali
@Ais-qc1bc please connect on instagram @punky_pankaj
Proud of You My Boy.. 😍😘
Yeah
@@PankajMali 😍✌
for this simulation do we necessarily need a raspberry pi??
Hi,
No you dont need any hardware or raspberry pi.
@@PankajMali then, can you tell me what is that terminal??? where to download it
I have issue with mavlink I think it will arm and try take off and altitude will be always 0 and it will disarm Motor after that can u help me out
Hello rahul,
is your pixhawk connect to computer or powered via the micro usb port?
I was also facing the same issue with python 3. It works fine with python 2.7.
Hello there really cool video! As a new drone enthusiast and want to learn drone simulation. I have a bunch of questions is there any way we can chat via zoom Id really appreciate it!
Hello,
Thank you, yup we can connect
great work brother keep it up, but what if the shape and type of drone are not common like hydrus drone. in this case which software i can use for calibration and simulation of drone. please guide me on this. thank you sir.
Hello dipak,
Thank you very much, if you have your own custom robotics designs to be implemented and also simulated them what you can do is like create a model of your robot using any Cad software like fusion 360 ......after that you can use gazebo api and develop your model there like adding linkages and defining the functionality of that particular part . Finally simulate your model in gazebo environment.
Consider in part 2 we will see how to simulate a drone in gazebo using ardupilot plugins and if you are developing your own custom plugins for a drone then you can build your own controller program like in ardupilot plugins it has its own pid controller similarly you can design that .
Hope this helps you
@@PankajMali thank you so much sir, for gazebo and ardupilot, it is necessary to install cygwin because i face trouble in cygwin and mavproxy. installation of mavproxy is complete but mavproxy map and console can't open.
No need to install cygwin because it is completely recommended to use ubuntu 16,18 mostly on dual boot rather than virtual box.
Cygwin may get in trouble if used for ros
github.com/punkypankaj/Installing-Gazebo-and-ArduPilot-Plugin
@@PankajMali i think we all viewers face trouble in installation and setup of the software,but people like you help a lot, keep it up brother.
Thankful for your kind words❣❣
Pankaj, super great video ! Have you tried python3 - also what version of python 2 are you using? Craig
Hello craig
Yes i have tested python3 also and the python2 version i have is 2.7
Can Dronekit be run on python 3.8 cause I am getting errors??
Yes
Nice video Pankaj Sir👌💡
Thank you ...cheer❣❣
Perfect explanation .....waiting for next part
Thank you....part 2 is more interesting bcoz of gazebo and will be out soon🤘
Excellent 🙌 👍
Thank you
Waiting for part 2
Yeah... will be out soon ❣❣
Good ....very informative
Thank you 😊
Is there a difference between Dronekit-Sitl and Ardupilot-Sitl???
Hello naif,
Both the things are same just the difference is on how they are required,
If you just want to do some quick setup and have some tests with no more installation process then dronekit sitl works fine ....like in this part of video and it it maintained by 3d robotics
And ardupilot sitl can work like dronekit sitl and moreover has plugins for the Irish model which can be simulated in gazebo 3d simulator giving more realistic experience which you will see in part 2 . It is maintained by ardupilot dev team
@@PankajMali thank you for the response and we looking forward for part 2 👍👍😇😇
Yup its will be out in couple of days
WARNING:dronekit:Link timeout, no heartbeat in last 5 seconds error comes sir ...can somebody help
This error means that theres no communication between the autopilot and rpi . Main reasons are
1. Check the baudrate
2.check connections of tx rx
@@PankajMali sir as u told i am not using any rpi just blindly followed u r tutorial sir....how to change baud rate sir and chck these tx and rx connection sir please explain i am interest and new but struck here
@@PankajMali sir same error please help 🙏😢
Please Check first video
If you get error like
Got COMMAND_ACK : NAV_TAKEOFF : FAILED
Got COMMAND_ACK : ARM_DISARM :FAILED
Then first check if you have 3D fix in the mavproxy terminal and your copter should takeoff always in guided mode, if you havent mention in your python script about mode change then manually change the mode and then arm, still you get the error then its the problem with mavlink.
Then install pymavlink==2.4.8 instead of latest one as of now 2.4.14 and you are good to go with it
Thank you so much it worked!!
Wow ...you are good to go ahead 👍
yes am getting this error by using ubuntu 20.04
if am using console map . how to change the mode
Hello sampath
Whenever you want to change the mode manually you need to send mavlink messages to the simulated vehicle and mavproxy command does the work for that, so in the video at 9:43 you can see the mavproxy teminal open you can just type the command to change mode or any command to manually take control over the vehicle.
For example to change mode
MAV > mode guided/stabilize/land
really helpful this..
Im glad it helped you 🙌
Sir in which ubuntu version you have install this?? because i'm trying to install in 20.04 I'm getting error.
Error are package error,pip error and many more. please reply sir.
Hello akash,
This setup is tested and works perfect with ubuntu 16 and 18
@@PankajMali Sir Everything is done but getting error when i ran copter command and do i need to install mission planner separtely.
Dude u r awesome !
Thank you
Will this work with Pixhawk 2.4.8?
Ho shubeeksh,
Yes, it works with pixhawk 2.4.8 and also it works with any flight controller which has arducopter firmware loaded.
Ohh okay, thankyou!!
Im working on an autonomous drone project, could i contact you incase i have any queries
Yes, you can catch me up on Instagram @punky_pankaj ...Goodluck!!!
👌👌👌👌👌👌👌👌
Thank you ❣
Great stuff, Thanks :-)
Yeah ❣❣
Good work
Thank you
Why is it showing that 'sudo' is not recognized as an internal or external command?
Can you please tell the command that you wanted to execute along with sudo ?
Are you trying to run this command in windows?
Acchually I am a biginer in coding and as well as in drone industry. I have a quadcopter with pixhawk 2.4.8, I want to run python code through a roseberry pi 3B+ model. So can you please guide me step by step how to do so?
Because its my project and I am facing problems in every step
@@PankajMali yes
Great
Thank you ❣❣
Good but the background music was disturbing
No longer adding music in new videos
👍👍
Good mali
do you need ROS to do simulation ONLY
Can i just use windows?
You can use windows only for sitl, you need ubuntu for gazebo simulation
@@PankajMali can I use openCV in the SITL
Good question, yes you can use opencv in sitl as its just a platform to visualise your vehicle commands.
@@PankajMali I'm doing my dissertation on sensor configurations for autonomously landing uavs via ArUco marker detection. I've attempted to install gazebo and ardupilot on a virtual machine running Ubuntu but its not going well. Do you know of any good SITL IDEs that are browser based or windows based that I can code in python and utilise the openCV libraries?
keep on 👍
Thank you mate 🤘
brother plz make a new video with update Lenux
Hello,
Yes I'll start uploading soon with updated setup
@@PankajMali Thank u so much
why u late brother make new from first with update python
@@PankajMali
With python3 ,my video will be posted on dronedojo channel next week
Mya Allah give u hediah ! brother what is your religious status?@@PankajMali
release the part 2 of this video
Yes , probably on weekends it will be out and more interesting 😊
Your status is shown in Sonu's WhatsApp
So where is Gazebo?
Its in part 2, check next video
@@PankajMali I didn't watch second part. But I mean, people want to see a case when that SITL drone will fly within Gazebo sim environment.
remove the music, it frastruting following the tutorial with tath music playing
Yeah, no more much in my latest videos
AttributeError: 'module' object has no attribute 'MAV_COMP_ID_ODID_TXRX_1'
Hello anees,
Please provide few more details for what steps you are following and what code you are executing.
According to this error try updating mavlink
Hello dude, I'm having an issue hoping you can help me to over pass it, I got when I run QGroundControl :
MAV> mode guided
STABILIZE> Got COMMAND_ACK: REQUEST_MESSAGE: UNSUPPORTED
Got COMMAND_ACK: SET_MESSAGE_INTERVAL: UNSUPPORTED
Got COMMAND_ACK: REQUEST_MESSAGE: UNSUPPORTED
Got COMMAND_ACK: REQUEST_MESSAGE: UNSUPPORTED
AP: APM:Copter V3.3 (d6053245)
AP: Frame: QUAD
Got COMMAND_ACK: SET_MESSAGE_INTERVAL: UNSUPPORTED
Received 526 parameters
Saved 526 parameters to mav.parm
fence breach
GPS lock at 0 meters
Hello fodil,
Hope you are doing well.
So the issue with set message interval not supported as i see that you have copter v3.3 which doesnt have support for this type of messages.
So i suggest you to install copter v 3.6 and above which has all the support for this messages.
Also for fence breach error you can change the value for parameter list.
I hope it helps you
Usually you wont get this issue in ardupilot if you are using px4 then you will surely get it as it doesnt support this messages.
But anyways this issue is related with stream rate ( SRx paramater ) so you have used telemetry port (1or2) depending on that SR1/SR2 message interval frequency has to be changed usually its good to have 50 Hz . You can check that parameter
So now before doing any above mentioned changes. Just try to execute your python code on the hardware and see if any error pops up ( which shouldn't occur as per logic)
Hii, can you please paste your code here
Also do one more thing
Just run ardupilot directory and in the terminal try to change mode to guided if it fails just wait for ekf alignment to get 3d fix
After this you try changing mode to guided and takeoff to some height ....if it doesn't takes off then its problem with mavlink library versio
Ok so all good, now try executive the takeoff and python script for sitl
@Pankaj Mali Sorry, can you give more details on how to proceed. Because let's say I am a biginner and doing this as a FYP
sampath@HP:~/dronekit-python/examples/simple_goto$ python simple_goto.py --connect 127.0.0.1:14550
Traceback (most recent call last):
File "simple_goto.py", line 15, in
from dronekit import connect, VehicleMode, LocationGlobalRelative
ImportError: No module named dronekit
i got error no module named dronekit
Hello sampat,
Please check your command