diff --git a/stretch_gazebo/launch/gazebo.launch b/stretch_gazebo/launch/gazebo.launch index 148ae29..6b75bcd 100644 --- a/stretch_gazebo/launch/gazebo.launch +++ b/stretch_gazebo/launch/gazebo.launch @@ -1,15 +1,18 @@ - + + + + - + @@ -18,11 +21,11 @@ - + + args=" -urdf -model robot -param robot_description -J joint_lift 0.2 -J joint_wrist_yaw 3.14" respawn="false" output="screen" /> diff --git a/stretch_gazebo/scripts/publish_ground_truth_odom.py b/stretch_gazebo/scripts/publish_ground_truth_odom.py index f6ee321..ac76c62 100755 --- a/stretch_gazebo/scripts/publish_ground_truth_odom.py +++ b/stretch_gazebo/scripts/publish_ground_truth_odom.py @@ -3,14 +3,17 @@ from gazebo_msgs.srv import GetModelState, GetModelStateRequest, GetWorldProperties from nav_msgs.msg import Odometry from std_msgs.msg import Header +from std_srvs.srv import Empty import rospy +import time rospy.init_node('ground_truth_odometry_publisher') odom_pub=rospy.Publisher('ground_truth', Odometry, queue_size=10) -rospy.wait_for_service ('/gazebo/get_model_state') +rospy.wait_for_service('/gazebo/get_model_state') get_model_srv = rospy.ServiceProxy('/gazebo/get_model_state', GetModelState) get_world_properties = rospy.ServiceProxy('/gazebo/get_world_properties', GetWorldProperties) +unpause_physics = rospy.ServiceProxy('/gazebo/unpause_physics', Empty) odom=Odometry() header = Header() @@ -20,6 +23,12 @@ model.model_name='robot' models = [] r = rospy.Rate(20) +pause_timeout = time.time() + 4.0 +while time.time() < pause_timeout: + rospy.logwarn("Waiting %.2f seconds to unpause physics", pause_timeout - time.time()) + time.sleep(1.0) +unpause_physics() + while not rospy.is_shutdown(): if model.model_name not in models: models = get_world_properties().model_names diff --git a/stretch_gazebo/urdf/stretch_gazebo.urdf.xacro b/stretch_gazebo/urdf/stretch_gazebo.urdf.xacro index 57121dc..e7b071d 100644 --- a/stretch_gazebo/urdf/stretch_gazebo.urdf.xacro +++ b/stretch_gazebo/urdf/stretch_gazebo.urdf.xacro @@ -1,5 +1,8 @@ + + + @@ -237,39 +240,77 @@ Gazebo/Green - - - Gazebo/Black - - 0 0 0 0 0 0 - false - 5.5 - - - - 2000 - 1 - ${-M_PI} - ${M_PI} - - - - 0.5 - 12.0 - 0.01 - - - gaussian - 0.0 - 0.001 - - - - scan - laser - - - + + + + Gazebo/Black + + 0 0 0 0 0 0 + $(arg visualize_lidar) + 5.5 + + + + 2000 + 1 + ${-M_PI} + ${M_PI} + + + + 0.08 + 12.0 + 0.01 + + + gaussian + 0.0 + 0.001 + + + + scan + laser + + + + + + + + + Gazebo/Black + + 0 0 0 0 0 0 + $(arg visualize_lidar) + 5.5 + + + + 2000 + 1 + ${-M_PI} + ${M_PI} + + + + 0.08 + 12.0 + 0.01 + + + gaussian + 0.0 + 0.001 + + + + scan + laser + + + +