21 from std_msgs.msg 
import ColorRGBA
    25         pub = rospy.Publisher(
'light_controller/command_mode', LightMode, queue_size=1)
    26         rospy.init_node(
'light_test')
    27         light_mode = LightMode()
    59         for color 
in [red,yellow,green,white,blue,green]:
    60                 rospy.loginfo(
"Setting rgb to %s [%d, %d, %d]",color.r,color.g,color.b,color.a)
    61                 light_mode.colors= 27*[color]
    62                 pub.publish(light_mode)
    65 if __name__ == 
'__main__':
    68     except rospy.ROSInterruptException: 
pass