Writing a tf broadcaster for frame
hi . i want write a tf broadcaster for link_26 in my urdf . i wrote wrist_tf_broadcaster.py (like [this page](http://wiki.ros.org/tf/Tutorials/Writing%20a%20tf%20broadcaster%20(Python)) in...
View Articlerobot_localization map to odom transform seems to be incorrect
I'm using two robot_localization nodes, one for continuous data (wheels' odom + imu) and the other including gps for pose correction. For instance ekf_localization and gps_ekf_localization are giving...
View ArticleChange [velodyne] frame for gmapping
I have .pcap file collected from VLP16 and I first run roslaunch velodyne_pointcloud VLP16_points.launch pcap:=/home/soowon/Documents/111.pcap I can now see in RVIZ in fixed frame of [velodyne] Then I...
View ArticleHector SLAM Mapping Pointcloud
Hi all, I am figuring out a way to manipulate map building using Hector SLAM. I understand that hector mapping converts laser scan msgs into a point cloud for mapping. I am trying to implement the...
View ArticleComputing Rotation Matrix about a rigid frame
Hi guys, This has left me confused a bit . I have a robot in the form of a manikin head which has four markers placed on it. The robot is situated on a table as shown below . [NEngelhard](http://answers.ros.org/users/18581/nengelhard/) told...
View ArticleStripping AMCL TF Tree for Robot_Localization
I am trying the run robot_localization's ekf node with amcl and odometry as the inputs. I would like the ekf node to perform a transform from map->odom. Right now both amcl and the ekf node are...
View ArticleRviz and use_sim_time
I am running a simulation on gazebo and using rviz for visualization. I have transforms between different frames available on the /tf topic. The time stamps are in simulated time. use_sim_time is on....
View ArticleCannot understand tf cpp code
The following code: SlamGMapping::initMapper(const sensor_msgs::LaserScan& scan) { laser_frame_ = scan.header.frame_id; // Get the laser's pose, relative to base. tf::Stamped ident; tf::Stamped...
View Articlefind 3D location of the sensor when a depth image arrives
Hey buddies! I went through the forum and couldn't find a satisfying answer. Sorry, if I reopened an already-answered question. Basically, I need to write a ROS node that will print the 3D location of...
View ArticleLaunching multiple turtlebots under namespaces (real environment)
I am trying to launch multiple turtlebots (each under a namespace) with navigation stack. I am building upon the similar task for stage simulator...
View ArticleAMCL: map and scan not in the same frame
I load the map (built by hector slam before) by map_server and my scan is in rosbag. When I play rosbag. The scan is in "scan" frame while the map is in "map" frame. How to solve the problem? I know...
View Articlehow plot tf listener (Python) in rqt ?
hi . how can i plot position for turtle2 in [this page](http://wiki.ros.org/tf/Tutorials/Writing%20a%20tf%20listener%20%28Python%29) ??
View ArticleRVIZ- LIDAR- tf- HECTOR SLAM - plz help. Error Message:lookupTransform...
When i run roslaunch hector_slam_launch tutorial.launch and rplidar_ros rplidar.launch , i get an error message lookupTransform base_link to laser timed out. Could not transform laser scan into...
View ArticleRoscpp header file for tf2 transform
Which header file to include for tf2::Transform? Unfortunately this is not a well documented way to use tf2 as far as I can find. It is in the file `Transform.h`, but that file can't be included as...
View ArticleTF_OLD_DATA ignoring data from the past for frame odom
Hello everyone I was using ROS hydro, however I updated Ubuntu and installed ROS indigo in my computer. I am writing to you because I am currently trying to make a robot which goes from an estimated...
View Articlerviz ignoring transforms
With the lates update of Kinetic the display of laser scan data in some old bag files stopped working. I get the message [ERROR] [1490090873.307973855]: Ignoring transform for child_frame_id...
View ArticlePyKDL wrong GetQuaternion output?
Hi, i'm not sure if it's correct to ask something about PyKDL here but this is a bug produced by a ros node. The question is very simple, i have a PyKDL.Frame and i notice that its conversion to...
View Articlefrom PoseStamped message to tf StampedTransform
What's the neatest way to change a PoseStamped message into a StampedTransform to be published through a transform_broadcaster?
View Article