Skip to content

Instantly share code, notes, and snippets.

@eborghi10
Forked from marcoarruda/conversion_node.cpp
Created August 20, 2019 02:37
Show Gist options
  • Star 0 You must be signed in to star a gist
  • Fork 0 You must be signed in to fork a gist
  • Save eborghi10/c3302fae021f894cda531e5d2f739ac1 to your computer and use it in GitHub Desktop.
Save eborghi10/c3302fae021f894cda531e5d2f739ac1 to your computer and use it in GitHub Desktop.
ROS Quaternion to RPY
#include <tf/tf.h>
#include <nav_msgs/Odometry.h>
#include <geometry_msgs/Pose2D.h>
ros::Publisher pub_pose_;
void odometryCallback_(const nav_msgs::Odometry::ConstPtr msg) {
geometry_msgs::Pose2D pose2d;
pose2d.x = msg->pose.pose.position.x;
pose2d.y = msg->pose.pose.position.y;
tf::Quaternion q(
msg->pose.pose.orientation.x,
msg->pose.pose.orientation.y,
msg->pose.pose.orientation.z,
msg->pose.pose.orientation.w);
tf::Matrix3x3 m(q);
double roll, pitch, yaw;
m.getRPY(roll, pitch, yaw);
pose2d.theta = yaw;
pub_pose_.publish(pose2d);
}
int main(int argc, char **argv)
{
ros::init(argc, argv, "conversion_node");
ros::NodeHandle nh_;
ros::Subscriber sub_odom_ = nh_.subscribe("odom", 1, odometryCallback_);
pub_pose_ = nh_.advertise<geometry_msgs::Pose2D>("pose2d", 1);
ros::spin();
return 0;
}
Sign up for free to join this conversation on GitHub. Already have an account? Sign in to comment