Go to the documentation of this file.
   37 #ifndef JSK_PCL_ROS_POINTCLOUD_LOCALIZATION 
   38 #define JSK_PCL_ROS_POINTCLOUD_LOCALIZATION 
   42 #include <jsk_topic_tools/diagnostic_nodelet.h> 
   43 #include <std_srvs/Empty.h> 
   44 #include <sensor_msgs/PointCloud2.h> 
   45 #include <geometry_msgs/PoseStamped.h> 
   46 #include <pcl/point_cloud.h> 
   47 #include <pcl/point_types.h> 
   48 #include <jsk_recognition_msgs/UpdateOffset.h> 
   52   class PointCloudLocalization: 
public jsk_topic_tools::DiagnosticNodelet
 
   57       DiagnosticNodelet(
"PointCloudLocalization") {}
 
   68       const sensor_msgs::PointCloud2::ConstPtr& cloud_msg);
 
   75       std_srvs::Empty::Request& 
req,
 
   76       std_srvs::Empty::Response& 
res);
 
  103       jsk_recognition_msgs::UpdateOffset::Request& 
req,
 
  104       jsk_recognition_msgs::UpdateOffset::Response& 
res);
 
  107       pcl::PointCloud<pcl::PointNormal>::Ptr in_cloud,
 
  108       pcl::PointCloud<pcl::PointNormal>& out_cloud);
 
  
tf::Transform localize_transform_
virtual bool isFirstTime()
return true if it is the first time to localize
virtual void cloudTimerCallback(const ros::TimerEvent &event)
cloud periodic timer callback
bool clip_unseen_pointcloud_
virtual bool updateOffsetCallback(jsk_recognition_msgs::UpdateOffset::Request &req, jsk_recognition_msgs::UpdateOffset::Response &res)
callback function for ~update_offset service
std::string sensor_frame_
ros::ServiceServer update_offset_srv_
ros::Publisher pub_cloud_
virtual bool localizationRequest(std_srvs::Empty::Request &req, std_srvs::Empty::Response &res)
callback function of ~localize service.
std::string initialize_tf_
virtual void applyDownsampling(pcl::PointCloud< pcl::PointNormal >::Ptr in_cloud, pcl::PointCloud< pcl::PointNormal > &out_cloud)
tf::TransformListener * tf_listener_
tf::TransformBroadcaster tf_broadcast_
virtual void cloudCallback(const sensor_msgs::PointCloud2::ConstPtr &cloud_msg)
callback function of ~input topic.
ros::ServiceServer localization_srv_
virtual void tfTimerCallback(const ros::TimerEvent &event)
tf periodic timer callback
pcl::PointCloud< pcl::PointNormal >::Ptr all_cloud_
boost::mutex mutex
global mutex.
std::string global_frame_
Publishes tf transformation of global_frame_ -> odom_frame_.
virtual void unsubscribe()
sensor_msgs::PointCloud2::ConstPtr latest_cloud_
bool use_normal_
Resolution of voxel grid.
jsk_pcl_ros
Author(s): Yohei Kakiuchi 
autogenerated on Fri May 16 2025 03:12:12