How to Create a ROS Service Server

How to Create a ROS Service Server

Hello ROS Developers! In this post (and embedded video), we will see how to create a ROS Service Server (or simply ROS Service) in just five minutes! We’ll see in it action as well as learn some theory behind it.

Let’s go!

Step1: Create an account and/or Login to Robot Ignite Academy (RIA)

On RIA, you get access to the best online ROS courses and environment. No need to install and set up ROS locally; the only thing you need is a browser!

  • Create an account and/or login here.
  • Launch the ROS Basics in 5 Days Python course.
  • You’ll now have access to the simulation screen with a Notebook, an Editor, four Shells, and a Simulation Window. We are only using the Editor and Shells for this demo.

Step 2: Create a ROS Service Server and call it!

ROS Services use a client/server approach. A server provides services, a client calls the server to use the services.

Here, we’ll create a simple service server based on Python and then call it from the command line, all in five easy steps! (In another post, we’ll see how to call the service server from Python code).

(1) On Shell #1, change to the source directory and create an executable python file (since this is a simple demo, we are not creating a ROS package):

user:~$ cd catkin_ws/src
user:~/catkin_ws/src$ touch sos_service.py
user:~/catkin_ws/src$ chmod +x sos_service.py
user:~/catkin_ws/src$

(2) Open sos_service.py in the Editor and copy-paste the following code into it.

#! /usr/bin/env python
import rospy                                      # the main module for ROS-python programs
from std_srvs.srv import Trigger, TriggerResponse # we are creating a 'Trigger service'...
                                                  # ...Other types are available, and you can create
                                                  # custom types
def trigger_response(request):
    ''' 
    Callback function used by the service server to process
    requests from clients. It returns a TriggerResponse
    '''
    return TriggerResponse(
        success=True,
        message="Hey, roger that; we'll be right there!"
    )

rospy.init_node('sos_service')                     # initialize a ROS node
my_service = rospy.Service(                        # create a service, specifying its name,
    '/fake_911', Trigger, trigger_response         # type, and callback
)
rospy.spin()                                       # Keep the program from exiting, until Ctrl + C is pressed

(3) Run the service server in Shell #1:

user:~/catkin_ws/src$ ./sos_service.py # press enter

(4) In Shell #2, see a list of available services, you should find /fake_911:

user:~$ rosservice list
...
/fake_911
...
user:~$

(5) Call your service in Shell #2:

user:~$ rosservice call /fake_911 "{}"
success: True
message: "Hey, roger that; we'll be right there!"

Let’s wrap up with a bit of “small talk” in the next section.

Step 3: Master the Concept: Creating a ROS Service Server

  • A ROS Service Server accepts a request and returns a response. In this case, our server is the Python code.
  • A ROS Service Client makes requests to a ROS Service Server. Our “client” in this case was the shell!

Please see the inline comments for an explanation of the code.

Done!

Extra: Video

Prefer to see the ‘sights and sounds’ version of this post? We made this video just for you!

Feedback

If you are interested in this topic, please check our ROS Basics in 5 Days course where you’ll learn how to create topic, service, and action in ROS.

Did you like this post? Please leave a comment on the comments section below, so we can interact and learn from each other. Thank you!

[ROS Projects] – Use OpenAI_ROS with Turtlebot2 Step by Step – PE

[ROS Projects] – Use OpenAI_ROS with Turtlebot2 Step by Step – PE

 

This is an extra short video updating what it has been done new on OpenAI_ROS package. You can find the link to the package wiki down below.
This is important for the people that saw the other two videos, because the structure of the package has changed and it might lead to some confusion and errors.

[irp posts=”10259″ name=”ROS Projects – Use OpenAI_ROS with Turtlebot2 Step by Step #Part 1″]

[irp posts=”10441″ name=”ROS Projects – Use OpenAI_ROS with TurtleBot2 Step-by-Step #Part 2″]

Step 0. Create a project in ROS Development Studio(ROSDS)

ROSDS helps you follow our tutorial in a fast pace without dealing without setting up an environment locally. If you haven’t had an account yet, you can create a free account here. Let’s create a new project and call it rrbot_control. You can easily clone the project with this link.

Step 1. Train Turtlebot 2 with OpenAI ROS

In the ROSject, we already clone the openai ros package for you. You can run the turtlebot 2 simulation from Simulations->Select launch file->main.launch. You should see the simulation is up and running.

Then you can run the training script with

cd catkin_ws
source devel/setup.bash
roslaunch turtle2_openai_ros_example start_training.launch

The robot starts moving and learning how to move in a maze.

Want to learn more?

If you are interested in using the openAI gym in ROS, please check our OpenAI Gym for Robotics 101 course.

Edit by: Tony Huang


 

[ROS Q&A] 149 – How to command joint position of a robot in ROS using Python?

This video extends the excellent tutorial on Gazebo-ROS control by demonstrating a Python script that will send the command to move a robot. The robot is used as an example, and a simple Python code sends joint position command to it through the appropriate topic.

This video is a response to a question posted on Gazebo Answers

Step 0. Create a project in ROS Development Studio(ROSDS)

ROSDS helps you follow our tutorial in a fast pace without dealing without setting up an environment locally. If you haven’t had an account yet, you can create a free account here. Let’s create a new project and call it rrbot_control. You can easily run the RRBOT simulation from Simulations->RRBOT in ROSDS.

Step 1. Load controller

If you launch the simulation successfully, you should see the robot is swinging its arm. As an example, the controller for this robot is already developed. You can launch the controller with the following command.

roslaunch rrbot_control rrbot_control.launch

Now if you type rostopic list , you should see several topic like /rrbot/joint1_position_controller/command in the list. We can publish to these topics to control the robot. For example,

rostopic pub /rrbot/joint1_position_controller/command std_msgs/Float64 "data: 0.5"

You should see the rrbot move its joint to a new position. The value here is in radian. Let’s try to control the robot with code instead of sending command.

Step 2. Create a package

We’ll create a ros package for our code first.

cd ~/catkin_ws/src
catkin_create_pkg rrbot_control rospy
cd rrbot_control
mkdir scripts

Then we create a script called main.py under the scripts folder with the following content.

#!/usr/bin/env python
# license removed for brevity
import rospy
from std_msgs.msg import Float64
import math

def talker():
    pub = rospy.Publisher('/rrbot/joint1_position_controller/command', Float64, queue_size=10)
    rospy.init_node('talker', anonymous=True)
    rate = rospy.Rate(10) # 10hz
    while not rospy.is_shutdown():
        hello_str = "hello world %s" % rospy.get_time()
        position = math.pi/2
        rospy.loginfo(position)
        pub.publish(position)
        rate.sleep()

if __name__ == '__main__':
    try:
        talker()
    except rospy.ROSInterruptException:
        pass

We can use rosrun rrbot_control main.pyto tun our script(remember to give it permission). You should see the robot move to the desired position. You can also try the code with different position function like sin, cos or even publish to more joints if you want.

Want to learn more?

If you are interested in learning ROS, please check our Robot Ignite Academy.

 

Edit by: Tony Huang

RELATED LINKS

Gazebo-ROS control tutorial
Official ROS Publisher / Subscriber tutorial
ROS Development Studio (ROSDS)
Robot Ignite Academy


We love feedback!

Did you like this video? Do you have questions about what is explained? Whatever the case, please leave a comment on the comments section below, so we can interact and learn from each other.

If you want to learn about other ROS topics, please let us know on the comments area and we will do a video about it.

[ROS Q&A] 148 – ROS CPP Time and Duration arithmetics build error

In this video we are going to explain about a problem trying to build a ROS C++ node using ros::Time and ros::Duration.

It is because the order of the terms in sum operation matters. You can check in the video it is simple to solve but it can be a trap if you do not pay attention to that during the development.

Step 1. Create a project in ROS Development Studio(ROSDS)

ROSDS helps you follow our tutorial in a fast pace without dealing without setting up an environment locally. If you haven’t had an account yet, you can create a free account here. Let’s call the project ros time error.

Step 2. Create a package

Let’s start by creating a ROS package for our code

cd ~/catkin_ws/src
catkin_create_pkg mypkg roscpp geometry_msgs 

Then we call the source file mypkg_node.cpp and put it under the mypkg/src folder with the content from the question.

// This program publishes randomly-generated velocity

// messages for turtlesim.
#include <ros/ros.h>
#include <geometry_msgs/Twist.h>  // For geometry_msgs::Twist
#include <stdlib.h> // For rand() and RAND_MAX

int main(int argc, char **argv) {



  ros::init(argc, argv, "publish_velocity");

  ros::NodeHandle nh; // handles node


  ros::Publisher pub = nh.advertise<geometry_msgs::Twist>(
    "turtle1/cmd_vel", 1000); //links publisher to the node


  while(ros::ok()) {

    geometry_msgs::Twist msg; //Object msgs

    msg.linear.x = 0.5; 
    msg.angular.z = 0;
    msg.linear.z = 0.5;

    // Time tracking
    ros::Time beginTime = ros::Time::now();
    ros::Duration MessageTime = ros::Duration(3);
    ros::Time endTime = MessageTime + beginTime; 

    while(ros::Time::now() < endTime){
        pub.publish(msg);


        ROS_INFO_STREAM("Sending velocity command:"
          << " linear=" << msg.linear.x
          << " angular=" << msg.angular.z
           <<"linearZ="<<msg.linear.z);


        ros::Duration(0.3).sleep();

    }


  }
}

To compile the code, we need to at first uncomment the add_executable and target_link_libraries in the CMakeLists.txt. After that, we can compile it with

cd ~/catkin_ws
catkin_make

However, some error related to ROS time occurs. After checking the documentation ROS C++ Time and Duration, we found out that the order is not quite right. The following part should be changed.

...
    ros::Time endTime = beginTime +  MessageTime; 
...

If we compile again, the problem is solved.

Want to learn more?

If you are interested in using ROS with C++, please check our ROS Basics in 5 days(C++) course for more information.

 

Edit by: Tony Huang

RELATED LINKS

The original question on ROS_Answers
ROS Development Studio (ROSDS)
Robot Ignite Academy
ROS C++ Time and Duration


We love feedback!

Did you like this video? Do you have questions about what is explained? Whatever the case, please leave a comment on the comments section below, so we can interact and learn from each other.

If you want to learn about other ROS topics, please let us know on the comments area and we will do a video about it.

[ROS Q&A] 147 – How to make a Python file executable?

 

One of the most frequent question that we get in our customer support channels is an error when trying to ‘rosrun’ a Python file. The package is there, the file is there, the command has been typed in correctly, but it doesn’t want to run. Sounds familiar?

This is usually due to the file’s permission, which had to be set to be executable. So in this video, we will see how to do this, as well as explore a bit more on this subject. Beginners of ROS and the Linux system should find this very useful.

RELATED LINKS

Original question
ROS Development Studio (ROSDS)
Robot Ignite Academy

Step1. Create a project in Robot Ignite Academy(RIA)

We have the best online ROS course available in RIA. It helps you learn ROS in the easiest way without setting up ROS environment locally. The only thing you need is a browser! Create an account here and start to browse the trial course for free now! We’ll use the ROS Basics in 5 Days course unit 2 as an example today.

Step2. How to make .py file executable

Here we create a package called test_exec using the following command

cd catkin_ws/src
catkin_create_pkg test_exec rospy

We create a file called simple_topic_publisher.py under the src folder and copy the code from the course.

Then we compile the package using

cd ~/catkin_ws
catkin_make

Now we try to run the .py file with rosrun test_exec simple_topic_publisher.py  , but got the same error as the question.

How to solve this problem? We can execute the following command to give the file execute permission

chmod +x simple_topic_publisher.py

You can also check if the file has the permission with

ls -l

Then we run the file again with the rosrun command, the file is able to execute now.

Want to learn more?

If you are interested in learning ROS, please check our Robot Ignite Academy.

 

 

Edit by: Tony Huang

 


Feedback

Did you like this video? Do you have questions about what is explained? Whatever the case, please leave a comment on the comments section below, so we can interact and learn from each other.

If you want to learn about other ROS topics, please let us know on the comments area and we will do a video about it.

[ROS Projects] Use OpenAI_ROS with  WAM-V Step-by-Step

[ROS Projects] Use OpenAI_ROS with WAM-V Step-by-Step

 

What you will learn?

In this video you will learn how to use openai_ros package to make learn the WAM-V sea robot of the RobotX Challenge to pass the first Navigation Control.  The only thing you need to code is the AI algorithm if you want to use a different one to the one provided Q-Learn.

You can run the ROSject containing all the ROS code and simulation of the robot and sea by clicking on the next button:

Run on ROSDS your ROS project

 

 

And here the different gits used:

And a course on OpenAI in RobotIgniteAcademy: OpenAI Gym for ROS Based Robots 101

Link to RobotX PDF instructions for the challenge:
[https://robotx.org/images/files/RobotX_2018_Task_Summary.pdf]
[https://www.robotx.org/]

Pin It on Pinterest