Go to the documentation of this file.
8 #ifndef FLOAM__ODOM_ESTIMATION_NODE_HPP_
9 #define FLOAM__ODOM_ESTIMATION_NODE_HPP_
13 #include "sensor_msgs/PointCloud2.h"
19 #include "geometry_msgs/TransformStamped.h"
71 const sensor_msgs::PointCloud2ConstPtr & edges,
72 const sensor_msgs::PointCloud2ConstPtr & surfaces);
92 #endif // FLOAM__ODOM_ESTIMATION_NODE_HPP_
ros::NodeHandle m_nodeHandle
std::shared_ptr< ApproximateSynchronizer > m_approximateSync
geometry_msgs::TransformStampedPtr m_tfGlobal
ROS Transorm.
void handleClouds(const sensor_msgs::PointCloud2ConstPtr &edges, const sensor_msgs::PointCloud2ConstPtr &surfaces)
floam::lidar::Total m_totals
std::shared_ptr< ExactSynchronizer > m_exactSync
message_filters::Subscriber< sensor_msgs::PointCloud2 > m_subEdges
message_filters::Synchronizer< ExactSyncPolicy > ExactSynchronizer
message_filters::Subscriber< sensor_msgs::PointCloud2 > m_subSurfaces
message_filters::Synchronizer< ApproximateSyncPolicy > ApproximateSynchronizer
floam::odom::OdomEstimation m_odomEstimation
ros::Publisher m_pubLidarOdometry
message_filters::sync_policies::ApproximateTime< sensor_msgs::PointCloud2, sensor_msgs::PointCloud2 > ApproximateSyncPolicy
std::string m_parentFrameId
message_filters::sync_policies::ExactTime< sensor_msgs::PointCloud2, sensor_msgs::PointCloud2 > ExactSyncPolicy
Major rewrite Author: Evan Flynn.
floam
Author(s): Han Wang
autogenerated on Wed Mar 2 2022 00:23:09