ros::init(argc, argv, "NODE_NAME")
4 steps:
ros::NodeHandle
ros:NodeHandle nh;
ros::Publisher
ros::Publisher publisher = nh.advertise<MESSAGE_TYPE>(TOPIC, QUEUE_SIZE)
std_msgs::Int32 msg;
publish.publish(message)
4 steps:
ros::NodeHandle
ros:NodeHandle nh;
ros::Subscriber
ros::Subscriber subscriber = nh.subscribe(TOPIC, QUEUE_SIZE, CALLBACK)
void callbackFunction(std_msgs::Int32 msg) {
// Stuff
}
ros::spin()
ros::spin()after creating the subscriber
Welcome to Week 3 of ROS training exercises!
Need to understand control theory to learn about PID
How do you do that?
Intuition:
control is proportional to the error
buzzsim
simulatorroslaunch
This time we'll use roslaunch
to launch the simulator
roslaunch igvc_training_exercises week3.launch
Syntax quite similar to rosrun
roslaunch PACKAGE_NAME LAUNCH_FILE
Instead of buzzsim
, there's a week3.launch
.launch
files<launch>
<node pkg="igvc_buzzsim" type="buzzsim" name="buzzsim">
<param name="config_path" value="$(find igvc_training_exercises)/config/week3/world.yml" />
<param name="world_name" value="stationary" />
<!-- <param name="world_name" value="moving" />-->
<!-- <param name="world_name" value="circle" />-->
</node>
<node pkg="igvc_training_exercises" type="week3" name="week3" output="screen">
</node>
</launch>
<node>
tagsbuzzsim
from igvc_buzzsim
packageweek3
from igvc_training_exercises
package<param>
tags<!-- -->
<param>
tags later.launch
file do?Lets you define nodes to launch and their respective parameters.
buzzsim
environment for the exerciseGoal: Move the bottom turtle to the top turtle using PID
How do I find out which topics are relevant?
rostopic list
to find the list of topicsrostopic info
to find the type of a topic/oswin/velocity
/oswin/ground_truth
/kyle/ground_truth
How?
/oswin/ground_truth, calculate the error
Kpto calculate the velocity
Create a subscriber for /oswin/ground_truth
and /kyle/ground_truth
to find where the turtles are
#include
the message type!Save the position for /kyle/ground_truth
in global variable g_kyle_pose
How do I check to make sure the subscribers are working?
ROS_INFO_STREAMto print out the coordiantes
/oswin/velocity
topic to control the bottom turtle/oswin/velocity
g_velocity_pub
Calculate the error in x-coordinate between the two turtles
/oswin/ground_truth
kp
to store the
With kp = 1
, after you compile and roslaunch
you should then see the bottom turtle move up and stop exactly where
top turtle is.
What happens with different values of kp
?
.launch
fileros::NodeHandle
has a .param(PARAM_NAME, VARIABLE)
method you can callTo make kp
a parameter:
double g_kp;
...
int main(int argc, char** argv)
{
ros::init(argc, argv, "week3");
ros::NodeHandle private_nh{"~"};
pnh.getParam("kp", g_kp);
ROS_INFO_STREAM("kp: " << g_kp);
}
"~"
as a parameter to the ros::NodeHandle
constructorros::NodeHandle
refer to the node's private namespace<node>
tags in a .launch
file.Also need to set the parameters in the .launch
file
<param>
tag between the <node>
tag that launches the week3
node:<node pkg="igvc_training_exercises" type="week3" name="week3" output="screen">
<param name="kp" value="1.0" />
</node>
kp
parameter is printedweek3.launch
without recompilingrqt_plot
std_msgs::Float64
with the topic "error"/oswin/ground_truth
How can you verify that it is publishing correctly?
rostopic echo /error
rqt_plot
for plotting graphs and visualizing datarqt_plot
/error
topic to the graph/error
at the topLaunch the simulation and the controller. You should see a graph like below:
kp
againThis is an integral controller, where the control is proportional to the integral of the error
or calculating recursively
<param name="world_name" value="stationary" />
line<param name="world_name" value="moving" />
It should look like this:
<launch>
<node pkg="igvc_buzzsim" type="buzzsim" name="buzzsim">
<param name="config_path" value="$(find igvc_training_exercises)/config/week3/world.yml" />
<!-- <param name="world_name" value="stationary" />-->
<param name="world_name" value="moving" />
<!-- <param name="world_name" value="circle" />-->
</node>
<node pkg="igvc_training_exercises" type="week3" name="week3" output="screen">
<param name="kp" value="1.0" />
</node>
</launch>
roslaunch
again, you should see the top turtle start to moverqt_plot
.The error that you're seeing is called steady state error. As we explained earlier, the integral controller helps to solve this.
The proof is trivial and left as an exercise for the reader
You thought I was going to do all the hard work for you guys? Well too bad, we're moving on to Derivative.
Another example:
This is a derivative controller, where the control is proportional to the derivative of the error.
For the discrete time version, calculate the derivative with finite differences:
roslaunch
and .launch
filesroslaunch <ros package> <launch file>
to launch a .roslaunch
file<node>
tags to define ROS nodes to be launched in a .roslaunch
filenh.getParam
to get parameters defined in a launch file<launch>
tagWe'll learn about reference frames, the IMU, and localization with dead reckoning by integrating IMU data.
See you next week!