Go to the documentation of this file.
30 CHokuyoURG::CHokuyoURG()
34 m_sensorPose(0, 0, 0),
36 m_highSensMode(false),
41 m_I_am_owner_serial_port(false),
43 m_timeStartSynchDelay(0),
44 m_disable_firmware_timestamp(false),
68 const size_t N = strlen(str);
79 bool & outThereIsObservation,
82 outThereIsObservation =
false ;
83 hardwareError =
false ;
95 char rcv_status0, rcv_status1;
97 int expectedSize = nRanges * 3 + 4;
111 if (rcv_status0 !=
'0' && rcv_status0 !=
'9' )
113 hardwareError =
true ;
122 if ((
size_t )expectedSize !=
m_rcv_data .size())
125 "[CHokuyoURG::doProcess] ERROR: Expected "
126 << expectedSize <<
" data bytes, received " <<
m_rcv_data .size()
128 hardwareError =
true ;
134 if (do_timestamp_sync &&
137 do_timestamp_sync =
false ;
141 if (do_timestamp_sync)
178 for (
int i = 0; i < nRanges; i++)
180 int b1 = (*ptr++) - 0x30;
181 int b2 = (*ptr++) - 0x30;
182 int b3 = (*ptr++) - 0x30;
184 int range_mm = ((
b1 << 12) | (
b2 << 6) |
b3 );
193 int b4 = (*ptr++) - 0x30;
194 int b5 = (*ptr++) - 0x30;
195 int b6 = (*ptr++) - 0x30;
206 outThereIsObservation =
true ;
220 configSource.
read_int (iniSection,
"HOKUYO_motorSpeed_rpm" , 0);
222 configSource.
read_float (iniSection,
"pose_x" , 0),
223 configSource.
read_float (iniSection,
"pose_y" , 0),
224 configSource.
read_float (iniSection,
"pose_z" , 0),
245 "Either COM_port or IP_DIR must be defined in the configuration file!" );
248 "Both COM_port and IP_DIR set! Please, define only one of them." );
253 "A TCP/IP port number `PORT_DIR` must be specified for Ethernet "
291 std::this_thread::sleep_for(10ms);
294 std::this_thread::sleep_for(10ms);
298 std::this_thread::sleep_for(10ms);
300 std::this_thread::sleep_for(10ms);
320 std::this_thread::sleep_for(10ms);
323 std::this_thread::sleep_for(10ms);
326 std::this_thread::sleep_for(10ms);
354 const int half_range =
static_cast< int > (
361 "[HOKUYO::turnOn] Using reduced FOV: ranges ["
392 char rcv_status0, rcv_status1;
396 "[CHokuyoURG::setHighBaudrate] Changing baudrate to 115200..." );
405 "[CHokuyoURG::setHighBaudrate] Error waiting for response" );
438 nRead = client->
readAsync (buf, to_read, 100, 10);
447 catch (std::exception&)
482 }
while (i < verifLen);
492 if (rcv_status1 != 0x0A)
508 if (nextChar != 0x0A)
return false ;
518 bool lastWasLF =
false ;
554 "[Hokuyo] receiveResponse(): RX `" <<
m_rcv_data
557 if (rcv_status0 !=
'0' &&
558 (rcv_status0 !=
'9' && rcv_status1 !=
'9' ))
561 "[Hokuyo] Error LIDAR status: "
562 << (
int )rcv_status0 <<
" after command: `"
575 catch (std::exception& e)
578 "[Hokuyo] receiveResponse() Exception: %s" , e.what());
589 char rcv_status0, rcv_status1;
593 "[CHokuyoURG::enableSCIP20] Changing protocol to SCIP2.0..." );
612 char rcv_status0, rcv_status1;
616 MRPT_LOG_DEBUG (
"[CHokuyoURG::switchLaserOn] Switching laser ON..." );
635 char rcv_status0, rcv_status1;
639 MRPT_LOG_DEBUG (
"[CHokuyoURG::switchLaserOff] Switching laser OFF..." );
663 char rcv_status0, rcv_status1;
667 "[CHokuyoURG::setMotorSpeed] Setting to %i rpm..." , motoSpeed_rpm);
670 int motorSpeedCode = (600 - motoSpeed_rpm) / 6;
671 if (motorSpeedCode < 0 || motorSpeedCode > 10)
675 <<
" Motorspeed must be in the range 540-600 rpm" );
680 os::sprintf (cmd, 20,
"CR%02i\x0A" , motorSpeedCode);
700 char rcv_status0, rcv_status1;
704 "[CHokuyoURG::setHighSensitivityMode] Setting HS mode to: %s..." ,
705 enabled ?
"true" :
"false" );
735 char rcv_status0, rcv_status1;
738 MRPT_LOG_DEBUG (
"[CHokuyoURG::displayVersionInfo] Asking info..." );
755 if (
c ==
';' )
c =
'\n' ;
761 "\n------------- HOKUYO Scanner: Version Information ------\n"
764 "-------------------------------------------------------\n\n" );
774 char rcv_status0, rcv_status1;
777 MRPT_LOG_DEBUG (
"[CHokuyoURG::displaySensorInfo] Asking for info..." );
793 if (
c ==
';' )
c =
'\n' ;
799 "\n------------- HOKUYO Scanner: Product Information ------\n"
802 "-------------------------------------------------------\n\n" );
810 if (
nullptr != (ptr = strstr(&
m_rcv_data [0],
"DMAX:" )))
811 out_data->
d_max = 0.001 * atoi(ptr + 5);
815 if (
nullptr != (ptr = strstr(&
m_rcv_data [0],
"DMIN:" )))
816 out_data->
d_min = 0.001 * atoi(ptr + 5);
820 if (
nullptr != (ptr = strstr(&
m_rcv_data [0],
"ARES:" )))
825 if (
nullptr != (ptr = strstr(&
m_rcv_data [0],
"SCAN:" )))
830 if (
nullptr != (ptr = strstr(&
m_rcv_data [0],
"AMIN:" )))
835 if (
nullptr != (ptr = strstr(&
m_rcv_data [0],
"AMAX:" )))
840 if (
nullptr != (ptr = strstr(&
m_rcv_data [0],
"AFRT:" )))
845 if (
nullptr != (ptr = strstr(&
m_rcv_data [0],
"MODL:" )))
850 out_data->
model = aux;
861 char rcv_status0, rcv_status1;
864 MRPT_LOG_DEBUG (
"[CHokuyoURG::startScanningMode] Starting scanning mode..." );
875 if (scan_interval > 9) scan_interval = 9;
912 "[CHokuyoURG] Socket connection lost! trying to "
939 if (COM->
isOpen ())
return true ;
944 <<
": Serial port connection lost! Trying to reconnect..." );
970 "No stream bound to the laser nor COM serial port or ip and "
971 "port provided in 'm_com_port','m_ip_dir' and 'm_port_dir'" );
988 <<
" Cannot connect with the server '" <<
m_com_port
1057 void * buf = malloc(
sizeof (
uint8_t ) * to_read);
1061 if (nRead != to_read)
1063 "Error in purge buffers: read and expected number of bytes "
size_t getReadPendingBytes()
Return the number of bytes already in the receive queue (they can be read without waiting)
A TCP socket that can be connected to a TCP server, implementing MRPT's CStream interface for passing...
bool isOpen() const
Returns if port has been correctly open.
std::string sensorLabel
An arbitrary label that can be used to identify the sensor.
void initialize()
Turns the laser on.
bool m_I_am_owner_serial_port
void setScanRange(const size_t i, const float val)
mrpt::system::TTimeStamp secondsToTimestamp(const double nSeconds)
Transform a time interval (in seconds) into TTimeStamp (e.g.
void bindIO(mrpt::io::CStream *streamIO)
Binds the object to a given I/O channel.
float maxRange
The maximum range allowed by the device, in meters (e.g.
bool rightToLeft
The scanning direction: true=counterclockwise; false=clockwise.
mrpt::containers::circular_buffer< uint8_t > m_rx_buffer
Auxiliary buffer for readings.
#define ASSERT_EQUAL_(__A, __B)
Assert comparing two values, reporting their actual values upon failure.
#define __CURRENT_FUNCTION_NAME__
A macro for obtaining the name of the current function:
#define MRPT_LOG_DEBUG(_STRING)
Use: MRPT_LOG_DEBUG("message");
A "CObservation"-derived class that represents a 2D range scan measurement (typically from a laser sc...
bool turnOff()
Disables the scanning mode (this can be used to turn the device in low energy mode,...
const int MINIMUM_PACKETS_TO_SET_TIMESTAMP_REFERENCE
void setFromValues(const double x0, const double y0, const double z0, const double yaw=0, const double pitch=0, const double roll=0)
Set the pose from a 3D position (meters) and yaw/pitch/roll angles (radians) - This method recomputes...
uint32_t m_timeStartUI
Time of the first data packet, for synchronization purposes.
Used in CHokuyoURG::displayVersionInfo.
void filterByExclusionAngles(mrpt::obs::CObservation2DRangeScan &obs) const
Mark as invalid those ranges in a set of forbiden angle ranges.
mrpt::system::TTimeStamp now()
A shortcut for system::getCurrentTime.
A communications serial port built as an implementation of a utils::CStream.
int m_timeStartSynchDelay
Counter to discard to first few packets before setting the correspondence between device and computer...
void loadConfig_sensorSpecific(const mrpt::config::CConfigFileBase &configSource, const std::string &iniSection)
See the class documentation at the top for expected parameters.
int m_firstRange
The first and last ranges to consider from the scan.
bool read_bool(const std::string §ion, const std::string &name, bool defaultValue, bool failIfNotFound=false) const
Contains classes for various device interfaces.
Serial and networking devices and utilities.
bool receiveResponse(char &rcv_status0, char &rcv_status1)
Waits for a response from the device.
bool enableSCIP20()
Enables the SCIP2.0 protocol (this must be called at the very begining!).
void resizeScan(const size_t len)
Resizes all data vectors to allocate a given number of scan rays.
#define THROW_EXCEPTION(msg)
void purgeBuffers()
Purge tx and rx buffers.
#define ASSERT_(f)
Defines an assertion mechanism.
void setScanRangeValidity(const size_t i, const bool val)
double RAD2DEG(const double x)
Radians to degrees.
double d_min
Min/Max ranges, in meters.
#define MRPT_LOG_DEBUG_FMT(_FMT_STRING,...)
Use: MRPT_LOG_DEBUG_FMT("i=%u", i);
bool assureBufferHasBytes(const size_t nDesiredBytes)
Assures a minimum number of bytes in the input buffer, reading from the serial port only if required.
bool ensureStreamIsOpen()
Returns true if there is a valid stream bound to the laser scanner, otherwise it first try to open th...
This namespace contains representation of robot actions and observations.
mrpt::system::TTimeStamp timestamp
The associated UTC time-stamp.
virtual size_t Read(void *Buffer, size_t Count)=0
Introduces a pure virtual method responsible for reading from the stream.
std::string read_string(const std::string §ion, const std::string &name, const std::string &defaultValue, bool failIfNotFound=false) const
mrpt::system::TTimeStamp m_timeStartTT
int m_motorSpeed_rpm
The motor speed (default=600rpm)
uint64_t TTimeStamp
A system independent time type, it holds the the number of 100-nanosecond intervals since January 1,...
int read_int(const std::string §ion, const std::string &name, int defaultValue, bool failIfNotFound=false) const
unsigned int getScanInterval() const
void setScanIntensity(const size_t i, const int val)
int sprintf(char *buf, size_t bufSize, const char *format,...) noexcept MRPT_printf_format_check(3
An OS-independent version of sprintf (Notice the bufSize param, which may be ignored in some compiler...
unsigned int m_port_dir
If set to non-empty and m_ip_dir too, the program will try to connect to a Hokuyo using Ethernet comm...
void setConfig(int baudRate, int parity=0, int bits=8, int nStopBits=1, bool enableFlowControl=false)
Changes the configuration of the port.
bool m_disable_firmware_timestamp
bool switchLaserOn()
Switchs the laser on.
#define MRPT_LOAD_HERE_CONFIG_VAR( variableName, variableType, targetVariable, configFileObject, sectionNameStr)
size_t capacity() const
Return the maximum capacity of the buffer.
void purgeBuffers()
Empties the RX buffers of the serial port.
size_t size() const
Return the number of elements available for read ("pop") in the buffer (this is NOT the maximum size ...
float aperture
The "aperture" or field-of-view of the range finder, in radians (typically M_PI = 180 degrees).
void setScanHasIntensity(bool setHasIntensityFlag)
Marks this scan as having or not intensity data.
This class allows loading and storing values and vectors of different types from a configuration text...
mrpt::io::CStream * m_stream
The I/O channel (will be nullptr if not bound).
void loadCommonParams(const mrpt::config::CConfigFileBase &configSource, const std::string &iniSection)
Should be call by derived classes at "loadConfig" (loads exclusion areas AND exclusion angles).
unsigned int m_scan_interval
#define MRPT_LOG_ERROR_FMT(_FMT_STRING,...)
#define MRPT_LOG_ERROR(_STRING)
std::string m_lastSentMeasCmd
The last sent measurement command (MDXXX), including the last 0x0A.
mrpt::gui::CDisplayWindow3D::Ptr m_win
void connect(const std::string &remotePartAddress, unsigned short remotePartTCPPort, unsigned int timeout_ms=0)
Establishes a connection with a remote part.
virtual size_t Write(const void *Buffer, size_t Count)=0
Introduces a pure virtual method responsible for writing to the stream.
bool setIntensityMode(bool enabled)
If true scans will capture intensity.
void setMinLoggingLevel(const VerbosityLevel level)
Set the minimum logging level for which the incoming logs are going to be taken into account.
double m_reduced_fov
Used to reduce artificially the interval of scan ranges.
size_t readAsync(void *Buffer, const size_t Count, const int timeoutStart_ms=-1, const int timeoutBetween_ms=-1)
A method for reading from the socket with an optional timeout.
std::string m_sensorLabel
See CGenericSensor.
float stdError
The "sigma" error of the device in meters, used while inserting the scan in an occupancy grid.
float read_float(const std::string §ion, const std::string &name, float defaultValue, bool failIfNotFound=false) const
bool displayVersionInfo()
Ask to the device, and print to the debug stream, details about the firmware version,...
bool displaySensorInfo(CHokuyoURG::TSensorInfo *out_data=nullptr)
Ask to the device, and print to the debug stream, details about the sensor model.
T pop()
Retrieve an element from the buffer.
int scan_first
First, last, and front step of the scanner angular span.
#define ASSERTMSG_(f, __ERROR_MSG)
Defines an assertion mechanism.
void push_many(T *array_elements, size_t count)
Insert an array of elements in the buffer.
#define IMPLEMENTS_GENERIC_SENSOR(class_name, NameSpace)
This must be inserted in all CGenericSensor classes implementation files:
size_t available() const
The maximum number of elements that can be written ("push") without rising an overflow error.
void sendCmd(const char *str)
bool setHighSensitivityMode(bool enabled)
Changes the high sensitivity mode (HS) (default: false)
void processPreview(const mrpt::obs::CObservation2DRangeScan &obs)
Must be called inside the capture method to allow optional GUI preview of scans.
#define MRPT_LOG_DEBUG_STREAM(__CONTENTS)
Use: MRPT_LOG_DEBUG_STREAM("Var=" << value << " foo=" << foo_var);
#define MRPT_LOG_ERROR_STREAM(__CONTENTS)
mrpt::containers::ContainerReadOnlyProxyAccessor< mrpt::aligned_std_vector< float > > scan
The range values of the scan, in meters.
void open()
Open the port.
std::string m_ip_dir
If set to non-empty and m_port_dir too, the program will try to connect to a Hokuyo using Ethernet co...
void setTimeouts(int ReadIntervalTimeout, int ReadTotalTimeoutMultiplier, int ReadTotalTimeoutConstant, int WriteTotalTimeoutMultiplier, int WriteTotalTimeoutConstant)
Changes the timeouts of the port, in milliseconds.
int scans_per_360deg
Number of measuremens per 360 degrees.
This software driver implements the protocol SCIP-2.0 for interfacing HOKUYO URG/UTM/UXM/UST laser sc...
std::string m_com_port
If set to non-empty, the serial port will be attempted to be opened automatically when this class is ...
int motor_speed_rpm
Standard motor speed, rpm.
#define MRPT_LOG_INFO_STREAM(__CONTENTS)
GLsizei const GLchar ** string
bool switchLaserOff()
Switchs the laser off.
std::string model
The sensor model.
std::string m_rcv_data
temp buffer for incoming data packets
virtual ~CHokuyoURG()
Destructor: turns the laser off.
bool setMotorSpeed(int motoSpeed_rpm)
Changes the motor speed in rpm's (default 600rpm)
mrpt::poses::CPose3D sensorPose
The 6D pose of the sensor on the robot at the moment of starting the scan.
bool startScanningMode()
Start the continuous scanning mode, using parameters stored in the object (loaded from the ....
void doProcessSimple(bool &outThereIsObservation, mrpt::obs::CObservation2DRangeScan &outObservation, bool &hardwareError)
Specific laser scanner "software drivers" must process here new data from the I/O stream,...
void setScanInterval(unsigned int skipScanCount)
Set the skip scan count (0 means send all scans).
The namespace for 3D scene representation and rendering.
void filterByExclusionAreas(mrpt::obs::CObservation2DRangeScan &obs) const
Mark as invalid those points which (x,y) coordinates fall within the exclusion polygons.
bool turnOn()
Enables the scanning mode (which may depend on the specific laser device); this must be called before...
bool isConnected()
Returns true if this objects represents a successfully connected socket.
unsigned __int32 uint32_t
TSensorInfo m_sensor_info
The information gathered when the laser is first open.
bool m_intensity
Get intensity from lidar scan (default: false)
This namespace provides a OS-independent interface to many useful functions: filenames manipulation,...
bool setHighBaudrate()
Passes to 115200bps bitrate.
bool m_highSensMode
High sensitivity [HS] mode (default: false)
poses::CPose3D m_sensorPose
The sensor 6D pose:
void memcpy(void *dest, size_t destSize, const void *src, size_t copyCount) noexcept
An OS and compiler independent version of "memcpy".
double DEG2RAD(const double x)
Degrees to radians.
Page generated by Doxygen 1.8.17 for MRPT 1.9.9 Git: ad3a9d8ae Tue May 1 23:10:22 2018 -0700 at miƩ 12 jul 2023 10:03:34 CEST