#include <ros/ros.h>#include "tf/message_filter.h"#include "message_filters/subscriber.h"#include "tf/transform_listener.h"#include <tf/transform_broadcaster.h>#include "articulation_models/models/factory.h"#include "articulation_msgs/ModelMsg.h"#include "articulation_msgs/TrackMsg.h"#include "articulation_msgs/ParamMsg.h"#include "geometry_msgs/PoseStamped.h"#include <sstream>#include <cmath>#include <visualization_msgs/Marker.h>
Go to the source code of this file.
Functions | |
| tf::Transform | compute_aligned_door_frame (GenericModelPtr generic_model) |
| int | main (int argc, char **argv) |
| void | poseCallback (const tf::TransformListener *listener, std::string target_frame, geometry_msgs::PoseStamped::ConstPtr pose_stamped) |
| void | print (tf::Matrix3x3 m) |
| void | print (tf::Quaternion q) |
| void | print (tf::Vector3 v) |
| void | publish_door_coordinate_frame (GenericModelPtr generic_model) |
| std::string | stream (tf::Vector3 v) |
| std::string | stream (tf::Quaternion v) |
| std::string | stream (tf::StampedTransform tf) |
| visualization_msgs::Marker | visualize_door_model (GenericModelPtr model) |
Variables | |
| ModelMsg | global_model_msg |
| tf::Transform compute_aligned_door_frame | ( | GenericModelPtr | generic_model | ) |
Definition at line 168 of file articulated_door_model.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 57 of file articulated_door_model.cpp.
| void poseCallback | ( | const tf::TransformListener * | listener, |
| std::string | target_frame, | ||
| geometry_msgs::PoseStamped::ConstPtr | pose_stamped | ||
| ) |
Definition at line 118 of file articulated_door_model.cpp.
| void print | ( | tf::Matrix3x3 | m | ) |
Definition at line 282 of file articulated_door_model.cpp.
| void print | ( | tf::Quaternion | q | ) |
Definition at line 288 of file articulated_door_model.cpp.
| void print | ( | tf::Vector3 | v | ) |
Definition at line 291 of file articulated_door_model.cpp.
| void publish_door_coordinate_frame | ( | GenericModelPtr | generic_model | ) |
| std::string stream | ( | tf::Vector3 | v | ) |
Definition at line 294 of file articulated_door_model.cpp.
| std::string stream | ( | tf::Quaternion | v | ) |
Definition at line 299 of file articulated_door_model.cpp.
| std::string stream | ( | tf::StampedTransform | tf | ) |
Definition at line 304 of file articulated_door_model.cpp.
| visualization_msgs::Marker visualize_door_model | ( | GenericModelPtr | model | ) |
Definition at line 140 of file articulated_door_model.cpp.
Definition at line 40 of file articulated_door_model.cpp.