Public Types | Public Member Functions | Protected Member Functions | Protected Attributes | List of all members
cNearfieldMapBasePaNode< NEARFIELDMAP > Class Template Reference

#include <nearfield_map_base_pa_node.h>

Inheritance diagram for cNearfieldMapBasePaNode< NEARFIELDMAP >:
Inheritance graph
[legend]

Public Types

typedef NEARFIELDMAP MapTypeBase
 
typedef cNearfieldMapBasePaNode< NEARFIELDMAP > MapTypeFull
 

Public Member Functions

void changeSettings (void)
 
bool checkTF (const std_msgs::Header &header, tf::StampedTransform &transform)
 
 cNearfieldMapBasePaNode ()
 default constructor More...
 
bool getNearfield (sensor_msgs::PointCloud2Ptr &msg)
 function for retrieving requested nearfield map as pointcloud More...
 
void publish (void)
 function for publishing all topics (nearfield map and debugging) More...
 
 ~cNearfieldMapBasePaNode ()
 default destructor More...
 

Protected Member Functions

bool changeSettingsCallbackSrv (nearfield_map::NearfieldMapChangeSettings::Request &req, nearfield_map::NearfieldMapChangeSettings::Response &res)
 
bool clearCallbackSrv (std_srvs::Empty::Request &req, std_srvs::Empty::Response &res)
 
void clearCallbackSub (const std_msgs::EmptyConstPtr &msg)
 
bool getSizeCallbackSrv (nearfield_map::NearfieldMapGetSize::Request &req, nearfield_map::NearfieldMapGetSize::Response &res)
 
bool loadCallbackSrv (nearfield_map::NearfieldMapFileName::Request &req, nearfield_map::NearfieldMapFileName::Response &res)
 
bool requestCallbackSrv (nearfield_map::NearfieldMapRequest::Request &req, nearfield_map::NearfieldMapRequest::Response &res)
 
bool saveCallbackSrv (nearfield_map::NearfieldMapFileName::Request &req, nearfield_map::NearfieldMapFileName::Response &res)
 
bool sendCallbackSrv (std_srvs::Empty::Request &req, std_srvs::Empty::Response &res)
 

Protected Attributes

int count_camera_
 number of inserted depth images from camera (pointclouds) More...
 
int count_laser_full_
 number of inserted full laserscans (pointclouds) More...
 
int count_laser_scan_
 number of inserted single laserscans More...
 
ros::NodeHandle nh_
 node handler for topic subscription and advertising More...
 
cNearfieldMapPaNodeParameter nodeparams_
 parameters More...
 
cPcdFilterPaRos output_filter_
 
cPcdFilterPaRosThrottle output_throttle_
 
cAddCloudParameter params_addcloud_camera_
 parameter for insertion of depth images from camera More...
 
cAddCloudParameter params_addcloud_laser_full_
 parameter for insertion of full laserscans More...
 
cAddCloudParameter params_addcloud_laser_scan_
 parameter for insertion of single laserscans More...
 
ros::Publisher pub_cloud_free_
 puplisher for free voxels as pointcloud More...
 
ros::Publisher pub_cloud_occupied_
 puplisher for occupied voxels as pointcloud More...
 
ros::Publisher pub_nearfield_
 puplisher for requested nearfield map (pointcloud) More...
 
ros::Publisher pub_octomap_
 puplisher for the octomap (binary data) More...
 
ros::Publisher pub_octomap_full_
 puplisher for the octomap (full data) More...
 
ros::ServiceServer srv_change_settings_
 service for changing parameters of the nearfield map More...
 
ros::ServiceServer srv_clear_
 service for clearing the octomap More...
 
ros::ServiceServer srv_getsize_
 service for receiving the size of the octomap More...
 
ros::ServiceServer srv_load_
 service for loading a octomap More...
 
ros::ServiceServer srv_request_
 service for requesting a nearfield map (pointcloud) via this service More...
 
ros::ServiceServer srv_save_
 service for saving the octomap More...
 
ros::ServiceServer srv_send_
 service for requesting a nearfield map (pointcloud) via output topic More...
 
ros::Subscriber sub_camera_
 subscriber for depth images from camera More...
 
ros::Subscriber sub_clear_
 subscriber for clearing the octomap More...
 
ros::Subscriber sub_laser_full_
 subscriber for single laserscans More...
 
ros::Subscriber sub_laser_scan_
 subscriber for a laserscan More...
 
tf::TransformListener tf_listener_
 transformation of different frames More...
 

Detailed Description

template<typename NEARFIELDMAP>
class cNearfieldMapBasePaNode< NEARFIELDMAP >

Definition at line 86 of file nearfield_map_base_pa_node.h.

Member Typedef Documentation

◆ MapTypeBase

template<typename NEARFIELDMAP >
typedef NEARFIELDMAP cNearfieldMapBasePaNode< NEARFIELDMAP >::MapTypeBase

Definition at line 135 of file nearfield_map_base_pa_node.h.

◆ MapTypeFull

template<typename NEARFIELDMAP >
typedef cNearfieldMapBasePaNode<NEARFIELDMAP> cNearfieldMapBasePaNode< NEARFIELDMAP >::MapTypeFull

Definition at line 136 of file nearfield_map_base_pa_node.h.

Constructor & Destructor Documentation

◆ cNearfieldMapBasePaNode()

template<typename NEARFIELDMAP >
cNearfieldMapBasePaNode< NEARFIELDMAP >::cNearfieldMapBasePaNode ( )

default constructor

◆ ~cNearfieldMapBasePaNode()

template<typename NEARFIELDMAP >
cNearfieldMapBasePaNode< NEARFIELDMAP >::~cNearfieldMapBasePaNode ( )

default destructor

Member Function Documentation

◆ changeSettings()

template<typename NEARFIELDMAP >
void cNearfieldMapBasePaNode< NEARFIELDMAP >::changeSettings ( void  )

◆ changeSettingsCallbackSrv()

template<typename NEARFIELDMAP >
bool cNearfieldMapBasePaNode< NEARFIELDMAP >::changeSettingsCallbackSrv ( nearfield_map::NearfieldMapChangeSettings::Request &  req,
nearfield_map::NearfieldMapChangeSettings::Response &  res 
)
protected

◆ checkTF()

template<typename NEARFIELDMAP >
bool cNearfieldMapBasePaNode< NEARFIELDMAP >::checkTF ( const std_msgs::Header header,
tf::StampedTransform transform 
)

checking if transform from header to octomap frame (output_frame_) is possible and returns fransform

◆ clearCallbackSrv()

template<typename NEARFIELDMAP >
bool cNearfieldMapBasePaNode< NEARFIELDMAP >::clearCallbackSrv ( std_srvs::Empty::Request &  req,
std_srvs::Empty::Response &  res 
)
protected

◆ clearCallbackSub()

template<typename NEARFIELDMAP >
void cNearfieldMapBasePaNode< NEARFIELDMAP >::clearCallbackSub ( const std_msgs::EmptyConstPtr &  msg)
protected

◆ getNearfield()

template<typename NEARFIELDMAP >
bool cNearfieldMapBasePaNode< NEARFIELDMAP >::getNearfield ( sensor_msgs::PointCloud2Ptr &  msg)

function for retrieving requested nearfield map as pointcloud

◆ getSizeCallbackSrv()

template<typename NEARFIELDMAP >
bool cNearfieldMapBasePaNode< NEARFIELDMAP >::getSizeCallbackSrv ( nearfield_map::NearfieldMapGetSize::Request &  req,
nearfield_map::NearfieldMapGetSize::Response &  res 
)
protected

◆ loadCallbackSrv()

template<typename NEARFIELDMAP >
bool cNearfieldMapBasePaNode< NEARFIELDMAP >::loadCallbackSrv ( nearfield_map::NearfieldMapFileName::Request &  req,
nearfield_map::NearfieldMapFileName::Response &  res 
)
protected

◆ publish()

template<typename NEARFIELDMAP >
void cNearfieldMapBasePaNode< NEARFIELDMAP >::publish ( void  )

function for publishing all topics (nearfield map and debugging)

◆ requestCallbackSrv()

template<typename NEARFIELDMAP >
bool cNearfieldMapBasePaNode< NEARFIELDMAP >::requestCallbackSrv ( nearfield_map::NearfieldMapRequest::Request &  req,
nearfield_map::NearfieldMapRequest::Response &  res 
)
protected

◆ saveCallbackSrv()

template<typename NEARFIELDMAP >
bool cNearfieldMapBasePaNode< NEARFIELDMAP >::saveCallbackSrv ( nearfield_map::NearfieldMapFileName::Request &  req,
nearfield_map::NearfieldMapFileName::Response &  res 
)
protected

◆ sendCallbackSrv()

template<typename NEARFIELDMAP >
bool cNearfieldMapBasePaNode< NEARFIELDMAP >::sendCallbackSrv ( std_srvs::Empty::Request &  req,
std_srvs::Empty::Response &  res 
)
protected

Member Data Documentation

◆ count_camera_

template<typename NEARFIELDMAP >
int cNearfieldMapBasePaNode< NEARFIELDMAP >::count_camera_
protected

number of inserted depth images from camera (pointclouds)

Definition at line 171 of file nearfield_map_base_pa_node.h.

◆ count_laser_full_

template<typename NEARFIELDMAP >
int cNearfieldMapBasePaNode< NEARFIELDMAP >::count_laser_full_
protected

number of inserted full laserscans (pointclouds)

Definition at line 175 of file nearfield_map_base_pa_node.h.

◆ count_laser_scan_

template<typename NEARFIELDMAP >
int cNearfieldMapBasePaNode< NEARFIELDMAP >::count_laser_scan_
protected

number of inserted single laserscans

Definition at line 173 of file nearfield_map_base_pa_node.h.

◆ nh_

template<typename NEARFIELDMAP >
ros::NodeHandle cNearfieldMapBasePaNode< NEARFIELDMAP >::nh_
protected

node handler for topic subscription and advertising

Definition at line 178 of file nearfield_map_base_pa_node.h.

◆ nodeparams_

template<typename NEARFIELDMAP >
cNearfieldMapPaNodeParameter cNearfieldMapBasePaNode< NEARFIELDMAP >::nodeparams_
protected

parameters

Definition at line 160 of file nearfield_map_base_pa_node.h.

◆ output_filter_

template<typename NEARFIELDMAP >
cPcdFilterPaRos cNearfieldMapBasePaNode< NEARFIELDMAP >::output_filter_
protected

Definition at line 187 of file nearfield_map_base_pa_node.h.

◆ output_throttle_

template<typename NEARFIELDMAP >
cPcdFilterPaRosThrottle cNearfieldMapBasePaNode< NEARFIELDMAP >::output_throttle_
protected

Definition at line 184 of file nearfield_map_base_pa_node.h.

◆ params_addcloud_camera_

template<typename NEARFIELDMAP >
cAddCloudParameter cNearfieldMapBasePaNode< NEARFIELDMAP >::params_addcloud_camera_
protected

parameter for insertion of depth images from camera

Definition at line 163 of file nearfield_map_base_pa_node.h.

◆ params_addcloud_laser_full_

template<typename NEARFIELDMAP >
cAddCloudParameter cNearfieldMapBasePaNode< NEARFIELDMAP >::params_addcloud_laser_full_
protected

parameter for insertion of full laserscans

Definition at line 167 of file nearfield_map_base_pa_node.h.

◆ params_addcloud_laser_scan_

template<typename NEARFIELDMAP >
cAddCloudParameter cNearfieldMapBasePaNode< NEARFIELDMAP >::params_addcloud_laser_scan_
protected

parameter for insertion of single laserscans

Definition at line 165 of file nearfield_map_base_pa_node.h.

◆ pub_cloud_free_

template<typename NEARFIELDMAP >
ros::Publisher cNearfieldMapBasePaNode< NEARFIELDMAP >::pub_cloud_free_
protected

puplisher for free voxels as pointcloud

Definition at line 201 of file nearfield_map_base_pa_node.h.

◆ pub_cloud_occupied_

template<typename NEARFIELDMAP >
ros::Publisher cNearfieldMapBasePaNode< NEARFIELDMAP >::pub_cloud_occupied_
protected

puplisher for occupied voxels as pointcloud

Definition at line 203 of file nearfield_map_base_pa_node.h.

◆ pub_nearfield_

template<typename NEARFIELDMAP >
ros::Publisher cNearfieldMapBasePaNode< NEARFIELDMAP >::pub_nearfield_
protected

puplisher for requested nearfield map (pointcloud)

Definition at line 205 of file nearfield_map_base_pa_node.h.

◆ pub_octomap_

template<typename NEARFIELDMAP >
ros::Publisher cNearfieldMapBasePaNode< NEARFIELDMAP >::pub_octomap_
protected

puplisher for the octomap (binary data)

Definition at line 197 of file nearfield_map_base_pa_node.h.

◆ pub_octomap_full_

template<typename NEARFIELDMAP >
ros::Publisher cNearfieldMapBasePaNode< NEARFIELDMAP >::pub_octomap_full_
protected

puplisher for the octomap (full data)

Definition at line 199 of file nearfield_map_base_pa_node.h.

◆ srv_change_settings_

template<typename NEARFIELDMAP >
ros::ServiceServer cNearfieldMapBasePaNode< NEARFIELDMAP >::srv_change_settings_
protected

service for changing parameters of the nearfield map

Definition at line 245 of file nearfield_map_base_pa_node.h.

◆ srv_clear_

template<typename NEARFIELDMAP >
ros::ServiceServer cNearfieldMapBasePaNode< NEARFIELDMAP >::srv_clear_
protected

service for clearing the octomap

Definition at line 213 of file nearfield_map_base_pa_node.h.

◆ srv_getsize_

template<typename NEARFIELDMAP >
ros::ServiceServer cNearfieldMapBasePaNode< NEARFIELDMAP >::srv_getsize_
protected

service for receiving the size of the octomap

Definition at line 218 of file nearfield_map_base_pa_node.h.

◆ srv_load_

template<typename NEARFIELDMAP >
ros::ServiceServer cNearfieldMapBasePaNode< NEARFIELDMAP >::srv_load_
protected

service for loading a octomap

Definition at line 229 of file nearfield_map_base_pa_node.h.

◆ srv_request_

template<typename NEARFIELDMAP >
ros::ServiceServer cNearfieldMapBasePaNode< NEARFIELDMAP >::srv_request_
protected

service for requesting a nearfield map (pointcloud) via this service

Definition at line 239 of file nearfield_map_base_pa_node.h.

◆ srv_save_

template<typename NEARFIELDMAP >
ros::ServiceServer cNearfieldMapBasePaNode< NEARFIELDMAP >::srv_save_
protected

service for saving the octomap

Definition at line 224 of file nearfield_map_base_pa_node.h.

◆ srv_send_

template<typename NEARFIELDMAP >
ros::ServiceServer cNearfieldMapBasePaNode< NEARFIELDMAP >::srv_send_
protected

service for requesting a nearfield map (pointcloud) via output topic

Definition at line 235 of file nearfield_map_base_pa_node.h.

◆ sub_camera_

template<typename NEARFIELDMAP >
ros::Subscriber cNearfieldMapBasePaNode< NEARFIELDMAP >::sub_camera_
protected

subscriber for depth images from camera

Definition at line 190 of file nearfield_map_base_pa_node.h.

◆ sub_clear_

template<typename NEARFIELDMAP >
ros::Subscriber cNearfieldMapBasePaNode< NEARFIELDMAP >::sub_clear_
protected

subscriber for clearing the octomap

Definition at line 209 of file nearfield_map_base_pa_node.h.

◆ sub_laser_full_

template<typename NEARFIELDMAP >
ros::Subscriber cNearfieldMapBasePaNode< NEARFIELDMAP >::sub_laser_full_
protected

subscriber for single laserscans

Definition at line 194 of file nearfield_map_base_pa_node.h.

◆ sub_laser_scan_

template<typename NEARFIELDMAP >
ros::Subscriber cNearfieldMapBasePaNode< NEARFIELDMAP >::sub_laser_scan_
protected

subscriber for a laserscan

Definition at line 192 of file nearfield_map_base_pa_node.h.

◆ tf_listener_

template<typename NEARFIELDMAP >
tf::TransformListener cNearfieldMapBasePaNode< NEARFIELDMAP >::tf_listener_
protected

transformation of different frames

Definition at line 181 of file nearfield_map_base_pa_node.h.


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


nearfield_map
Author(s):
autogenerated on Wed Mar 2 2022 00:42:09