#include <interactive_markers/interactive_marker_server.h>
#include <geometry_msgs/Pose.h>
#include <ros/ros.h>
#include <boost/optional.hpp>
#include <boost/thread.hpp>
#include <boost/lexical_cast.hpp>
#include <tf/transform_broadcaster.h>
Go to the source code of this file.
Classes | |
class | flirtlib_ros::MarkerNode |
Namespaces | |
namespace | flirtlib_ros |
Functions | |
ros::Duration | flirtlib_ros::duration (const double r) |
template<typename T > | |
T | flirtlib_ros::getParam (const string &name, const T &default_val) |
int | main (int argc, char **argv) |
tf::StampedTransform | flirtlib_ros::toTf (const gm::Pose &p, const string &frame) |
Node that creates two interactive markers that can be moved around in a 2d map. Publishes two tf frames: pose1 and pose2, relative to /map.
Definition in file interactive_markers.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 201 of file interactive_markers.cpp.