Private Types | Private Member Functions | Private Attributes | List of all members
xiaoqiang_depth_image_proc::OccupancyXyzNodelet Class Reference
Inheritance diagram for xiaoqiang_depth_image_proc::OccupancyXyzNodelet:
Inheritance graph
[legend]

Private Types

typedef sensor_msgs::PointCloud2 PointCloud
 

Private Member Functions

void connectCb ()
 
void convert2 (const sensor_msgs::ImageConstPtr &depth_msg, PointCloud::Ptr &cloud_msg, const image_geometry::PinholeCameraModel &model, double range_max=0.0)
 
void depthCb (const sensor_msgs::ImageConstPtr &depth_msg, const sensor_msgs::CameraInfoConstPtr &info_msg)
 
virtual void onInit ()
 

Private Attributes

int ANN_dim_
 
double ANN_eps_
 
int ANN_k_
 
int ANN_num_
 
bool ANN_ready_
 
double bar_threshold_
 
double barHeight_max_
 
double barHeight_min_
 
boost::mutex connect_mutex_
 
int8_t * filter_mapGrid_
 
std::string frame_id_
 
ANNpointArray gridCenters_
 
double gridHeight_
 
double height_temp_
 
boost::shared_ptr< image_transport::ImageTransportit_
 
ANNkd_treekdTree_
 
double kinectHeight_
 
std::vector< double > lowerLeftPos_
 
int8_t * mapGrid_
 
image_geometry::PinholeCameraModel model_
 
std::vector< int > mustseenGrid_indexs_
 
unsigned int num_frame_
 
nav_msgs::OccupancyGrid occupancygrid_msg_
 
int point_mode_
 
ros::Publisher pub_barpoint_cloud_
 
ros::Publisher pub_clearpoint_cloud_
 
ros::Publisher pub_occupancy_grid_
 
ros::Publisher pub_point_cloud_
 
int queue_size_
 
std::vector< double > R_
 
double resolution_
 
std::vector< int > seenGrid_indexs_
 
double single_score_
 
image_transport::CameraSubscriber sub_depth_
 
std::vector< double > T_
 
int8_t * unkown_mapGrid_
 
double usingHeight_down_
 
double usingHeight_up_
 
double usingWidth_
 
double width_temp_
 

Additional Inherited Members

- Public Member Functions inherited from nodelet::Nodelet
void init (const std::string &name, const M_string &remapping_args, const V_string &my_argv, ros::CallbackQueueInterface *st_queue=NULL, ros::CallbackQueueInterface *mt_queue=NULL)
 
 Nodelet ()
 
virtual ~Nodelet ()
 
- Protected Member Functions inherited from nodelet::Nodelet
ros::CallbackQueueInterfacegetMTCallbackQueue () const
 
ros::NodeHandlegetMTNodeHandle () const
 
ros::NodeHandlegetMTPrivateNodeHandle () const
 
const V_stringgetMyArgv () const
 
const std::string & getName () const
 
ros::NodeHandlegetNodeHandle () const
 
ros::NodeHandlegetPrivateNodeHandle () const
 
const M_stringgetRemappingArgs () const
 
ros::CallbackQueueInterfacegetSTCallbackQueue () const
 
std::string getSuffixedName (const std::string &suffix) const
 

Detailed Description

Definition at line 89 of file occupancy_xyz.cpp.

Member Typedef Documentation

typedef sensor_msgs::PointCloud2 xiaoqiang_depth_image_proc::OccupancyXyzNodelet::PointCloud
private

Definition at line 98 of file occupancy_xyz.cpp.

Member Function Documentation

void xiaoqiang_depth_image_proc::OccupancyXyzNodelet::connectCb ( )
private

Definition at line 510 of file occupancy_xyz.cpp.

void xiaoqiang_depth_image_proc::OccupancyXyzNodelet::convert2 ( const sensor_msgs::ImageConstPtr &  depth_msg,
PointCloud::Ptr &  cloud_msg,
const image_geometry::PinholeCameraModel model,
double  range_max = 0.0 
)
private

Definition at line 148 of file occupancy_xyz.cpp.

void xiaoqiang_depth_image_proc::OccupancyXyzNodelet::depthCb ( const sensor_msgs::ImageConstPtr &  depth_msg,
const sensor_msgs::CameraInfoConstPtr &  info_msg 
)
private

Definition at line 524 of file occupancy_xyz.cpp.

void xiaoqiang_depth_image_proc::OccupancyXyzNodelet::onInit ( )
privatevirtual

Implements nodelet::Nodelet.

Definition at line 381 of file occupancy_xyz.cpp.

Member Data Documentation

int xiaoqiang_depth_image_proc::OccupancyXyzNodelet::ANN_dim_
private

Definition at line 127 of file occupancy_xyz.cpp.

double xiaoqiang_depth_image_proc::OccupancyXyzNodelet::ANN_eps_
private

Definition at line 128 of file occupancy_xyz.cpp.

int xiaoqiang_depth_image_proc::OccupancyXyzNodelet::ANN_k_
private

Definition at line 126 of file occupancy_xyz.cpp.

int xiaoqiang_depth_image_proc::OccupancyXyzNodelet::ANN_num_
private

Definition at line 125 of file occupancy_xyz.cpp.

bool xiaoqiang_depth_image_proc::OccupancyXyzNodelet::ANN_ready_
private

Definition at line 129 of file occupancy_xyz.cpp.

double xiaoqiang_depth_image_proc::OccupancyXyzNodelet::bar_threshold_
private

Definition at line 145 of file occupancy_xyz.cpp.

double xiaoqiang_depth_image_proc::OccupancyXyzNodelet::barHeight_max_
private

Definition at line 133 of file occupancy_xyz.cpp.

double xiaoqiang_depth_image_proc::OccupancyXyzNodelet::barHeight_min_
private

Definition at line 134 of file occupancy_xyz.cpp.

boost::mutex xiaoqiang_depth_image_proc::OccupancyXyzNodelet::connect_mutex_
private

Definition at line 97 of file occupancy_xyz.cpp.

int8_t* xiaoqiang_depth_image_proc::OccupancyXyzNodelet::filter_mapGrid_
private

Definition at line 120 of file occupancy_xyz.cpp.

std::string xiaoqiang_depth_image_proc::OccupancyXyzNodelet::frame_id_
private

Definition at line 140 of file occupancy_xyz.cpp.

ANNpointArray xiaoqiang_depth_image_proc::OccupancyXyzNodelet::gridCenters_
private

Definition at line 123 of file occupancy_xyz.cpp.

double xiaoqiang_depth_image_proc::OccupancyXyzNodelet::gridHeight_
private

Definition at line 114 of file occupancy_xyz.cpp.

double xiaoqiang_depth_image_proc::OccupancyXyzNodelet::height_temp_
private

Definition at line 142 of file occupancy_xyz.cpp.

boost::shared_ptr<image_transport::ImageTransport> xiaoqiang_depth_image_proc::OccupancyXyzNodelet::it_
private

Definition at line 92 of file occupancy_xyz.cpp.

ANNkd_tree* xiaoqiang_depth_image_proc::OccupancyXyzNodelet::kdTree_
private

Definition at line 124 of file occupancy_xyz.cpp.

double xiaoqiang_depth_image_proc::OccupancyXyzNodelet::kinectHeight_
private

Definition at line 132 of file occupancy_xyz.cpp.

std::vector<double> xiaoqiang_depth_image_proc::OccupancyXyzNodelet::lowerLeftPos_
private

Definition at line 113 of file occupancy_xyz.cpp.

int8_t* xiaoqiang_depth_image_proc::OccupancyXyzNodelet::mapGrid_
private

Definition at line 118 of file occupancy_xyz.cpp.

image_geometry::PinholeCameraModel xiaoqiang_depth_image_proc::OccupancyXyzNodelet::model_
private

Definition at line 101 of file occupancy_xyz.cpp.

std::vector<int> xiaoqiang_depth_image_proc::OccupancyXyzNodelet::mustseenGrid_indexs_
private

Definition at line 122 of file occupancy_xyz.cpp.

unsigned int xiaoqiang_depth_image_proc::OccupancyXyzNodelet::num_frame_
private

Definition at line 144 of file occupancy_xyz.cpp.

nav_msgs::OccupancyGrid xiaoqiang_depth_image_proc::OccupancyXyzNodelet::occupancygrid_msg_
private

Definition at line 141 of file occupancy_xyz.cpp.

int xiaoqiang_depth_image_proc::OccupancyXyzNodelet::point_mode_
private

Definition at line 139 of file occupancy_xyz.cpp.

ros::Publisher xiaoqiang_depth_image_proc::OccupancyXyzNodelet::pub_barpoint_cloud_
private

Definition at line 136 of file occupancy_xyz.cpp.

ros::Publisher xiaoqiang_depth_image_proc::OccupancyXyzNodelet::pub_clearpoint_cloud_
private

Definition at line 137 of file occupancy_xyz.cpp.

ros::Publisher xiaoqiang_depth_image_proc::OccupancyXyzNodelet::pub_occupancy_grid_
private

Definition at line 135 of file occupancy_xyz.cpp.

ros::Publisher xiaoqiang_depth_image_proc::OccupancyXyzNodelet::pub_point_cloud_
private

Definition at line 138 of file occupancy_xyz.cpp.

int xiaoqiang_depth_image_proc::OccupancyXyzNodelet::queue_size_
private

Definition at line 94 of file occupancy_xyz.cpp.

std::vector<double> xiaoqiang_depth_image_proc::OccupancyXyzNodelet::R_
private

Definition at line 130 of file occupancy_xyz.cpp.

double xiaoqiang_depth_image_proc::OccupancyXyzNodelet::resolution_
private

Definition at line 112 of file occupancy_xyz.cpp.

std::vector<int> xiaoqiang_depth_image_proc::OccupancyXyzNodelet::seenGrid_indexs_
private

Definition at line 121 of file occupancy_xyz.cpp.

double xiaoqiang_depth_image_proc::OccupancyXyzNodelet::single_score_
private

Definition at line 146 of file occupancy_xyz.cpp.

image_transport::CameraSubscriber xiaoqiang_depth_image_proc::OccupancyXyzNodelet::sub_depth_
private

Definition at line 93 of file occupancy_xyz.cpp.

std::vector<double> xiaoqiang_depth_image_proc::OccupancyXyzNodelet::T_
private

Definition at line 131 of file occupancy_xyz.cpp.

int8_t* xiaoqiang_depth_image_proc::OccupancyXyzNodelet::unkown_mapGrid_
private

Definition at line 119 of file occupancy_xyz.cpp.

double xiaoqiang_depth_image_proc::OccupancyXyzNodelet::usingHeight_down_
private

Definition at line 116 of file occupancy_xyz.cpp.

double xiaoqiang_depth_image_proc::OccupancyXyzNodelet::usingHeight_up_
private

Definition at line 117 of file occupancy_xyz.cpp.

double xiaoqiang_depth_image_proc::OccupancyXyzNodelet::usingWidth_
private

Definition at line 115 of file occupancy_xyz.cpp.

double xiaoqiang_depth_image_proc::OccupancyXyzNodelet::width_temp_
private

Definition at line 143 of file occupancy_xyz.cpp.


The documentation for this class was generated from the following file:


xiaoqiang_depth_image_proc
Author(s): Xie fusheng
autogenerated on Mon Jun 10 2019 15:53:04