35 #ifndef ROS_DURATION_H 36 #define ROS_DURATION_H 45 #pragma warning(disable: 4244) 46 #pragma warning(disable: 4661) 57 namespace posix_time {
85 T& operator-=(
const T &rhs);
86 T& operator*=(
double scale);
88 inline bool operator!=(
const T &rhs)
const {
return !(*
static_cast<const T*
>(
this) == rhs); }
93 double toSec()
const {
return (
double)sec + 1
e-9*(double)nsec; };
162 #endif // ROS_DURATION_H
WallDuration(int32_t _sec, int32_t _nsec)
BOOST_MOVE_USE_STANDARD_LIBRARY_MOVE.
ROSTIME_DECL void normalizeSecNSecSigned(int32_t &sec, int32_t &nsec)
GLenum GLenum GLenum GLenum GLenum scale
ImVec4 operator*(const ImVec4 &color, float t)
bool operator>=(optional< T > const &x, optional< T > const &y)
ROSTIME_DECL const Duration DURATION_MIN
::std_msgs::Duration_< std::allocator< void > > Duration
Duration representation for use with the Time class.
Class to help run loops at a desired frequency.
ImVec4 operator+(const ImVec4 &c, float v)
Duration representation for use with the WallTime class.
bool operator<=(optional< T > const &x, optional< T > const &y)
float3 operator-(const float3 &a, const float3 &b)
std::basic_ostream< Ch, Tr > & operator<<(std::basic_ostream< Ch, Tr > &os, const basic_format< Ch, Tr, Alloc > &f)
bool operator<(optional< T > const &x, optional< T > const &y)
bool operator!=(const T &rhs) const
auto operator+=(std::string &lhs, StringRef const &sr) -> std::string &
ROSTIME_DECL const Duration DURATION_MAX
Duration(int32_t _sec, int32_t _nsec)
Base class for Duration implementations. Provides storage, common functions and operator overloads...
bool operator==(const function_base &f, detail::function::useless_clear_type *)
bool operator>(optional< T > const &x, optional< T > const &y)