Gazebo sim bridge not working properly

i have followed the gazebo sim course and now want to add camera to my robot and have done that successfully but after using the bridge there are no messages generated on the topic

Following is the camera link and joint code in the urdf

<joint name="camera_joint" type="fixed">
        <parent link="base_link"/>
        <child link="camera_link"/>
        <origin xyz="0.305 0 0.08" rpy="0 0 0"/>
    </joint>
    <link name="camera_link">
        <pose>0.05 0.05 0.1 0 0 0</pose>
        <inertial>
            <origin xyz="0 0 0" rpy="0 0 0" />
            <mass value="0.5" />
            <inertia ixx="0.000252666666667" ixy="0" ixz="0" iyy="0.000252666666667" iyz="0" izz="0.0005"/>
        </inertial>
        <collision name="collision">
            <geometry>
                <box size="0.1 0.1 0.1"/>
            </geometry>
        </collision>
        <visual name="visual">
            <geometry>
                <box size="0.1 0.1 0.1"/>
            </geometry>
        </visual>
        <sensor name="camera" type="camera">
            <camera>
                <horizontal_fov>1.047</horizontal_fov>
                <image>
                    <width>320</width>
                    <height>240</height>
                </image>
                <clip>
                    <near>0.1</near>
                    <far>100</far>
                </clip>
            </camera>
            <always_on>1</always_on>
            <update_rate>30</update_rate>
            <visualize>true</visualize>
            <topic>camera</topic>
        </sensor>
    </link>

and this are the arguments of bridge in the launch file

arguments=[
            "/clock" + "@ rosgraph_msgs/msg/Clock" + "[ignition.msgs.Clock",
            "/cmd_vel" + "@ geometry_msgs/msg/Twist" + "@ ignition.msgs.Twist",
            "/tf" + "@ tf2_msgs/msg/TFMessage" + "[ignition.msgs.Pose_V",
            "/odom" + "@ nav_msgs/msg/Odometry" + "[ignition.msgs.Odometry",
            "/scan" + "@ sensor_msgs/msg/LaserScan" + "[ignition.msgs.LaserScan",
            "/imu" + "@ sensor_msgs/msg/Imu" + "[ignition.msgs.IMU",
            "/camera" + "@ sensor_msgs/msg/Image" + "[ignition.msgs.Image",
        ],

i am also getting the follwing warning on terminal
[ruby $(which ign) gazebo-1] libEGL warning: egl: failed to create dri2 screen

This topic was automatically closed 5 days after the last reply. New replies are no longer allowed.