|
|
@ -17,7 +17,7 @@ class NeopixelDriverNode:
|
|
|
|
self.serial = Serial(self.port, 115200, timeout=1)
|
|
|
|
self.serial = Serial(self.port, 115200, timeout=1)
|
|
|
|
|
|
|
|
|
|
|
|
def listen(self):
|
|
|
|
def listen(self):
|
|
|
|
rospy.init_node("light_ctrl", anonymous=True)
|
|
|
|
rospy.init_node("light_ctrl", anonymous=True, log_level=rospy.INFO)
|
|
|
|
rospy.Subscriber("/neopixel", Neopixels, self.neopixel_ctrl_callback)
|
|
|
|
rospy.Subscriber("/neopixel", Neopixels, self.neopixel_ctrl_callback)
|
|
|
|
rate = rospy.spin()
|
|
|
|
rate = rospy.spin()
|
|
|
|
|
|
|
|
|
|
|
|