Skip to content

Commit

Permalink
multi_ros: fixed pub script
Browse files Browse the repository at this point in the history
  • Loading branch information
ablasdel committed Mar 13, 2013
1 parent 5476b33 commit 190edbb
Show file tree
Hide file tree
Showing 3 changed files with 4 additions and 4 deletions.
2 changes: 1 addition & 1 deletion multi_ros/config/test.conf
Original file line number Diff line number Diff line change
Expand Up @@ -2,7 +2,7 @@
"prefix": "/r1",

"topics": [
{"topic": "/test_topic", "message_type": "std_msgs/String", "compression": "zlib", "rate": 1.0},
{"topic": "/chatter", "message_type": "std_msgs/String", "compression": "zlib", "rate": 1.0},
{"topic": "/rosout" , "message_type": "rosgraph_msgs/Log", "compression": "zlib", "rate": 1.0}
]
}
2 changes: 1 addition & 1 deletion multi_ros/scripts/pub
Original file line number Diff line number Diff line change
@@ -1,5 +1,5 @@
#!/usr/bin/env python
import roslib; roslib.load_manifest('mros')
import roslib; roslib.load_manifest('multi_ros')
import sys
import rospy
from std_msgs.msg import String
Expand Down
4 changes: 2 additions & 2 deletions multi_ros/scripts/ros_interface
Original file line number Diff line number Diff line change
@@ -1,9 +1,9 @@
#!/usr/bin/env python
PACKAGE_NAME = 'mros'
PACKAGE_NAME = 'multi_ros'
import roslib; roslib.load_manifest(PACKAGE_NAME)
import rospy

from mros.ros_interface import RosInterface
from multi_ros.ros_interface import RosInterface

rospy.init_node('ros_interface', anonymous=True)

Expand Down

0 comments on commit 190edbb

Please sign in to comment.