ROS Beginner Tutorials: Examining the Simple Service and Client (python) - need some help [closed]

asked 2013-08-01 12:33:15 -0500

this post is marked as community wiki

This post is a wiki. Anyone with karma >75 is welcome to improve it.

Hey guys,

I'm following the ROS Tutorials and, using the Python language, I'm currently having some issues trying to solve the item Examining the Simple Service and Client item (www.ros .org/wiki/ROS/Tutorials/ExaminingServiceClient">link text).

When I try to run the server (the first step in the tutorial), I get the following message:

viki@ROS:~/catkin_ws/src$ rosrun beginner_tutorials add_two_ints_server.py
Unable to register with master node [http :// localhost:11311]: master may not be running yet. Will keep trying.

And then my Terminal window gets blocked. Before that, when I compiled the code (from the previous tutorial: <link>http :// www.ros .org/wiki/ROS/Tutorials/WritingServiceClient%28python%29</link>) everything seems to work fine:

viki@ROS:~/catkin_ws$ catkin_make
Base path: /home/viki/catkin_ws
Source space: /home/viki/catkin_ws/src
Build space: /home/viki/catkin_ws/build
Devel space: /home/viki/catkin_ws/devel
Install space: /home/viki/catkin_ws/install
####
#### Running command: "make cmake_check_build_system" in "/home/viki/catkin_ws/build"
####
####
#### Running command: "make -j1 -l1" in "/home/viki/catkin_ws/build"
####
[  0%] Built target std_msgs_generate_messages_lisp
[  2%] Built target beginner_tutorials_generate_messages_lisp
[  2%] Built target std_msgs_generate_messages_py
[  7%] Built target beginner_tutorials_generate_messages_py
[  7%] Built target std_msgs_generate_messages_cpp
[ 10%] Built target beginner_tutorials_generate_messages_cpp
[ 10%] Built target beginner_tutorials_generate_messages
[ 11%] Built target roscpp_tutorials_generate_messages_cpp
[ 11%] Built target roscpp_tutorials_gencpp
[ 12%] Built target add_two_ints_client
[ 14%] Built target add_two_ints_server
[ 15%] Built target add_two_ints_server_class
[ 16%] Built target anonymous_listener
[ 18%] Built target babbler
[ 19%] Built target custom_callback_processing
[ 20%] Built target listener
[ 22%] Built target listener_async_spin
[ 23%] Built target listener_class
[ 24%] Built target listener_multiple
[ 25%] Built target listener_threaded_spin
[ 27%] Built target listener_unreliable
[ 28%] Built target listener_with_tracked_object
[ 29%] Built target listener_with_userdata
[ 31%] Built target node_handle_namespaces
[ 32%] Built target notify_connect
[ 33%] Built target parameters
[ 36%] Built target roscpp_tutorials_generate_messages_py
[ 37%] Built target roscpp_tutorials_generate_messages_lisp
[ 37%] Built target roscpp_tutorials_generate_messages
[ 38%] Built target talker
[ 40%] Built target time_api_sleep
[ 41%] Built target timers
[ 49%] Built target rospy_tutorials_generate_messages_py
[ 54%] Built target rospy_tutorials_generate_messages_lisp
[ 59%] Built target rospy_tutorials_generate_messages_cpp
[ 59%] Built target rospy_tutorials_generate_messages
[ 59%] Built target std_srvs_generate_messages_cpp
[ 59%] Built target geometry_msgs_generate_messages_cpp
[ 68%] Built target turtlesim_generate_messages_cpp
[ 68%] Built target turtlesim_gencpp
[ 70%] Built target draw_square
[ 71%] Built target mimic
[ 72%] Built target turtle_teleop_key
[ 72%] Built target std_srvs_generate_messages_py
[ 72%] Built target geometry_msgs_generate_messages_py
[ 84%] Built target turtlesim_generate_messages_py
[ 84%] Built target std_srvs_generate_messages_lisp
[ 84%] Built target geometry_msgs_generate_messages_lisp
[ 93%] Built target turtlesim_generate_messages_lisp
[ 93%] Built target turtlesim_generate_messages
[100%] Built target turtlesim_node
viki@ROS:~/catkin_ws$

When I try roswtf I get no error:

viki@ROS:~/catkin_ws$ roswtf
No package or stack in context
================================================================================ Static checks summary:

No errors or warnings
================================================================================

ROS Master does not appear to be
running. Online graph checks will not
be run. ROS_MASTER_URI is
[http :// localhost:11311]

I haven't found any clues on the web related to this and I can't figure it out what's really happening.

Can anyone help me? Thanks in advance,

Batta

edit retag flag offensive reopen merge delete

Closed for the following reason duplicate question by Martin Günther
close date 2013-08-02 00:07:10

Comments

Please post a question only one time ( if it is the same thing you want to ask) and if you feel that it is not been noticed then you can modify the same question again and it appears as fresh question. When you modify the question it appears as a fresh post again.

lifelonglearner gravatar image lifelonglearner  ( 2013-08-01 16:00:27 -0500 )edit

Either I didn't see it or you forgot to mention; you started roscore right? http://www.ros.org/wiki/roscore

yigit gravatar image yigit  ( 2013-08-01 22:57:25 -0500 )edit

Ok. I had some problems trying to send the question via virtual machine (I'm running Linux in Virtual Box), and I tried many times, but the question could not be posted. Next time I'll try it only with my Mac.

Batta gravatar image Batta  ( 2013-08-02 06:30:46 -0500 )edit