21 from std_msgs.msg
import ColorRGBA
26 rospy.wait_for_service(
'/light_controller/mode')
27 control_lights = rospy.ServiceProxy(
'/light_controller/mode', SetLightMode)
28 rospy.init_node(
'light_test')
29 light_mode = LightMode()
37 light_red = ColorRGBA()
80 light_mode.frequency=100
85 light_mode.sequences.append(seq1);
91 light_mode.sequences.append(seq2);
106 resp1 = control_lights(light_mode)
108 except rospy.ServiceException
as e:
109 print(
"Service call failed: %s"%e)
113 if __name__ ==
'__main__':
115 rospy.init_node(
'light_test')
117 except rospy.ROSInterruptException: