Skip to content

Commit

Permalink
Merge pull request #61 from Tobias-Fischer/noetic-devel
Browse files Browse the repository at this point in the history
print_function for py3
  • Loading branch information
mabelzhang authored Mar 8, 2021
2 parents c15b36e + 1e5c61a commit dd1b79e
Show file tree
Hide file tree
Showing 2 changed files with 6 additions and 2 deletions.
4 changes: 3 additions & 1 deletion interactive_marker_tutorials/scripts/menu.py
Original file line number Diff line number Diff line change
Expand Up @@ -29,6 +29,8 @@
POSSIBILITY OF SUCH DAMAGE.
"""

from __future__ import print_function

import rospy

from interactive_markers.interactive_marker_server import *
Expand Down Expand Up @@ -68,7 +70,7 @@ def modeCb(feedback):

rospy.loginfo("Switching to menu entry #" + str(h_mode_last))
menu_handler.reApply( server )
print "DONE"
print("DONE")
server.applyChanges()

def makeBox( msg ):
Expand Down
4 changes: 3 additions & 1 deletion interactive_marker_tutorials/scripts/simple_marker.py
Original file line number Diff line number Diff line change
Expand Up @@ -29,14 +29,16 @@
POSSIBILITY OF SUCH DAMAGE.
"""

from __future__ import print_function

import rospy

from interactive_markers.interactive_marker_server import *
from visualization_msgs.msg import *

def processFeedback(feedback):
p = feedback.pose.position
print feedback.marker_name + " is now at " + str(p.x) + ", " + str(p.y) + ", " + str(p.z)
print(feedback.marker_name + " is now at " + str(p.x) + ", " + str(p.y) + ", " + str(p.z))

if __name__=="__main__":
rospy.init_node("simple_marker")
Expand Down

0 comments on commit dd1b79e

Please sign in to comment.