Public Member Functions | |
bool | initalize () |
void | publish () |
SickLMS1xxNode () | |
void | startScanner () |
void | stopScanner () |
Public Attributes | |
ros::NodeHandle | nh |
Private Member Functions | |
bool | initalizeLaser () |
bool | initalizeMessage () |
void | publishError (std::string error_str) |
void | setScanDataConfig () |
Private Attributes | |
scanCfg | cfg |
scanData | data |
scanDataCfg | dataCfg |
ros::Publisher | diagnostic_pub |
std::string | frame_id |
double | frequency |
std::string | host |
bool | inverted |
LMS1xx | laser |
double | max_range |
double | min_range |
double | resolution |
sensor_msgs::LaserScan | scan_msg |
ros::Publisher | scan_pub |
bool | set_config |
Definition at line 35 of file lms1xx_node.cpp.
Definition at line 77 of file lms1xx_node.cpp.
bool SickLMS1xxNode::initalize | ( | ) |
Definition at line 108 of file lms1xx_node.cpp.
bool SickLMS1xxNode::initalizeLaser | ( | ) | [private] |
Definition at line 121 of file lms1xx_node.cpp.
bool SickLMS1xxNode::initalizeMessage | ( | ) | [private] |
Definition at line 161 of file lms1xx_node.cpp.
void SickLMS1xxNode::publish | ( | ) |
Definition at line 239 of file lms1xx_node.cpp.
void SickLMS1xxNode::publishError | ( | std::string | error_str | ) | [private] |
Definition at line 278 of file lms1xx_node.cpp.
void SickLMS1xxNode::setScanDataConfig | ( | ) | [private] |
Definition at line 204 of file lms1xx_node.cpp.
void SickLMS1xxNode::startScanner | ( | ) |
Definition at line 222 of file lms1xx_node.cpp.
void SickLMS1xxNode::stopScanner | ( | ) |
Definition at line 268 of file lms1xx_node.cpp.
scanCfg SickLMS1xxNode::cfg [private] |
Definition at line 61 of file lms1xx_node.cpp.
scanData SickLMS1xxNode::data [private] |
Definition at line 63 of file lms1xx_node.cpp.
scanDataCfg SickLMS1xxNode::dataCfg [private] |
Definition at line 62 of file lms1xx_node.cpp.
ros::Publisher SickLMS1xxNode::diagnostic_pub [private] |
Definition at line 57 of file lms1xx_node.cpp.
std::string SickLMS1xxNode::frame_id [private] |
Definition at line 68 of file lms1xx_node.cpp.
double SickLMS1xxNode::frequency [private] |
Definition at line 71 of file lms1xx_node.cpp.
std::string SickLMS1xxNode::host [private] |
Definition at line 67 of file lms1xx_node.cpp.
bool SickLMS1xxNode::inverted [private] |
Definition at line 69 of file lms1xx_node.cpp.
LMS1xx SickLMS1xxNode::laser [private] |
Definition at line 60 of file lms1xx_node.cpp.
double SickLMS1xxNode::max_range [private] |
Definition at line 74 of file lms1xx_node.cpp.
double SickLMS1xxNode::min_range [private] |
Definition at line 73 of file lms1xx_node.cpp.
Definition at line 47 of file lms1xx_node.cpp.
double SickLMS1xxNode::resolution [private] |
Definition at line 70 of file lms1xx_node.cpp.
sensor_msgs::LaserScan SickLMS1xxNode::scan_msg [private] |
Definition at line 65 of file lms1xx_node.cpp.
ros::Publisher SickLMS1xxNode::scan_pub [private] |
Definition at line 56 of file lms1xx_node.cpp.
bool SickLMS1xxNode::set_config [private] |
Definition at line 72 of file lms1xx_node.cpp.