Skip to content

Commit

Permalink
added new msg
Browse files Browse the repository at this point in the history
  • Loading branch information
Laurenhut committed Dec 4, 2017
1 parent e30d0b8 commit 029b878
Show file tree
Hide file tree
Showing 3 changed files with 6 additions and 2 deletions.
1 change: 1 addition & 0 deletions CMakeLists.txt
Original file line number Diff line number Diff line change
Expand Up @@ -20,6 +20,7 @@ add_message_files(
FILES
# AlvarMarkers.msg
ar_tag.msg
ar_tagstr.msg
)

generate_messages(
Expand Down
3 changes: 3 additions & 0 deletions msg/ar_tagstr.msg
Original file line number Diff line number Diff line change
@@ -0,0 +1,3 @@
string id
geometry_msgs/Pose pose

4 changes: 2 additions & 2 deletions src/artransforms.py
Original file line number Diff line number Diff line change
Expand Up @@ -2,7 +2,7 @@
import rospy
from std_msgs.msg import String
from ar_track_alvar_msgs.msg import AlvarMarkers,AlvarMarker
from ar_tag_demo.msg import ar_tag
from starbax.msg import ar_tag
import rospy
import sys
import numpy as np
Expand All @@ -24,7 +24,7 @@ def callback(self,data):
ar=ar_tag()
ar.id=data.markers[i].id
ar.pose=data.markers[i].pose.pose
print ar


self.pub.publish(ar)

Expand Down

0 comments on commit 029b878

Please sign in to comment.