#include <ros/message_traits.h>#include <ros/ros.h>#include "ros/time.h"#include "ros/console.h"#include "ros/assert.h"#include <stdint.h>#include <assert.h>#include <stddef.h>#include <string>#include <vector>#include <map>#include <set>#include <list>#include <boost/shared_ptr.hpp>#include <boost/weak_ptr.hpp>#include <boost/function.hpp>#include <ros/macros.h>#include "exceptions.h"#include "ros/types.h"#include <boost/shared_array.hpp>#include "ros/forwards.h"#include "ros/common.h"#include "ros/message.h"#include "ros/serialization.h"#include <boost/bind.hpp>#include <typeinfo>#include <boost/type_traits/is_void.hpp>#include <boost/type_traits/is_base_of.hpp>#include <boost/type_traits/is_const.hpp>#include <boost/type_traits/add_const.hpp>#include <boost/type_traits/remove_const.hpp>#include <boost/utility/enable_if.hpp>#include <boost/make_shared.hpp>#include <ros/static_assert.h>#include <boost/type_traits/remove_reference.hpp>#include "ros/builtin_message_traits.h"#include "ros/message_event.h"#include "forwards.h"#include "timer_options.h"#include "wall_timer_options.h"#include "ros/service_traits.h"#include <boost/lexical_cast.hpp>#include "subscription_callback_helper.h"#include "ros/spinner.h"#include <time.h>#include "ros/publisher.h"#include <boost/utility.hpp>#include "ros/service_server.h"#include "ros/subscriber.h"#include "ros/node_handle.h"#include "ros/init.h"#include "XmlRpcValue.h"#include "node_handle.h"#include "ros/names.h"#include "sensor_msgs/PointCloud.h"#include <ostream>#include "ros/message_operations.h"#include "geometry_msgs/TransformStamped.h"#include <iostream>#include <iomanip>#include <cmath>#include <sstream>#include <stdexcept>#include <boost/thread/mutex.hpp>#include "tf/transform_datatypes.h"#include "tf/exceptions.h"#include "LinearMath/btTransform.h"#include <boost/signals.hpp>#include "std_msgs/Header.h"#include "geometry_msgs/Vector3.h"#include "ros/ros.h"#include <boost/thread/shared_mutex.hpp>#include <boost/thread/condition_variable.hpp>#include <boost/thread/tss.hpp>#include <deque>#include "boost/thread.hpp"#include <boost/optional.hpp>
Go to the source code of this file.
Namespaces | |
| namespace | graph_mapping_utils |
Typedefs | |
| typedef boost::optional < gm::PoseStamped > | graph_mapping_utils::MaybePose |
| typedef boost::optional < tf::StampedTransform > | graph_mapping_utils::MaybeTransform |
Functions | |
| void | graph_mapping_utils::doNothing (const ros::TimerEvent &e) |
| ros::Duration | graph_mapping_utils::duration (const double rate) |
| template<class P > | |
| P | graph_mapping_utils::getParam (const ros::NodeHandle &nh, const string &name, const P &default_val) |
| Get a parameter, with default values. | |
| template<class P > | |
| P | graph_mapping_utils::getParam (const ros::NodeHandle &nh, const string &name) |
| Get a parameter. | |
| MaybeTransform | graph_mapping_utils::getTransform (const tf::TransformListener &tf, const string &target_frame, const string &source_frame, const ros::Time &t, const ros::Duration &timeout) |
| MaybeTransform | graph_mapping_utils::getTransform (const tf::Transformer &tf, const string &target_frame, const ros::Time &target_time, const string &source_frame, const ros::Time &source_time, const string &fixed_frame, const ros::Duration &timeout) |
| template<class P > | |
| P | graph_mapping_utils::searchParam (const ros::NodeHandle &nh, const string &name, const P &default_val) |
| Search for a parameter in a namespace and its ancestors with default. | |
| template<class P > | |
| P | graph_mapping_utils::searchParam (const ros::NodeHandle &nh, const string &name) |
| Search for a parameter in a namespace and its ancestors. | |
| template<class F , class G > | |
| ros::Timer | graph_mapping_utils::timerFromRate (const ros::NodeHandle &nh, const double rate, const F &fn, const G &obj_ptr) |
| template<class MsgPtr > | |
| ros::Time | graph_mapping_utils::timestamp (const MsgPtr &data) |
| Get the timestamp given a shared pointer to a ROS message. | |
| MaybePose | graph_mapping_utils::waitAndTransform (const tf::TransformListener &tf, const gm::PoseStamped &pose_in, const string &target_frame, const ros::Time &target_time, const string &fixed_frame, const ros::Duration &timeout) |
Ros-related utilities
Definition in file ros.h.