#include <srs_env_model_percp/bb_estimator/funcs.h>
#include <srs_env_model_percp/services_list.h>
#include <srs_env_model_percp/topics_list.h>
#include <srs_env_model_percp/parameters_list.h>
#include "srs_env_model_percp/EstimateBB.h"
#include "srs_env_model_percp/EstimateBBAlt.h"
#include "srs_env_model_percp/EstimateRect.h"
#include "srs_env_model_percp/EstimateRectAlt.h"
#include "srs_env_model_percp/Estimate2DHullMesh.h"
#include "srs_env_model_percp/Estimate2DHullPointCloud.h"
#include <algorithm>
#include <message_filters/subscriber.h>
#include <message_filters/synchronizer.h>
#include <message_filters/sync_policies/approximate_time.h>
#include <message_filters/cache.h>
#include <sensor_msgs/Image.h>
#include <sensor_msgs/CameraInfo.h>
#include <sensor_msgs/image_encodings.h>
#include <sensor_msgs/PointCloud2.h>
#include <arm_navigation_msgs/Shape.h>
#include <cv_bridge/cv_bridge.h>
#include <opencv2/imgproc/imgproc.hpp>
#include <pcl/io/pcd_io.h>
#include <pcl/point_types.h>
#include <pcl/surface/convex_hull.h>
#include <tf/transform_listener.h>
Go to the source code of this file.
Namespaces | |
namespace | srs_env_model_percp |
Functions | |
bool | srs_env_model_percp::estimate2DHullMesh_callback (srs_env_model_percp::Estimate2DHullMesh::Request &req, srs_env_model_percp::Estimate2DHullMesh::Response &res) |
bool | srs_env_model_percp::estimate2DHullPointCloud_callback (srs_env_model_percp::Estimate2DHullPointCloud::Request &req, srs_env_model_percp::Estimate2DHullPointCloud::Response &res) |
bool | srs_env_model_percp::estimateBB_callback (srs_env_model_percp::EstimateBB::Request &req, srs_env_model_percp::EstimateBB::Response &res) |
bool | srs_env_model_percp::estimateBBAlt_callback (srs_env_model_percp::EstimateBBAlt::Request &req, srs_env_model_percp::EstimateBBAlt::Response &res) |
bool | srs_env_model_percp::estimateRect_callback (srs_env_model_percp::EstimateRect::Request &req, srs_env_model_percp::EstimateRect::Response &res) |
bool | srs_env_model_percp::estimateRectAlt_callback (srs_env_model_percp::EstimateRectAlt::Request &req, srs_env_model_percp::EstimateRectAlt::Response &res) |
int | main (int argc, char **argv) |
void | srs_env_model_percp::sv1_callback (const sensor_msgs::ImageConstPtr &depth, const sensor_msgs::CameraInfoConstPtr &camInfo) |
void | srs_env_model_percp::sv2_callback (const sensor_msgs::PointCloud2ConstPtr &pointCloud, const sensor_msgs::CameraInfoConstPtr &camInfo) |
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 654 of file service_server.cpp.