38 NAME =
'test_base_odomx_gt'
42 roslib.load_manifest(PKG)
48 from geometry_msgs.msg
import Twist,Vector3
59 from test_base
import BaseTest, E, Q
67 while not rospy.is_shutdown()
and not self.
success and ( timeout_t
is None or time.time() < timeout_t ) :
70 self.
pub.publish(Twist(Vector3(TARGET_VX,TARGET_VY, 0), Vector3(0,0,TARGET_VW)))
72 timeout_t = time.time() + TEST_DURATION
80 if total_error < TARGET_TOL:
85 if __name__ ==
'__main__':
86 rostest.run(PKG, sys.argv[0], X_GT, sys.argv)