5 from std_msgs.msg 
import Int32
 
   12     color = (52, 152, 219)
 
   13     text.fg_color.r = color[0] / 255.0
 
   14     text.fg_color.g = color[1] / 255.0
 
   15     text.fg_color.b = color[2] / 255.0
 
   18     text.text = 
"Samples: %d" % (count)
 
   28     pub = rospy.Publisher(
"capture_text", OverlayText)
 
   29     sub = rospy.Subscriber(
"capture_count", Int32, callback)
 
   32 if __name__ == 
"__main__":
 
   33     rospy.init_node(
"capture_rviz_text")