Class InputSocket
Defined in File input.hpp
Inheritance Relationships
Base Type
public velodyne_driver::Input
(Class Input)
Class Documentation
-
class InputSocket : public velodyne_driver::Input
Live Velodyne input from socket.
Public Functions
-
explicit InputSocket(rclcpp::Node *private_nh, const std::string &devip, uint16_t port, bool gps_time)
-
~InputSocket() override
-
virtual int getPacket(velodyne_msgs::msg::VelodynePacket *pkt, const double time_offset) override
Read one Velodyne packet.
- Parameters:
pkt – points to VelodynePacket message
- Returns:
0 if successful, -1 if end of file > 0 if incomplete packet (is this possible?)
-
void setDeviceIP(const std::string &ip)
-
explicit InputSocket(rclcpp::Node *private_nh, const std::string &devip, uint16_t port, bool gps_time)