Gps plugin not working with xacro file | libgazebo_gps_plugin.so

I am working with iris xacro file. GPS plugin is called in the xacro file

    <!-- Macro to add the gps_plugin. -->
  <xacro:macro name="gps_plugin_macro" params="namespace gps_noise">
    <gazebo>
      <plugin name='gps_plugin' filename='libgazebo_gps_plugin.so'>
        <robotNamespace/>
        <gpsNoise>1</gpsNoise>
        <linkName>base_link</linkName>
        <gpsSubTopic>/gps</gpsSubTopic>
      </plugin>
    </gazebo>
  </xacro:macro>

and I cross-checked libgazebo_gps_plugin.so is available and source in my PC
/PX4-Autopilot/build/px4_sitl_default/build_gazebo-classic/libgazebo_gps_plugin.so
Following error show up in QGC

The error has solved Check the following issue