30 #ifndef MAPVIZ_PLUGINS_LASERSCAN_PLUGIN_H_ 31 #define MAPVIZ_PLUGINS_LASERSCAN_PLUGIN_H_ 45 #include <sensor_msgs/LaserScan.h> 48 #include "ui_laserscan_config.h" 76 void Draw(
double x,
double y,
double scale);
80 void LoadConfig(
const YAML::Node& node,
const std::string& path);
81 void SaveConfig(YAML::Emitter& emitter,
const std::string& path);
87 void PrintInfo(
const std::string& message);
154 #endif // MAPVIZ_PLUGINS_LASERSCAN_PLUGIN_H_ virtual ~LaserScanPlugin()
void PointSizeChanged(int value)
void laserScanCallback(const sensor_msgs::LaserScanConstPtr &scan)
std::vector< StampedPoint > points
std::string source_frame_
void PrintWarning(const std::string &message)
void ResetTransformedScans()
QWidget * GetConfigWidget(QWidget *parent)
std::vector< double > precomputed_cos_
void Draw(double x, double y, double scale)
void MinValueChanged(double value)
std::deque< Scan > scans_
std::vector< double > precomputed_sin_
void MaxValueChanged(double value)
void LoadConfig(const YAML::Node &node, const std::string &path)
ros::Subscriber laserscan_sub_
QColor CalculateColor(const StampedPoint &point, bool has_intensity)
void ColorTransformerChanged(int index)
void PrintInfo(const std::string &message)
void PrintError(const std::string &message)
bool Initialize(QGLWidget *canvas)
tf::Point transformed_point
void AlphaEdited(double val)
void updatePreComputedTriginometic(const sensor_msgs::LaserScanConstPtr &msg)
void SaveConfig(YAML::Emitter &emitter, const std::string &path)
void BufferSizeChanged(int value)
void UseRainbowChanged(int check_state)
bool GetScanTransform(const Scan &scan, swri_transform_util::Transform &transform)