ROS, when running px4 with gazebo_iris_opt_flow Drone camera not creating any topic

316 views Asked by At

I start mavros with this code:

roslaunch mavros px4.launch fcu_url:="udp://:[email protected]:14557"

then I start gazebo Quadrator with Optical Flow simulation with this code:

make px4_sitl_default gazebo_iris_opt_flow
source ~/catkin_ws/devel/setup.bash    # (optional)
source Tools/simulation/gazebo/setup_gazebo.bash $(pwd) $(pwd)/build/px4_sitl_default
export ROS_PACKAGE_PATH=$ROS_PACKAGE_PATH:$(pwd)
export ROS_PACKAGE_PATH=$ROS_PACKAGE_PATH:$(pwd)/Tools/simulation/gazebo/sitl_gazebo
roslaunch px4 posix_sitl.launch

when gazebo started I do rostopic list and there is no iris/camera/rgb/image_raw I have a python code which subscribes to iris/camera/rgb/image_raw topic and get Image.msg to find red spot and land. When I ran that code drone goes OFFBOARD mode (so code works) but can not see camera view with rqt and also drone does not land anywhere. So what is the problem?

I deleted PX4 and gazebo and reinstalled them nothing happened. I tried another topics that include camera in their name and also did not work.

1

There are 1 answers

0
MTO On

I reinstalled ubuntu and ROS. After that I reconfigured iris.sdf and my problem was solved.