Skip to content

Commit

Permalink
fix some unit tests
Browse files Browse the repository at this point in the history
  • Loading branch information
dirk-thomas committed Nov 28, 2013
1 parent 5585842 commit 816be2d
Show file tree
Hide file tree
Showing 3 changed files with 5 additions and 3 deletions.
2 changes: 1 addition & 1 deletion tools/rosgraph/test/test_network.py
Original file line number Diff line number Diff line change
Expand Up @@ -177,7 +177,7 @@ def test_get_bind_address(self):
from rosgraph.network import get_bind_address
assert '0.0.0.0' == get_bind_address('foo')
assert '127.0.0.1' == get_bind_address('localhost')
assert '127.0.0.1' == get_bind_address('127.0.1.1')
assert '127.0.1.1' == get_bind_address('127.0.1.1')

# now test address override
os.environ['ROS_IP'] = 'bar'
Expand Down
3 changes: 2 additions & 1 deletion utilities/roswtf/test/test_roswtf_command_line_offline.py
Original file line number Diff line number Diff line change
Expand Up @@ -71,7 +71,8 @@ def test_offline(self):
'rosbag', 'rosconsole', 'roscpp', 'rosgraph_msgs', 'roslang', 'rosmaster', 'rosmsg', 'rosout', 'rosparam', 'rospy', 'rostest', 'rostopic', 'topic_tools', 'xmlrpcpp',
'cpp_common', 'roscpp_serialization', 'roscpp_traits', 'rostime', # roscpp_core
'rosclean', 'rosunit', # ros
'rospack', 'std_msgs', 'message_runtime', 'message_generation', 'gencpp', 'genlisp', 'genpy', 'genmsg', 'catkin'
'rospack', 'std_msgs', 'message_runtime', 'message_generation', 'gencpp', 'genlisp', 'genpy', 'genmsg', 'catkin',
'console_bridge'
]
env['ROS_PACKAGE_PATH'] = os.pathsep.join([rospack.get_path(pkg) for pkg in pkgs])

Expand Down
3 changes: 2 additions & 1 deletion utilities/roswtf/test/test_roswtf_command_line_online.py
Original file line number Diff line number Diff line change
Expand Up @@ -82,7 +82,8 @@ def test_offline(self):
'rosbag', 'rosconsole', 'roscpp', 'rosgraph_msgs', 'roslang', 'rosmaster', 'rosmsg', 'rosout', 'rosparam', 'rospy', 'rostest', 'rostopic', 'topic_tools', 'xmlrpcpp',
'cpp_common', 'roscpp_serialization', 'roscpp_traits', 'rostime', # roscpp_core
'rosclean', 'rosunit', # ros
'rospack', 'std_msgs', 'message_runtime', 'message_generation', 'gencpp', 'genlisp', 'genpy', 'genmsg', 'catkin'
'rospack', 'std_msgs', 'message_runtime', 'message_generation', 'gencpp', 'genlisp', 'genpy', 'genmsg', 'catkin',
'console_bridge'
]
env['ROS_PACKAGE_PATH'] = os.pathsep.join([rospack.get_path(pkg) for pkg in pkgs])

Expand Down

0 comments on commit 816be2d

Please sign in to comment.