Skip to content
Snippets Groups Projects
Commit a034b9b8 authored by Antonio Andriella's avatar Antonio Andriella
Browse files

update documentation

parent 2a273792
No related branches found
No related tags found
No related merge requests found
"""
@Author: Antonio Andriella
This script displays the different facial expression in the screen.
"""
#!/usr/bin/env python
import rospy
......@@ -7,6 +11,7 @@ from std_msgs.msg import String
import numpy as np
from cv_bridge import CvBridge, CvBridgeError
bridge = CvBridge()
def xdisplay_callback(data):
#rospy.loginfo(rospy.get_caller_id() + "I heard %s", data.data)
try:
......@@ -20,14 +25,10 @@ def xdisplay_callback(data):
print(e)
#cv2.imwrite('/home/aandriella/pal/cognitive_game_ws/src/face_listener/color_img.jpg', cv_image)
def face_listener():
rospy.init_node('listener', anonymous=True)
rospy.Subscriber("/robot/expression_diplay", Image, xdisplay_callback)
rospy.spin()
if __name__ == "__main__":
face_listener()
0% Loading or .
You are about to add 0 people to the discussion. Proceed with caution.
Finish editing this message first!
Please register or to comment