Inertial Measurement Unit Measures acceleration, angular velocity, and heading
Defines a set of directions relative to some object
Finding where you are
Dead Reckoning
Integrate accelerations and velocities to obtain position with kinematics
rviz
Notice that we are able to "see" the surrounding obstacles from the "shape" of the lidar scan. We can use this to construct a map of our surroundings.
week5.launch
:roslaunch week5.launch
The simulation should pop up with a lidar visualization like the above image
Open up rviz:
rviz
Change the fixed frame in the top left corner of the left menu to oswin
Set the target frame in the right menu to oswin
as well.
Add the "PointCloud2" visualization so you can visualize the lidar data
/oswin/pointcloud
.In a third window, open up teleop_twist_keyboard
as you have done many times already:
rosrun teleop_twist_keyboard teleop_twist_keyboard.py cmd_vel:=/oswin/velocity
Example:
How many total grid cells?
(5m * 10 cells/m) * (10m * 10 cells/m) = 5000
Ex:
What grid coordinates would this translate to?
(2m * 10 cells/m, 7 * 10 cells/m) = (20, 70) on the grid
Suppose there's another obstacle (also a single point) located at coordinates (2.01m, 7.01m). What grid coordinates would that translate to?
(2.01m * 10 cells/m, 7.01 * 10 cells/m) = (20, 70) on the grid
Before we start implementing a grid map, we need to look at coordinate frames again.
We need to transform these coordinates from the sensor's coordinate frame to the "odom" frame
Mapping: repeat this procedure for every point in the lidar scan every time we get a lidar scan.
tf::TransformListener
Need to use something called a tf::TransformListener
"listens" for coordinate transforms between different reference frames
listen for transforms broadcasted by tf::TransformBroadcaster
in other nodes
We don't need to worry about the tf::TransformBroadcaster
part as the simulation already takes care of that for us
To use a tf::TransformListener
, first create one like so:
tf::TransformListener listener;
Then, to use it to lookup transforms, say from the frame "oswin" to the frame "odom", do the following:
tf::StampedTransform transform;
try {
listener.lookupTransform("odom", "oswin", msg.header.stamp, transform);
} catch (tf::TransformException &ex) {
ROS_ERROR_STREAM(ex.what());
}
lookupTransform (const std::string &target_frame,
const std::string &source_frame,
const ros::Time &time,
StampedTransform &transform) const
msg.header.stamp
to specify that we want the transform at that momentros::Time(0)
to signify we want the latest transform.try { ... } catch () { ... }
statement herelistener.lookupTransform()
might throw an exception if some error occurstry { ... } catch() { .. }
here, then the program will crash when an exception is thrownCommon snippet:
tf::StampedTransform transform;
ros::Time stamp = msg.header.stamp;
if (!listener.canTransform("odom", "oswin", msg.header.stamp)
{
stamp = ros::Time(0);
}
try {
listener.lookupTransform("odom", "oswin", msg.header.stamp, transform);
} catch (tf::TransformException &ex) {
ROS_ERROR_STREAM(ex.what());
}
tf::Transform
tf::Transform
.pcl::PointCloud<pcl::PointXYZ>
pcl::PointCloud
is a template as it uses angle bracketspcl::PointXYZ
.To transform a pointcloud, we can make use of a function from pcl_ros
:
pcl::PointCloud<pcl::PointXYZ> transformed_cloud;
pcl_ros::transformPointCloud(input_cloud, transformed_cloud, transform);
input_cloud
is the pointcloud you want to transformtf::Transform
representing the transformationnav_msgs::OccupancyGrid
.Some important points:
The info
member contains information about the map: width, height etc.
The data
member (of type std::vector<int8_t>
needs to be initialized
main
before you call ros::spin()
make
sure that the data
member is initialized to have as many elements as there are grid cells, ie.map.data = std::vector<int8_t>(total_cells, 0);
The map is 2D, but the data
member is only 1D. This means that you'll need to convert from 2D coordinates to an
index.
This works by imagining an index that increments left to right, top to bottom. For example, for a 3x3 grid:
0 1 2
3 4 5
6 7 8
You know everything you need to implement a simple mapper for lidar points in ROS
Write your node in src/week5/main.cpp.
For this mapper, we'll increment the occupied grid cell by 1 every time
/oswin/pointcloud
and write a callback function taking in pcl::PointCloud<pcl::PointXYZ>
tf::TransformListener
and call lookupTransform
from oswin
to odom
inside the callbackoswin
frame to the odom
frame using pcl_ros::transformPointCloud
nav_msgs::OccupancyGrid
and publish the mapnav_msgs::OccupancyGrid
visualizationGood luck!
pcl_ros::transformPointCloud
function to transform pointclouds to a different coordinate frameNext week, we'll look at performing navigation on the map that we've created this week
See you next week!