Functions | |
ROSCPP_DECL void | add_socket_to_watcher (int epfd, int fd) |
void | atexitCallback () |
void | basicSigintHandler (int sig) |
void | check_ipv6_environment () |
void | checkForShutdown () |
void | clockCallback (const rosgraph_msgs::Clock::ConstPtr &msg) |
void | close_signal_pair (signal_fd_t signal_pair[2]) |
ROSCPP_DECL int | close_socket (socket_fd_t &socket) |
ROSCPP_DECL void | close_socket_watcher (int fd) |
bool | closeAllConnections (roscpp::Empty::Request &, roscpp::Empty::Response &) |
void | closeTransport (const TransportUDPPtr &trans) |
ROSCPP_DECL int | create_signal_pair (signal_fd_t signal_pair[2]) |
ROSCPP_DECL int | create_socket_watcher () |
ROS_DEPRECATED boost::shared_ptr< M > | defaultMessageCreateFunction () |
boost::shared_ptr< M > | defaultServiceCreateFunction () |
ROSCPP_DECL void | del_socket_from_watcher (int epfd, int fd) |
const Duration | DURATION_MAX (std::numeric_limits< int32_t >::max(), 999999999) |
const Duration | DURATION_MIN (std::numeric_limits< int32_t >::min(), 0) |
static bool | g_initialized (false) |
static bool | g_stopped (false) |
static bool | g_use_sim_time (true) |
bool | get_environment_variable (std::string &str, const char *environment_variable) |
const ROSCPP_DECL std::string & | getDefaultMasterURI () |
ROSCPP_DECL CallbackQueue * | getGlobalCallbackQueue () |
CallbackQueuePtr | getInternalCallbackQueue () |
ROSCPP_DECL InternalTimerManagerPtr | getInternalTimerManager () |
bool | getLoggers (roscpp::GetLoggers::Request &, roscpp::GetLoggers::Response &resp) |
void | getPid (const XmlRpcValue ¶ms, XmlRpcValue &result) |
ROSCPP_DECL std::string | getROSArg (int argc, const char *const *argv, const std::string &arg) |
ROSCPP_DECL void | init (const M_string &remappings, const std::string &name, uint32_t options=0) |
ROSCPP_DECL void | init (const VP_string &remapping_args, const std::string &name, uint32_t options=0) |
ROSCPP_DECL void | init (int &argc, char **argv, const std::string &name, uint32_t options=0) |
ROSCPP_DECL void | initInternalTimerManager () |
void | internalCallbackQueueThreadFunc () |
ROSCPP_DECL int | is_async_connected (socket_fd_t &socket, int &err) |
ROSCPP_DECL bool | isInitialized () |
ROSCPP_DECL bool | isShuttingDown () |
ROSCPP_DECL bool | isStarted () |
ROSCPP_DECL int | last_socket_error () |
ROSCPP_DECL bool | last_socket_error_is_would_block () |
const ROSCPP_DECL char * | last_socket_error_string () |
bool | md5sumsMatch (const std::string &lhs, const std::string &rhs) |
ROSTIME_DECL void | normalizeSecNSec (uint32_t &sec, uint32_t &nsec) |
ROSTIME_DECL void | normalizeSecNSec (uint64_t &sec, uint64_t &nsec) |
ROSTIME_DECL void | normalizeSecNSecSigned (int32_t &sec, int32_t &nsec) |
ROSTIME_DECL void | normalizeSecNSecSigned (int64_t &sec, int64_t &nsec) |
ROSTIME_DECL void | normalizeSecNSecUnsigned (int64_t &sec, int64_t &nsec) |
ROSCPP_DECL bool | ok () |
ROSTIME_DECL std::ostream & | operator<< (std::ostream &os, const Duration &rhs) |
ROSTIME_DECL std::ostream & | operator<< (std::ostream &os, const SteadyTime &rhs) |
ROSTIME_DECL std::ostream & | operator<< (std::ostream &os, const Time &rhs) |
ROSTIME_DECL std::ostream & | operator<< (std::ostream &os, const WallDuration &rhs) |
ROSTIME_DECL std::ostream & | operator<< (std::ostream &os, const WallTime &rhs) |
ROSCPP_DECL pollfd_vector_ptr | poll_sockets (int epfd, socket_pollfd *fds, nfds_t nfds, int timeout) |
ssize_t | read_signal (const signal_fd_t &signal, void *buffer, const size_t &nbyte) |
ROSCPP_DECL void | removeROSArgs (int argc, const char *const *argv, V_string &args_out) |
ROSCPP_DECL void | requestShutdown () |
int | ros_nanosleep (const uint32_t &sec, const uint32_t &nsec) |
ROSTIME_DECL void | ros_steadytime (uint32_t &sec, uint32_t &nsec) |
bool | ros_wallsleep (uint32_t sec, uint32_t nsec) |
ROSTIME_DECL void | ros_walltime (uint32_t &sec, uint32_t &nsec) |
ROSCPP_DECL void | set_events_on_socket (int epfd, int fd, int events) |
ROSCPP_DECL int | set_non_blocking (socket_fd_t &socket) |
bool | setLoggerLevel (roscpp::SetLoggerLevel::Request &req, roscpp::SetLoggerLevel::Response &) |
ROSCPP_DECL void | shutdown () |
void | shutdownCallback (XmlRpc::XmlRpcValue ¶ms, XmlRpc::XmlRpcValue &result) |
const ROSCPP_DECL char * | socket_error_string (int err) |
ROSCPP_DECL void | spin () |
ROSCPP_DECL void | spin (Spinner &spinner) |
ROSCPP_DECL void | spinOnce () |
void | spinThread () |
ROSCPP_DECL void | start () |
const Time | TIME_MAX (std::numeric_limits< uint32_t >::max(), 999999999) |
bool | urisEqual (const std::string &uri1, const std::string &uri2) |
ROSCPP_DECL void | waitForShutdown () |
ssize_t | write_signal (const signal_fd_t &signal, const void *buffer, const size_t &nbyte) |
Variables | |
const ROSTIME_DECL Duration | DURATION_MAX |
const ROSTIME_DECL Duration | DURATION_MIN |
static bool | g_atexit_registered |
CallbackQueuePtr | g_global_queue |
static uint32_t | g_init_options |
static bool | g_initialized |
static CallbackQueuePtr | g_internal_callback_queue |
static boost::thread | g_internal_queue_thread |
int32_t | g_nh_refcount |
boost::mutex | g_nh_refcount_mutex |
bool | g_node_started_by_nh |
static bool | g_ok |
ROSOutAppender * | g_rosout_appender |
static bool | g_shutdown_requested |
static volatile bool | g_shutting_down |
static boost::recursive_mutex | g_shutting_down_mutex |
static Time | g_sim_time (0, 0) |
static boost::mutex | g_sim_time_mutex |
static boost::mutex | g_start_mutex |
static bool | g_started |
static InternalTimerManagerPtr | g_timer_manager |
const ROSTIME_DECL Time | TIME_MAX |
const Time | TIME_MIN (0, 1) |
const ROSTIME_DECL Time | TIME_MIN |
Software License Agreement (BSD)
Redistribution and use in source and binary forms, with or without modification, are permitted provided that the following conditions are met: Redistributions of source code must retain the above copyright notice, this list of conditions and the following disclaimer. Redistributions in binary form must reproduce the above copyright notice, this list of conditions and the following disclaimer in the documentation and/or other materials provided with the distribution. Neither the name of Clearpath Robotics nor the names of its contributors may be used to endorse or promote products derived from this software without specific prior written permission.
THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS "AS IS" AND ANY EXPRESS OR IMPLIED WAR- RANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES OF MERCHANTABILITY AND FITNESS FOR A PARTICULAR PURPOSE ARE DISCLAIMED. IN NO EVENT SHALL THE COPYRIGHT HOLDER OR CONTRIBUTORS BE LIABLE FOR ANY DIRECT, IN- DIRECT, INCIDENTAL, SPECIAL, EXEMPLARY, OR CONSEQUENTIAL DAMAGES (INCLUDING, BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE GOODS OR SERVICES; LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION) HOWEVER CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN ANY WAY OUT OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE POSSIBILITY OF SUCH DAMAGE.