21 from std_msgs.msg
import ColorRGBA
24 pub = rospy.Publisher(
'light_controller/command', ColorRGBA, queue_size=1)
25 rospy.init_node(
'light_test')
57 for color
in [red,yellow,green,white,blue,green]:
58 rospy.loginfo(
"Setting rgb to %s [%d, %d, %d]",color.r,color.g,color.b,color.a)
62 if __name__ ==
'__main__':
65 except rospy.ROSInterruptException:
pass