lsc_ros2_driver
C++ API
Class Hierarchy
File Hierarchy
Full C++ API
Namespaces
Namespace rclcpp
Classes and Structs
Struct Lsc_t
Struct ScanDataConfig
Struct ScanInfo
Struct ScanMea
Struct UdpParser::UdpInfo
Struct UdpParser::UdpSet
Class AsciiParser
Class Autolidar
Class Communication
Class Parser
Class tcpComm
Class udpComm
Class UdpParser
Enums
Enum CmdListNum
Defines
Define CONNECTION_TRY_COUNT
Define DEG2RAD
Define ETX
Define NUM_OF_CMD
Define NUM_OF_CMD_TYPE
Define NUMBER_OF_PARAM
Define PI
Define RAD2DEG
Define RECONNECT_TRY_COUNT
Define RESPONS_WAIT_CNT
Define RS_TIMEOUT_NS
Define RS_TIMEOUT_S
Define STX
Define USE_DIAGNOSTICS
Directories
Directory include
Directory lsc_ros2_driver
Files
File autolidar.hpp
File parser.hpp
File socket.hpp
Standard Documents
CHANGELOG
Changelog for package lsc_ros2_driver
1.0.2 (2024-04-12)
1.0.0 (2022-12-14)
LICENSE
PACKAGE
README
Autonics LSC ROS2 Driver
Table of Contents
1. Supported Hardware
2. ROS API
3. Installation
4. Start
Index
lsc_ros2_driver
C++ API
Class Autolidar
View page source
Class Autolidar
Defined in
File autolidar.hpp
Inheritance Relationships
Base Type
public
rclcpp::Node
Class Documentation
class
Autolidar
:
public
rclcpp
::
Node
Public Functions
explicit
Autolidar
(
)
virtual
~Autolidar
(
)
int
init
(
)
int
get_response
(
std
::
string
cmd
)
int8_t
send_command
(
std
::
string
cmd
)
void
setCommType
(
std
::
shared_ptr
<
Communication
>
comm_type
)
void
setParser
(
std
::
shared_ptr
<
Parser
>
parser
)