Go to the documentation of this file.00001
00002
00003 import roslib; roslib.load_manifest('tidyup_tools')
00004 import rospy
00005 import sys
00006 import copy
00007
00008 from pr2_python.base import Base
00009
00010 if __name__ == '__main__':
00011 rospy.init_node('check_robot_locations', anonymous=True)
00012 loop_rate = rospy.Rate(1.0)
00013 rospy.loginfo('checking current robot state for collisions...')
00014 base = Base()
00015 while not rospy.is_shutdown():
00016 if base.check_base_pose(base.get_current_pose_stamped()):
00017 rospy.loginfo('current state is collision free.')
00018 else:
00019 rospy.logwarn('current state is in collision.')
00020 loop_rate.sleep()
00021
00022