Go to the documentation of this file.00001
00002
00003
00004
00005
00006
00007
00008
00009
00010
00011
00012
00013
00014
00015
00016
00017
00018 import unittest
00019
00020 from geometry_msgs.msg import Pose
00021 import rospy
00022
00023 from baxter_app_rcp.sample_rpc import SampleRpcBaxter
00024
00025 PKG = 'baxter_rpc_server'
00026
00027
00028 class TestBaxterRpc(unittest.TestCase):
00029
00030 def setUp(self):
00031 self.sample_rpc = SampleRpcBaxter()
00032
00033 def tearDown(self):
00034 True
00035
00036 def test_cartesian_move_left(self):
00037 '''
00038 Test criteria: The ROS Service return bool, and True if the internal
00039 call finished without issue.
00040 '''
00041 self.assertTrue(self.sample_rpc.sample_cartesian_move('left'))
00042
00043 def test_cartesian_move_right(self):
00044 '''
00045 Test criteria: The ROS Service return bool, and True if the internal
00046 call finished without issue.
00047 '''
00048 self.assertTrue(self.sample_rpc.sample_cartesian_move('right'))
00049
00050 if __name__ == '__main__':
00051 import rostest
00052 rostest.rosrun(PKG, 'test_rpc', TestBaxterRpc)