Go to the documentation of this file.00001
00002
00003 import rospy
00004 from sr_robot_msgs.srv import ManualSelfTest, ManualSelfTestResponse
00005
00006 class AutomaticResponse(object):
00007 """
00008 """
00009
00010 def __init__(self, ):
00011 """
00012 """
00013 self.srv_ = rospy.Service("/sr_self_test_test/manual_self_tests", ManualSelfTest, self.srv_cb_)
00014
00015 def srv_cb_(self, req):
00016 rospy.logerr(req.message)
00017
00018 return ManualSelfTestResponse(True, "Test")
00019
00020 if __name__ == '__main__':
00021 rospy.init_node("automatic_response")
00022 ar = AutomaticResponse()
00023 rospy.spin()
00024
00025