control a system to do what we want
What's one example of a controller that we learned last week?
PID
What does PID stand for?
Proportional Integral Derivative
What is a proportional controller?
A controller where the control effort is proportional to the error
What is a integral controller?
A controller where the control effort is proportional to the integral of the error
Why do we need an integral controller?
A proportional controller cannot deal with steady state error.
What is a derivative controller?
A controller where the control effort is proportional to the derivative of the error
Why do we need a derivative controller?
To reduce overshoot from the controller
How is roslaunch
different from rosrun
?
roslaunchallows you to launch multiple nodes at once
roslaunchallows you to define parameters for nodes
How do you define a parameter?
nh.getParam(param_name, variable)
<param name="param_name" value="value" />
How would you visualize messages on a graph?
rqt_plot
Welcome to Week 4 of ROS training exercises!
rviz
tf
Inertial Measurement Unit
Find acceleration, angular velocity and heading
Coordinate frame are important when working with sensors
A coordinate frame refers to the coordinate system that is used
An example:
ROS has a REP 103 standard
This means that our state, the things we need to keep track of, consists 4 things
Why only x velocity? What about y velocity?
Because our robot is a differential drive, we can't move sideways, so y velocity is zero
Which coordinate frame is the x velocity in?
The robot's frame
How do we use the IMU measurements to update our state?
Reminder: IMU gives us x acceleration, angular velocity, heading
Hint: Physics
Use kinematics equations:
Launch the environment with roslaunch
:
roslaunch igvc_training_exercises week4.launch
You should see just a single turtle in the middle:
Let's look at what topics are published. How do I find that out?
rostopic list
/oswin/imu
of type sensor_msgs/Imu
./oswin/ground_truth
isn't thereLet's graph /oswin/imu
and see what we get
rqt_plot
and graph the accelerations in the x axisrosrun teleop_twist_keyboard teleop_twist_keyboard.py cmd_vel:=/oswin/velocity
Move around a bit and get a feel for what the accelerations from the IMU look like as you move around.
Its time to start writing some code. We'll be implementing this node in week4/main.cpp.
What's our plan for writing this node?
/oswin/imu
/oswin/odometry
ROS_INFO_STREAM
the x acceleration to make sure everything is working.
Kinematics
nav_msgs::Odometry
message type that describes the robot's current location.What is a Quaternion?
orientation
field uses something called quaternionsEuler Angles uses three numbers: roll, pitch and yaw
If you're familiar with airplanes then this should be familiar to you
In order to convert between euler angles and quaternions, the ROS
built-in tf
package provides a few useful methods that we can use.
Add the following #include
:
#include <tf/transform_datatypes.h>
We can then use the tf::createQuaternionMsgFromYaw
message to convert from yaw to a quaternion. This might look
something like:
odometry_msg.pose.pose.orientation = tf::createQuaternionMsgFromYaw(g_heading);
Header
message typeHeader
field on nav_msgs::Odometry
Let's look at the definition of the message from the ros documentation
stamp
refers to the timestamp of the message.frame_id
on the other hand refers to the name of the coordinate frame of the messageframe_id
to be clear about which coordinate frame we are talking aboutIf our world frame was called yeet
, and we wanted to say that the position of our robot was in relation
to the yeet
frame
nav_msgs::Odometry msg;
msg.header.frame_id = "yeet";
Of course, don't actually call your coordinate frame yeet
odom
frame, which is a world-fixed frame:nav_msgs::Odometry msg;
msg.header.frame_id = "odom";
rviz
nav_msgs::Odometry
message, we can use the rviz
Open up rviz by running the rviz
command:
rviz
You should see something similar to the screen below:
In order to visualize the nav_msgs::Odometry
message that we're publishing:
Global Options
section change the Fixed Frame
to "odom", the value of the frame_id
we set
earlier.Views
section, change the Type
to TopDownOrtho
to change the view from 3D to top down 2D.Add
button on the bottom left, select the By topic
tab, and click Odometry
under /oswin/odometry
.You should now see a red arrow in the middle of your screen visualizing the nav_msgs::Odometry
message that you're
publishing.
Try moving the robot again using teleop_twist_keyboard
tf
and tf::TransformBroadcasterWe're almost done
The last thing we need to do is to "broadcast" our transform (the position of our robot) to tf
What is tf
? We #include
'ed a header file from tf
earlier.
tf is a package that lets the user keep track of multiple coordinate frames over time. tf maintains the relationship between coordinate frames in a tree structure buffered in time, and lets the user transform points, vectors, etc between any two coordinate frames at any desired point in time.
tf
will allow us to easily express data from one coordinate frame in another coordinate frametf
needs to know where these coordinate frames are intf::TransformBroadcaster
Create a tf::TransformBroadcaster
:
tf::TransformBroadcaster transform_broadcaster;
tf::TransformStamped
to hold the transformtf::TransformStamped
variable in order to pass it to the tf::TransformBroadcaster
that we just
madeThankfully, Clion is here to save the day
tf::TransformStamped
, and then move your cursor over ittf::TransformStamped
StampedTransform(const tf::Transform& input, const ros::Time& timestamp, const std::string & frame_id,
const std::string & child_frame_id):
tf::Transform (input), stamp_ ( timestamp ), frame_id_ (frame_id),
child_frame_id_(child_frame_id)
{ };
We need to pass 4 things:
tf::Transform
inputros::Time
timestampstd::string
frame_idstd::string
child_frametf::Transform
represented the actual transform between the two coordinate frames
Two useful methods that we need:
.setOrigin(tf::Vector3 origin)
tf::Vector3
tf::Vector3
has a sane constructor - you pass in x, y and z coordinates
in the constructor:tf::Transform transform;
tf::Vector3 origin(1.0, 2.0, 3.0);
transform.setOrigin(origin);
.setRotation(tf::Quaternion quaternion)
tf::Quaternion
But theres one problem:
tf::createQuaternionFromYaw
instead of tf::createrQuaternionMsgFromYaw
tf::Transform transform;
transform.setRotation(tf::createQuaternionFromYaw(1.57));
Next, ros::Time
timestamp
Why does there need to be a timestamp?
Finally, the frame_id
and child_frame
arguments of type std::string
For example, trying to publish the transform of the robot frame in the world frame
frame_id
(the reference frame we're currently in) is odom
child_frame
(the reference frame we're trying to describe) is oswin
..sendTransform
function on the tf::TransformBroadcaster
Finally, we call the .sendTransform
function on the tf::TransformBroadcaster
we created earlier.
That's it....... except not really.
Most likely you've created tf::TransformBroadcaster
in one of two ways:
Both of these ways don't work
We can verify this by running rosrun tf tf_monitor
, a tool which prints out all the
coordinate frame transforms that tf
receives
If it were working, you would see something like:
Frame: oswin published by unknown_publisher Average Delay: 0.000244823 Max Delay: 0.000300968
But it's empty. What's the problem?
If you created it as a global variable
You must call ros::init() before creating the first NodeHandle
tf::TransformBroadcaster
creates its own ros::NodeHandle
ros::init()
If you created it in the callback, no error shows, but it still doesn't work.
tf::TransformBroadcaster
needs some time to send the transformros::Publisher
during the first weekWant to be able to create the tf::TransformBroadcaster
after we do ros::init
Only create it once and not everytime
How can we fix this problem?
We can do this with static local variables
Adding the static keyword to a local variable:
So, if we created tf::TransformBroadcaster
as a static variable inside the callback like so:
void imuCallback(sensor_msgs::Imu msg)
{
...
static tf::TransformBroadcaster transform_broadcaster;
}
ros::init
, the tf::TransformBroadcaster
variable will be initializedYou should see that rosrun tf tf_monitor
is able to show that the oswin
frame is getting published to by your node
tf
frames in rviztf
frame we published to in rviz
rviz
, and then add a display of type tf
.tf::TransformBroadcaster
is working properly by moving the turtle aroundAnd that's it for this week!
nav_msgs::Odometry
message type for odometry informationrviz
to visualize what's happening