34 #include <std_msgs/String.h> 87 #endif // R2000_NODE_H int scan_frequency_
scan_frequency parameter
Driver for the laserscanner R2000 of Pepperl+Fuchs.
R2000Node()
Initialize and connect to laser range finder.
int samples_per_scan_
samples_per_scan parameter
ros::NodeHandle nh_
Internal ROS node handle.
void cmdMsgCallback(const std_msgs::StringConstPtr &msg)
Callback function for control commands.
ROS driver node for the Pepperl+Fuchs R2000 laser range finder.
void getScanData(const ros::TimerEvent &e)
Time callback function for getting data from the driver and sending them out.
std::string scanner_ip_
IP or hostname of laser range finder.
ros::Subscriber cmd_subscriber_
ROS subscriber for receiving control commands.
ros::Timer get_scan_data_timer_
Callback timer for getScanData(...)
ros::Publisher scan_publisher_
ROS publisher for publishing scan data.
R2000Driver * driver_
Pointer to driver.
std::string frame_id_
frame_id of sensor_msgs/Laserscan messages