Skip to content

Commit

Permalink
Merge pull request #142 from pushkalkatara/kinetic-devel
Browse files Browse the repository at this point in the history
Issue #141
  • Loading branch information
k-okada authored Aug 20, 2018
2 parents f335b88 + 5af6776 commit dde1b01
Show file tree
Hide file tree
Showing 2 changed files with 3 additions and 3 deletions.
Original file line number Diff line number Diff line change
Expand Up @@ -46,7 +46,7 @@
import tf
from pr2_msgs.msg import PressureState
from geometry_msgs.msg import PointStamped, Vector3Stamped
from gazebo_plugins.msg import ContactState, ContactsState
from gazebo_msgs.msg import ContactState, ContactsState

import numpy
import math
Expand Down
4 changes: 2 additions & 2 deletions pr2_gazebo/scripts/pr2_simulate_torso_spring.py
Original file line number Diff line number Diff line change
Expand Up @@ -43,8 +43,8 @@
roslib.load_manifest('pr2_gazebo')
import rospy
import time
from gazebo.msg import *
from gazebo.srv import *
from gazebo_msgs.msg import *
from gazebo_msgs.srv import *

if __name__ == '__main__':
rospy.init_node('pr2_simulate_torso_spring')
Expand Down

0 comments on commit dde1b01

Please sign in to comment.