#include <ros/ros.h>
#include <interactive_markers/interactive_marker_server.h>
#include <visualization_msgs/InteractiveMarker.h>
#include <actionlib/client/simple_action_client.h>
#include <move_base_msgs/MoveBaseGoal.h>
#include <move_base_msgs/MoveBaseAction.h>
#include <geometry_msgs/PoseStamped.h>
#include <geometry_msgs/Pose.h>
#include <urdf/model.h>
Go to the source code of this file.
Classes | |
class | CreateParkingSpots |
Typedefs | |
typedef actionlib::SimpleActionClient < move_base_msgs::MoveBaseAction > | MoveBaseClient |
Creates clickable parking spots for web interface/rviz. |
typedef actionlib::SimpleActionClient<move_base_msgs::MoveBaseAction> MoveBaseClient |
Creates clickable parking spots for web interface/rviz.
.h create_parking_spots runs a ROS interactive marker server. It creates clickable markers that send move_base goals to carl. The positions of the markers are defined in the rail_collada_models package, and the ilab_description must be loaded on the parameter server for parking spots to be generated.
Definition at line 27 of file create_parking_spots.h.