#include <ros/ros.h>
#include <XmlRpc.h>
#include <geometry_msgs/Point.h>
#include <geometry_msgs/PolygonStamped.h>
#include <geometry_msgs/Vector3.h>
#include <tf/transform_listener.h>
#include <boost/tokenizer.hpp>
#include <boost/foreach.hpp>
#include <boost/algorithm/string.hpp>
#include <cob_footprint_observer/GetFootprint.h>
Go to the source code of this file.
Classes | |
class | FootprintObserver |
checks the footprint of care-o-bot and advertises a service to get the adjusted footprint More... |