ANGLE_INC | omron_os32c_driver::OS32C | static |
ANGLE_MAX | omron_os32c_driver::OS32C | static |
ANGLE_MIN | omron_os32c_driver::OS32C | static |
calcBeamCentre(int beam_num) | omron_os32c_driver::OS32C | inlinestatic |
calcBeamMask(double start_angle, double end_angle, EIP_BYTE mask[]) | omron_os32c_driver::OS32C | private |
calcBeamNumber(double angle) | omron_os32c_driver::OS32C | inlinestatic |
close() | eip::Session | |
closeActiveConnection() | omron_os32c_driver::OS32C | |
closeConnection(size_t n) | eip::Session | |
connection_num_ | omron_os32c_driver::OS32C | private |
convertToLaserScan(const RangeAndReflectanceMeasurement &rr, sensor_msgs::LaserScan *ls) | omron_os32c_driver::OS32C | static |
convertToLaserScan(const MeasurementReport &mr, sensor_msgs::LaserScan *ls) | omron_os32c_driver::OS32C | static |
createConnection(const EIP_CONNECTION_INFO_T &o_to_t, const EIP_CONNECTION_INFO_T &t_to_o) | eip::Session | |
DISTANCE_MAX | omron_os32c_driver::OS32C | static |
DISTANCE_MIN | omron_os32c_driver::OS32C | static |
end_angle_ | omron_os32c_driver::OS32C | private |
fillLaserScanStaticConfig(sensor_msgs::LaserScan *ls) | omron_os32c_driver::OS32C | |
FRIEND_TEST(OS32CTest, test_calc_beam_mask_all) | omron_os32c_driver::OS32C | private |
FRIEND_TEST(OS32CTest, test_calc_beam_at_90) | omron_os32c_driver::OS32C | private |
FRIEND_TEST(OS32CTest, test_calc_beam_boundaries) | omron_os32c_driver::OS32C | private |
FRIEND_TEST(OS32CTest, test_calc_beam_invalid_args) | omron_os32c_driver::OS32C | private |
FRIEND_TEST(OS32CTest, test_convert_to_laserscan) | omron_os32c_driver::OS32C | private |
getConnection(size_t n) | eip::Session | |
getRangeFormat() | omron_os32c_driver::OS32C | |
getReflectivityFormat() | omron_os32c_driver::OS32C | |
getSerialNum() const | eip::Session | |
getSessionID() | eip::Session | |
getSingleAttribute(EIP_USINT class_id, EIP_USINT instance_id, EIP_USINT attribute_id, T v) | eip::Session | |
getSingleAttributeSerializable(EIP_USINT class_id, EIP_USINT instance_id, EIP_USINT attribute_id, Serializable &result) | eip::Session | |
getSingleRRScan() | omron_os32c_driver::OS32C | |
getVendorID() const | eip::Session | |
mrc_ | omron_os32c_driver::OS32C | private |
mrc_sequence_num_ | omron_os32c_driver::OS32C | private |
open(string hostname, string port="44818", string io_port="2222") | eip::Session | |
OS32C(shared_ptr< Socket > socket, shared_ptr< Socket > io_socket) | omron_os32c_driver::OS32C | inline |
receiveIOPacket() | eip::Session | |
receiveMeasurementReportUDP() | omron_os32c_driver::OS32C | |
selectBeams(double start_angle, double end_angle) | omron_os32c_driver::OS32C | |
sendIOPacket(CPFPacket &pkt) | eip::Session | |
sendMeasurmentReportConfigUDP() | omron_os32c_driver::OS32C | |
Session(shared_ptr< Socket > socket, shared_ptr< Socket > io_socket, EIP_UINT vendor_id=DEFAULT_VENDOR_ID, EIP_UDINT serial_num=DEFAULT_SERIAL_NUM) | eip::Session | |
setRangeFormat(EIP_UINT format) | omron_os32c_driver::OS32C | |
setReflectivityFormat(EIP_UINT format) | omron_os32c_driver::OS32C | |
setSingleAttribute(EIP_USINT class_id, EIP_USINT instance_id, EIP_USINT attribute_id, T v) | eip::Session | |
setSingleAttributeSerializable(EIP_USINT class_id, EIP_USINT instance_id, EIP_USINT attribute_id, shared_ptr< Serializable > data) | eip::Session | |
start_angle_ | omron_os32c_driver::OS32C | private |
startUDPIO() | omron_os32c_driver::OS32C | |
~Session() | eip::Session | virtual |