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