Motor failure plugin in Gazebo SITL topic not generating

I am currently trying to find out how to use the plugin
~/PX4-Autopilot/Tools/sitl_gazebo/src/gazebo_motor_failure_plugin.cpp
in the iris model

I have tried “catkin build -DBUILD_ROS_INTERFACE=ON” in the directory
~/PX4-Autopilot/Tools/sitl_gazebo

and also tried adding the motor failure plugin to the iris.sdf model like others did:

<plugin name="motor_failure" filename="libgazebo_motor_failure_plugin.so">
        <robotNamespace/>
        <ROSMotorNumSubTopic>/motor_failure/motor_number</ROSMotorNumSubTopic>
        <MotorFailureNumPubTopic>/gazebo/motor_failure_num</MotorFailureNumPubTopic>
</plugin> 

but the ROS topic /motor_failure/motor_number does not generate
Is there a way to solve this?

Thank you,
Kangmin Lee