#include <sick_tim_common.h>
Public Member Functions | |
void | check_angle_range (SickTimConfig &conf) |
double | get_expected_frequency () const |
virtual int | init () |
int | loopOnce () |
SickTimCommon (AbstractParser *parser) | |
void | update_config (sick_tim::SickTimConfig &new_config, uint32_t level=0) |
virtual | ~SickTimCommon () |
Protected Member Functions | |
virtual int | close_device ()=0 |
virtual int | get_datagram (unsigned char *receiveBuffer, int bufferSize, int *actual_length)=0 |
Read a datagram from the device. | |
virtual int | init_device ()=0 |
virtual int | init_scanner () |
virtual int | sendSOPASCommand (const char *request, std::vector< unsigned char > *reply)=0 |
Send a SOPAS command to the device and print out the response to the console. | |
virtual int | stop_scanner () |
Protected Attributes | |
diagnostic_updater::Updater | diagnostics_ |
Private Attributes | |
SickTimConfig | config_ |
ros::Publisher | datagram_pub_ |
diagnostic_updater::DiagnosedPublisher < sensor_msgs::LaserScan > * | diagnosticPub_ |
dynamic_reconfigure::Server < sick_tim::SickTimConfig > | dynamic_reconfigure_server_ |
double | expectedFrequency_ |
ros::NodeHandle | nh_ |
AbstractParser * | parser_ |
ros::Publisher | pub_ |
bool | publish_datagram_ |
Definition at line 61 of file sick_tim_common.h.
sick_tim::SickTimCommon::SickTimCommon | ( | AbstractParser * | parser | ) |
Definition at line 44 of file sick_tim_common.cpp.
sick_tim::SickTimCommon::~SickTimCommon | ( | ) | [virtual] |
Definition at line 86 of file sick_tim_common.cpp.
void sick_tim::SickTimCommon::check_angle_range | ( | SickTimConfig & | conf | ) |
Definition at line 225 of file sick_tim_common.cpp.
virtual int sick_tim::SickTimCommon::close_device | ( | ) | [protected, pure virtual] |
Implemented in sick_tim::SickTimCommonMockup, sick_tim::SickTimCommonUsb, and sick_tim::SickTimCommonTcp.
virtual int sick_tim::SickTimCommon::get_datagram | ( | unsigned char * | receiveBuffer, |
int | bufferSize, | ||
int * | actual_length | ||
) | [protected, pure virtual] |
Read a datagram from the device.
[in] | receiveBuffer | data buffer to fill |
[in] | bufferSize | max data size to write to buffer (result should be 0 terminated) |
[out] | actual_length | the actual amount of data written |
Implemented in sick_tim::SickTimCommonMockup, sick_tim::SickTimCommonUsb, and sick_tim::SickTimCommonTcp.
double sick_tim::SickTimCommon::get_expected_frequency | ( | ) | const [inline] |
Definition at line 71 of file sick_tim_common.h.
int sick_tim::SickTimCommon::init | ( | ) | [virtual] |
Definition at line 94 of file sick_tim_common.cpp.
virtual int sick_tim::SickTimCommon::init_device | ( | ) | [protected, pure virtual] |
Implemented in sick_tim::SickTimCommonUsb, sick_tim::SickTimCommonMockup, and sick_tim::SickTimCommonTcp.
int sick_tim::SickTimCommon::init_scanner | ( | ) | [protected, virtual] |
Reimplemented in sick_tim::SickTimCommonMockup.
Definition at line 108 of file sick_tim_common.cpp.
Definition at line 175 of file sick_tim_common.cpp.
virtual int sick_tim::SickTimCommon::sendSOPASCommand | ( | const char * | request, |
std::vector< unsigned char > * | reply | ||
) | [protected, pure virtual] |
Send a SOPAS command to the device and print out the response to the console.
[in] | request | the command to send. |
[out] | reply | if not NULL, will be filled with the reply package to the command. |
Implemented in sick_tim::SickTimCommonMockup, sick_tim::SickTimCommonUsb, and sick_tim::SickTimCommonTcp.
int sick_tim::SickTimCommon::stop_scanner | ( | ) | [protected, virtual] |
Definition at line 70 of file sick_tim_common.cpp.
void sick_tim::SickTimCommon::update_config | ( | sick_tim::SickTimConfig & | new_config, |
uint32_t | level = 0 |
||
) |
Definition at line 234 of file sick_tim_common.cpp.
SickTimConfig sick_tim::SickTimCommon::config_ [private] |
Definition at line 109 of file sick_tim_common.h.
Definition at line 101 of file sick_tim_common.h.
diagnostic_updater::DiagnosedPublisher<sensor_msgs::LaserScan>* sick_tim::SickTimCommon::diagnosticPub_ [private] |
Definition at line 105 of file sick_tim_common.h.
Definition at line 95 of file sick_tim_common.h.
dynamic_reconfigure::Server<sick_tim::SickTimConfig> sick_tim::SickTimCommon::dynamic_reconfigure_server_ [private] |
Definition at line 110 of file sick_tim_common.h.
double sick_tim::SickTimCommon::expectedFrequency_ [private] |
Definition at line 106 of file sick_tim_common.h.
ros::NodeHandle sick_tim::SickTimCommon::nh_ [private] |
Reimplemented in sick_tim::SickTimCommonMockup.
Definition at line 99 of file sick_tim_common.h.
AbstractParser* sick_tim::SickTimCommon::parser_ [private] |
Definition at line 113 of file sick_tim_common.h.
ros::Publisher sick_tim::SickTimCommon::pub_ [private] |
Definition at line 100 of file sick_tim_common.h.
bool sick_tim::SickTimCommon::publish_datagram_ [private] |
Definition at line 102 of file sick_tim_common.h.