Closed HarshilNaikk closed 4 years ago
It looks like you're using ArduMavros. I have no idea if that works with PX4 like that.
And please put ``` around pasted log output or source to make it more readable.
@HarshilNaikk Tried with QGC and PX4 SITL and looks functional. Have you tried without using mavros? I am not sure the location is supposed to appear if you manually trigger the camera. It is usually only like that during a survey.
You can check Gazebo logs for details (~/.gazebo/server-11345/default.log on my machine) Image path looks like ~/Firmware/build/px4_sitl_default/tmp/frames target component for MAV_CMD_IMAGE_START_CAPTURE command should be 100 (https://github.com/PX4/sitl_gazebo/blob/master/src/gazebo_geotagged_images_plugin.cpp#L305)
@appetito Thanks!
Closing since the original author of the issue has not responded
I tried to use Mavlink to trigger the camera, but thats not happening. Also, when i triggered the camera using the GUI in QGC, the image icon does appear on the map, indicating that the image was captured, but i can't find the location where it was saved.
I am trying to use a py script to run a mission, which consists of this part. Any help would be appreciated.
This is the Script I am using:
@julianoes