#include <ros/ros.h>#include <tf/transform_listener.h>#include "sensor_msgs/PointCloud.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 "std_msgs/Header.h"#include "geometry_msgs/Vector3.h"#include "geometry_msgs/Quaternion.h"#include <iostream>#include <iomanip>#include <cmath>#include <sstream>#include <map>#include <stdexcept>#include <list>#include <boost/thread/mutex.hpp>#include "geometry_msgs/Point.h"#include "geometry_msgs/TransformStamped.h"#include "geometry_msgs/PoseStamped.h"#include "btMatrix3x3.h"#include "ros/console.h"#include "tf/exceptions.h"#include "LinearMath/btTransform.h"#include <boost/signals.hpp>#include "ros/callback_queue.h"#include "ros/service_traits.h"#include "boost/thread.hpp"#include <actionlib/client/simple_action_client.h>#include <collision_environment_msgs/MakeStaticCollisionMapAction.h>#include <household_objects_database_msgs/DatabaseModelPose.h>#include <geometric_shapes_msgs/Shape.h>#include <tabletop_object_detector/Table.h>#include <tabletop_object_detector/TabletopDetectionResult.h>#include <object_manipulation_msgs/GraspableObject.h>#include <object_manipulation_msgs/ClusterBoundingBox.h>

Go to the source code of this file.
Classes | |
| class | tabletop_collision_map_processing::CollisionMapProcessor |
Namespaces | |
| namespace | tabletop_collision_map_processing |
Functions | |
| int | main (int argc, char **argv) |
Variables | |
| static const std::string | tabletop_collision_map_processing::COLLISION_SERVICE_NAME = "tabletop_collision_map_processing" |
| int main | ( | int | argc, | |
| char ** | argv | |||
| ) |
Definition at line 187 of file tabletop_collision_map_processing_node.cpp.