ROS Pluging in model.sdf (Not Working)
Hi everyone,
I am trying to add ROS camera model to the gazebo model.Camera and mymodel are different models.
Camera model sdf like below:
I start empty_world.launch with a roslaunch gazebo_ros empty_world.launch
command.After that instert the camera model to the world.When I enter the rostopic list
to the console ,I can see the topics about the camera.
Also I can see the image in the Topic Visualization in Gazebo. Shortly everything is fine.
I added camera model to the mymodel like below;
<include>
<uri>model://camera</uri>
<pose>0.2 0 0.2 0 0 0</pose>
</include>
<joint name="camera_joint" type="fixed">
<child>camera::link</child>
<parent>plane::base_link</parent>
</joint>
and I start the empty_world like above and then instert my model to the world.I do not get a any error during this operations.When I enter the rostopic list
to the console also ı can see the topics.I do not see any image in the Topic Visualization.When I try to rostopic echo /image_raw
I didn't see any message on the topic.When I add only camera model I saw.
What I am doing wrong!!! Thanks.
Kindly post the camera
model.sdf
as formatted text and the fullmymodel
. It would be easier for us to helpI added,I found something else. When I removed the imu sensor I saw the camera was working. but i can't fly without imu sensor. what could be the reason?
I think my issue about the update rate of the sensor. When I deleted updated rate of imu sensor, camera started publish message.It stops after few minutes later.What ı am missing?
Might want to check your CPU load if that's the case. Simulating certain sensors can take a toll on CPU. I have cases where simulating lidars makes lidar readings come in once every 10+ seconds. In your case, your imu sensor update rate of 1000 is prolly too high.