#include "tabletop_collision_map_processing/collision_map_interface.h"
#include <tf/transform_datatypes.h>
#include <std_srvs/Empty.h>
#include <string>
#include <vector>
#include <ostream>
#include "ros/serialization.h"
#include "ros/builtin_message_traits.h"
#include "ros/message_operations.h"
#include "ros/message.h"
#include "ros/time.h"
#include "ros/service_traits.h"
#include "std_msgs/Header.h"
#include "geometric_shapes_msgs/Shape.h"
#include "geometry_msgs/Pose.h"
#include "mapping_msgs/CollisionObject.h"
#include "sensor_msgs/PointCloud.h"
#include "geometry_msgs/PoseStamped.h"
#include "geometry_msgs/Vector3.h"
#include <household_objects_database_msgs/DatabaseModelPose.h>
Go to the source code of this file.
Namespaces | |
namespace | tabletop_collision_map_processing |
Variables | |
static const std::string | tabletop_collision_map_processing::CLUSTER_BOUNDING_BOX_NAME = "find_cluster_bounding_box" |
static const std::string | tabletop_collision_map_processing::MAKE_STATIC_COLLISION_MAP_ACTION_NAME = "make_static_collision_map" |
static const std::string | tabletop_collision_map_processing::RESET_COLLISION_MAP_NAME = "collision_map_self_occ_node/reset" |