Quantcast
Channel: ROS Answers: Open Source Q&A Forum - RSS feed
Viewing all 1404 articles
Browse latest View live

rviz can not send goal to move_base from another computer

$
0
0
I am running a car-like robot. I have an move_base node with global/local planner, and I can send goal from rviz to move the car. Now, I want to run the rviz from another computer. Everything works fine, I can see the tf, laser scan etc in rviz. But when I sent the goal with "2D Nav Goal" in rviz from another computer, the car did not move. The car did not get the goal message either when I run "rostopic echo". Why?

Coloring of pcd-pointcloud in Rviz

$
0
0
Hi! I am very new to ROS, so please take that into account when answering :) (Ubuntu 14.04 64bit in a VirtualBox with Windows Host, ROS Indigo) **What I did:** I used rosrun pcl_ros pcd_to_pointcloud myFilename.pcd 0.1 to publish a topic containing my pcl-pointcloud as a PointCloud2 message. The output of this call is: > [ INFO] [1449049889.334492450]:> Publishing data on topic /cloud_pcd> with frame_id /base_link. [ INFO]> [1449049889.438294770]: Loaded a point> cloud with 307200 points (total size> is 4915200) and the following> channels: x y z rgba. As one can correctly see, the pointcloud also contains color information. I now tried to visualize the point cloud using Rviz. For this purpose I set the Fixed Frame to "/base_link" and added a "PointCloud2"-Display whose topic I set to "/cloud_pcd". **Problem description:** I was only able to see the point cloud when setting the color to something else than RGB8. Why? There should be color information and I'd like my point cloud nicely colored :) How can I fix this?

Rtabmap PointCloud2 frame oscillates when viewed in RVIZ

$
0
0
The PointCloud2 topic's frame keeps switching back and forth wrt to the robot's frame, as seen in https://imgur.com/a/NosBsOx. What could be the cause?

RVIZ shows odom frame fixed to map frame when running rtabmap

$
0
0
I've set the map frame as the fixed frame in RVIZ, and this is what it looks like when running rtabmap https://imgur.com/a/U5fJLLP . This is what my partial tf-tree looks like https://imgur.com/a/1s2PnV8. This is my launch file for rtabmap:

odom not aligned with base_link?

$
0
0
When viewing my robot in rviz, the odom link seems not to be aligned with the rest of the robot https://imgur.com/a/4exMRIa. What could causing this?

Transform argument source_frame in tf2 frame_ids cannot be empty

$
0
0
Hello everyone, I am trying to simulate IMU sensor using this IMU plugin in V-REP and visualize results in rviz. https://github.com/bartville/vrep_plugin_imu But I get following error in rviz: ![image description](https://i.imgur.com/v2ymC5h.png) In the left terminal rviz is running and in the right command "rostopic echo /vrep/imu" so You can see that IMU is publishing some data. I think frame_id: ' ' which is empty, is a problem but I don't know how to set it in V-REP or rviz. Please somebody help, I completely do not understand what is wrong...

Where does RViz/MoveIt get the link position

$
0
0
I'm currently trying to get the `universal_robot` package with UR5 running in Gazebo and RViz under Melodic (see also https://github.com/ros-industrial/universal_robot/issues/374). In the issue above I have the problem that the robot which is shown in RViz looks broken and all the link positions are set to `0,0,0` whereas the `/tf` topic seems to be fine: ![RViz UR5](https://user-images.githubusercontent.com/251973/43701662-42efe6de-9957-11e8-8b34-6a1f71e01e56.png) Here my general understanding question: Which topic is RViz using to calculate the link position? In the screenshot above the links are all in `0,0,0`. I guess the process is somehow like this: Gazebo -> /joint_states -> /tf -> RViz magic topic

How to see visualization of execution of motion on RVIZ using MoveIt

$
0
0
I want to see the trail/visualization of motion when i execute a motion. Both these options(Trail/Animation) are switched on in the rviz motion planning menu. What can be done? Does this mean that there is some fault with the urdf or moveit_config file? The motion planning trajectory slider also doesn't work. [Picture of Arm on Rviz](https://drive.google.com/file/d/1u81NDZN1wOF4gxA8IGcugao7jVGrJUNg/view?usp=sharing)

ROS: Google-cartographer / Mapping

$
0
0
I have to create a map, to do so I installed google cartographer and I'm using a 3D camera with whom I got the data of my surrounding. I am reading the documentation to the cartographer but I cant find the place where it is explaining to me how i do the mapping. I know i have to start rviz but I don't know what the next step is. Am I getting the data of the camera in rviz? And is there any Youtube tutorial I can follow or something?

Remote run "rosrun rviz rviz" to Ubuntu 14.04 LTS ROS indigo

$
0
0
Hi Guys I am using Ubuntu 14.04 LTS ROS indigo as robot machine connected to internal WLAN server. I need to run this machine remotely and access the rviz visualization. I choose Windows 10 'Remote Desktop Connection' to connect to Ubuntu 14.04 LTS ROS indigo, Everything is setup perfectly ROS_HOSTNAME, ROS_IP and ROS_MASATER_URI. But when I run Rosrun Rviz Rviz I get the following Multiple errors Xlib: extension "XInputExtension" missing on display ":10.0". [ INFO] [1533643820.642273943]: rviz version 1.11.19 [ INFO] [1533643820.642353535]: compiled against Qt version 4.8.6 [ INFO] [1533643820.642368853]: compiled against OGRE version 1.8.1 (Byatis) libGL error: No matching fbConfigs or visuals found libGL error: failed to load driver: swrast libGL error: No matching fbConfigs or visuals found libGL error: failed to load driver: swrast Segmentation fault Kindly give some suggestions I am stuck big time looked up everywhere could not find solutions thanks for help

jackal_cartographer_navigation lunacy! robot goes INSANE when given 2D nav goal

$
0
0
I'm using a 2d lidar with jackal_cartographer_navigation for building my map and navigating. Everything looks good in terms of mapping, but the jackal literally tries to kill me if I try to send it a simple 2D nav goal rviz. The issue is, when I tell it to go forwards, it goes backwards, so I have one of my frames misaligned. How can I troubleshoot this MADNESS?!

Rviz end effector position commands not reflecting the right coordinates

$
0
0
Hello, I am working with ROS Kinetic on Ubuntu 16.04, and I am trying to send end effector poses to my Staubli TX90 using move group commands. I send an [x,y,z,w] coordinate through the setPositionTarget function, and the movement in Rviz does not reflect the desired movement. In my program, I try to create circular motion by changing x, y and keeping z constant, and output the values i send through the function to my console, and the coordinates I send to the function show a circular path, but the visualization in Rviz shows different movement and movement along the z axis. When i click the dropdown for the end effector link I am controlling, it shows different coordinates than what I output to console. I believe there may be a problem with the transforms, or the kinematic solver, but I am not sure. Anything commented out was attempting cartesian path planning, which also does not work due to the discrepancy of the coordinate system Code: int main(int argc, char** argv) { ros::init(argc, argv, "mover_node"); ros::NodeHandle node_handle; ros::AsyncSpinner spinner(1); spinner.start(); bool success; //std::vector waypoints; // Setup static const std::string PLANNING_GROUP = "arm"; moveit::planning_interface::MoveGroupInterface move_group(PLANNING_GROUP); moveit::planning_interface::PlanningSceneInterface planning_scene_interface; const robot_state::JointModelGroup* joint_model_group = move_group.getCurrentState()->getJointModelGroup(PLANNING_GROUP); // Visualization namespace rvt = rviz_visual_tools; moveit_visual_tools::MoveItVisualTools visual_tools("staubli_tx90_robot_link_6"); visual_tools.deleteAllMarkers(); visual_tools.loadRemoteControl(); Eigen::Affine3d text_pose = Eigen::Affine3d::Identity(); text_pose.translation().z() = 1.75; visual_tools.publishText(text_pose, "MoveGroupTX90 Demo", rvt::WHITE, rvt::XLARGE); visual_tools.trigger(); // Getting information ROS_INFO_NAMED("tutorial", "Reference frame: %s", move_group.getPlanningFrame().c_str()); ROS_INFO_NAMED("tutorial", "End effector link: %s", move_group.getEndEffectorLink().c_str()); // Start Demo visual_tools.prompt("Press 'next' in the RvizVisualToolsGui window to start the demo"); move_group.setNamedTarget("candle"); // Ask Rviz to visualize and not move moveit::planning_interface::MoveGroupInterface::Plan my_plan; success = (move_group.plan(my_plan) == moveit::planning_interface::MoveItErrorCode::SUCCESS); move_group.execute(my_plan); double rad = 0.0; double x = 0.0; double y = 0.0; double z = 0.0; std::vector rpy; geometry_msgs::PoseStamped current_poseS; geometry_msgs::Pose current_pose; geometry_msgs::Pose target_pose; current_poseS = move_group.getCurrentPose(move_group.getEndEffectorLink().c_str()); rpy = move_group.getCurrentRPY(move_group.getEndEffectorLink().c_str()); cout << "XYZ position: " << "[" << current_poseS.pose.position.x << ", " << current_poseS.pose.position.y << ", " << current_poseS.pose.position.z << ", " << current_poseS.pose.orientation.w << "]" << "\n"; //current_pose.position.x = 0.0469089; //current_pose.position.y = 0.050004; //current_pose.position.z = 1.42799; //current_pose.orientation.w = 0.999996; //waypoints.push_back(current_pose); //target_pose.position.x = current_pose.position.x; //target_pose.position.y = current_pose.position.y; //target_pose.position.z = current_pose.position.z; /*for(int i = 0; i < 10; i++) { target_pose.position.x = target_pose.position.x + .05; target_pose.position.y = target_pose.position.y; target_pose.position.z = target_pose.position.z; waypoints.push_back(target_pose); cout << "XYZ position: " << "[" << target_pose.position.x << ", " << target_pose.position.y << ", " << target_pose.position.z << ", " << target_pose.orientation.w << "]" << "\n"; }*/ for(double rad = 0.0; rad < 3; rad += 0.01) { x = current_pose.pose.position.x * cos(rad); y = current_pose.pose.position.y * sin(rad); move_group.setPositionTarget(x, y, z, move_group.getEndEffectorLink().c_str()); // first we want to deal with xyz. consider RPY constant. move_group.setRPYTarget(rpy[0], rpy[1], rpy[2], move_group.getEndEffectorLink().c_str()); cout << "XYZ position: " << "[" << x << ", " << y << ", " << z << "]" << "\n"; success = (move_group.plan(my_plan) == moveit::planning_interface::MoveItErrorCode::SUCCESS); move_group.execute(my_plan); } //moveit_msgs::RobotTrajectory trajectory; //const double jump_threshold = 0.0; //const double eef_step = 0.01; //double fraction = move_group.computeCartesianPath(waypoints, eef_step, jump_threshold, trajectory); //ROS_INFO_NAMED("tutorial", "Visualizing plan 4 (Cartesian path) (%.2f%% acheived)", fraction * 100.0); //visual_tools.deleteAllMarkers(); //visual_tools.publishText(text_pose, "Joint Space Goal", rvt::WHITE, rvt::XLARGE); // visual_tools.publishPath(waypoints, rvt::LIME_GREEN, rvt::SMALL); //for (std::size_t i = 0; i < waypoints.size(); ++i) // visual_tools.publishAxisLabeled(waypoints[i], "pt" + std::to_string(i), rvt::SMALL); visual_tools.trigger(); visual_tools.prompt("Press 'next' in the RvizVisualToolsGui window to continue the demo"); //success = (move_group.plan(my_plan) == moveit::planning_interface::MoveItErrorCode::SUCCESS); //move_group.execute(my_plan); ros::shutdown(); return 0; }

Buggy map and using move_base with cartographer

$
0
0
I'm publishing to the `/map` top with `cartographer`, howerver when I visualize my costmap in rviz, I get this: ![image description](/upfiles/15341210988355429.png), which doesn't correspond with the underlying map. I don't get this issue when I'm generating my map with gmapping. Cartographer settings: include "map_builder.lua" include "trajectory_builder.lua" options = { map_builder = MAP_BUILDER, trajectory_builder = TRAJECTORY_BUILDER, map_frame = "map", tracking_frame = "base_link", published_frame = "base_link", odom_frame = "odom", provide_odom_frame = true, publish_frame_projected_to_2d = false, use_odometry = false, use_nav_sat = false, use_landmarks = false, num_laser_scans = 1, num_multi_echo_laser_scans = 0, num_subdivisions_per_laser_scan = 10, num_point_clouds = 0, lookup_transform_timeout_sec = 0.2, submap_publish_period_sec = 0.3, pose_publish_period_sec = 5e-3, trajectory_publish_period_sec = 30e-3, rangefinder_sampling_ratio = 1., odometry_sampling_ratio = 1., fixed_frame_pose_sampling_ratio = 1., imu_sampling_ratio = 1., landmarks_sampling_ratio = 1., } MAP_BUILDER.use_trajectory_builder_2d = true TRAJECTORY_BUILDER_2D.num_accumulated_range_data = 10 For some reason, cartographer is interfering with my /scan topic: ![image description](/upfiles/1534121180585564.png). This is my tf tree: ![image description](/upfiles/15341213093506404.png). Any ideas as to what's going wrong?

any install method of jsk_visualization/jsk_rviz_plugs?

$
0
0
i want to use box boundering (jsk_pkg) but something error occured first error like this at /usr/share/cmake-3.5/Modules/FindPkgConfig.cmake:367 (message): A required package was not found Call Stack (most recent call first): /usr/share/cmake-3.5/Modules/FindPkgConfig.cmake:532 (_pkg_check_modules_internal) pharos_drivers/jsk_recognition-master/imagesift/CMakeLists.txt:27 (pkg_check_modules) then i upload `jsk_3rdparty-master` to driver folder then error occered like this BUILD_SHARED_LIBS is on -- ~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~ -- ~~ traversing 88 packages in topological order: -- ~~ - gps_umd (metapackage) -- ~~ - jsk_3rdparty (metapackage) -- ~~ - jsk_common (metapackage) -- ~~ - jsk_common_msgs (metapackage) -- ~~ - jsk_recognition (metapackage) -- ~~ - jsk_visualization (metapackage) -- ~~ - libcmt (plain cmake) -- ~~ - lpg_planner -- ~~ - pharos (metapackage) -- ~~ - pharos_bringup -- ~~ - pharos_data_logger -- ~~ - pharos_drivers (metapackage) -- ~~ - assimp_devel -- ~~ - ff -- ~~ - ffha -- ~~ - julius -- ~~ - libsiftfast -- ~~ - nlopt -- ~~ - slic (plain cmake) -- ~~ - jsk_footstep_msgs -- ~~ - jsk_hark_msgs -- ~~ - novatel_gps_msgs -- ~~ - jsk_gui_msgs -- ~~ - jsk_recognition_msgs -- ~~ - speech_recognition_msgs -- ~~ - ublox (metapackage) -- ~~ - velodyne (metapackage) -- ~~ - velodyne_msgs -- ~~ - bayesian_belief_networks -- ~~ - cereal_port -- ~~ - multi_gps -- ~~ - pharos_msgs -- ~~ - downward -- ~~ - jsk_tools -- ~~ - julius_ros -- ~~ - gps_common -- ~~ - pgm_learner -- ~~ - posedetection_msgs -- ~~ - rospatlite -- ~~ - rosping -- ~~ - rostwitter -- ~~ - jsk_data -- ~~ - jsk_network_tools -- ~~ - mini_maxwell -- ~~ - opt_camera -- ~~ - ros_speech_recognition -- ~~ - checkerboard_detector -- ~~ - dynamic_tf_publisher -- ~~ - jsk_topic_tools -- ~~ - laser_filters_jsk_patch -- ~~ - laser_geometry2 -- ~~ - multi_map_server -- ~~ - novatel_gps_driver -- ~~ - image_view2 -- ~~ - jsk_rqt_plugins -- ~~ - pharos_laser_taek -- ~~ - pharos_lasers -- ~~ - pharos_localization -- ~~ - pharos_map_server -- ~~ - pharos_mapping -- ~~ - pharos_obstacle_detection -- ~~ - pharos_path_planner -- ~~ - pharos_road_information -- ~~ - pharos_speed_planner -- ~~ - pharos_tf -- ~~ - pharos_trajectory_observer -- ~~ - pharos_vehicle -- ~~ - pharos_waypoint_compensator -- ~~ - jsk_recognition_utils -- ~~ - imagesift -- ~~ - jsk_tilt_laser -- ~~ - resized_image_transport -- ~~ - ublox_serialization -- ~~ - ublox_msgs -- ~~ - ublox_gps -- ~~ - collada_urdf_jsk_patch -- ~~ - jsk_rviz_plugins -- ~~ - jsk_interactive_marker -- ~~ - jsk_interactive -- ~~ - jsk_interactive_test -- ~~ - velodyne_driver -- ~~ - velodyne_laserscan -- ~~ - velodyne_pointcloud -- ~~ - virtual_force_publisher -- ~~ - voice_text -- ~~ - jsk_pcl_ros_utils -- ~~ - jsk_pcl_ros -- ~~ - jsk_perception -- ~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~ CMake Error at /opt/ros/kinetic/share/catkin/cmake/catkin_workspace.cmake:95 (message): This workspace contains non-catkin packages in it, and catkin cannot build a non-homogeneous workspace without isolation. Try the 'catkin_make_isolated' command instead. Call Stack (most recent call first): CMakeLists.txt:63 (catkin_workspace) what should i do? anyone who know install method?

tf::Transform getOrigin returning different value from rviz

$
0
0
Hi there! I'm trying to see the pose and rotation from a UR5 using tf and comparing with rviz and the robot GUI itself. In rviz I get the same result as the GUI, but when I try to listen to the transform and see the values, and the values are different from expected. #include #include //tf #include #include int main(int argc, char** argcv){ ros::init(argc, argcv, "world_to_robot_pose"); tf::StampedTransform transform; static tf::TransformListener listener; while(ros::ok()){ try{ listener.lookupTransform("/tool0_controller","/world",ros::Time(0), transform); ROS_INFO_STREAM(" Transform: " << transform.getOrigin().x() << ", " << transform.getOrigin().y() << ", " <

Urdf displays correcly in urdf-viz but not Rviz and Gazebo

$
0
0
Hello Everyone New to ROS and i'm trying to import a CAD model via simmechanics_to_urdf. If i open the urdf in urdf-viz (https://github.com/OTL/urdf-viz) i get a proper model and can move the joints. However if i open the same urdf and meshes in either Rviz or Gazebo the parts show up in strange positions. (mostly around the origin). Any ideas? Sorry i don't have a better vocabulary to explain the issue. Regards

2D Nav Goal not working in Rviz

$
0
0
I am using a Toyota HSR robot running ubuntu 16.04 and ROS kinetic. I am having issues getting the move_base node to work by sending nav goals in Rviz. When I do `rostopic list | grep move` I see the following topic: /move_base/move/goal. However when I run Rviz, Rviz sends its 2D nav goals to the topic /move_base_simple/goal. I thought about just switching the topic that the 2D Nav goal publishes to but unfortunately the two topics do not have the same message types. /move_base/move/goal is of type move_base_msgs/MoveBaseActionGoal whilst /move_base_simple/goal is of type geometry_msgs/PostStamped. Currently I am thinking of writing a node that subscribes to /move_base_simple/goal and publishes to /move_base/move/goal but I am wondering if there is an easier way to go about this. Thanks for all the help!

Rviz receives LaserScan messages but doesn't display them

$
0
0
Hi there I made a dummy package that is publishing fake laser scan messages (following this code: http://wiki.ros.org/navigation/Tutorials/RobotSetup/Sensors#Writing_Code_to_Publish_a_LaserScan_Message ). I use this command to launch my package: roslaunch beginner_tutorials fakeLaserScan.launch Then, I try to display it with: rosrun rviz rviz Finally, I use this command in order to avoid fixed-frame related errors,: rosrun tf static_transform_publisher 0 0 0 0 0 0 1 map fake_laser_frame 10 I set global_frame as "fake_laser_frame" and I add the topic /fakeScan (type LaserScan). Everything seems to work great, only green checks and I can see the number of receives messages increase. But I don't see my laser scan displayed ! I tried with a kinect and package "laserscan_kinect", it works. What am I missing ? More info: What I'm trying to do : for the moment, juste learning really. My final is goal to use a Lidar Lite v3 to generate Laser Scan messages. My code: https://github.com/erenaud3/fakeLaserScan Screenshot: (I tried, but not enough reputation).

error while trying to install ifm3d camera

$
0
0
ifm3d is a 3d camera for more details click on the link: https://github.com/lovepark/ifm3d When I run catkin_make_isolated I get these errors: e/nvidia/catkin_ws/build_isolated/ifm3d' -- ifm3d found component: camera -- ifm3d found component: framegrabber CMake Warning at /usr/lib/cmake/ifm3d-0.9.0/ifm3d-config.cmake:44 (message): ifm3d could not find component: image Call Stack (most recent call first): CMakeLists.txt:4 (find_package) CMake Error at CMakeLists.txt:4 (find_package): Found package configuration file: /usr/lib/cmake/ifm3d-0.9.0/ifm3d-config.cmake but it set ifm3d_FOUND to FALSE so package "ifm3d" is considered to be NOT FOUND. -- Configuring incomplete, errors occurred! See also "/home/nvidia/catkin_ws/build_isolated/ifm3d/CMakeFiles/CMakeOutput.log". <== Failed to process package 'ifm3d': Command '['/home/nvidia/catkin_ws/devel_isolated/gpio_control/env.sh', 'cmake', '/home/nvidia/catkin_ws/src/ifm3d-ros', '-DCATKIN_DEVEL_PREFIX=/home/nvidia/catkin_ws/devel_isolated/ifm3d', '-DCMAKE_INSTALL_PREFIX=/home/nvidia/catkin_ws/install_isolated', '-G', 'Unix Makefiles']' returned non-zero exit status 1 Reproduce this error by running: ==> cd /home/nvidia/catkin_ws/build_isolated/ifm3d && /home/nvidia/catkin_ws/devel_isolated/gpio_control/env.sh cmake /home/nvidia/catkin_ws/src/ifm3d-ros -DCATKIN_DEVEL_PREFIX=/home/nvidia/catkin_ws/devel_isolated/ifm3d -DCMAKE_INSTALL_PREFIX=/home/nvidia/catkin_ws/install_isolated -G 'Unix Makefiles' Command failed, exiting. catkin_make_isolated 44,82s user 24,52s system 140% cpu 49,351 total And in ~/dev/ifm3d/build I'm running make check and get these errors [ RUN ] Image.MoveCtor unknown file: Failure C++ exception with description "Lib: XMLRPC Timeout - can you ping' the sensor?" thrown in the test body. [ FAILED ] Image.MoveCtor (1035 ms) [ RUN ] Image.MoveAssignmentOperator unknown file: Failure C++ exception with description "Lib: XMLRPC Timeout - can youping' the sensor?" thrown in the test body. [ FAILED ] Image.MoveAssignmentOperator (2032 ms) [ RUN ] Image.CopyCtor unknown file: Failure C++ exception with description "Lib: XMLRPC Timeout - can you ping' the sensor?" thrown in the test body. [ FAILED ] Image.CopyCtor (2022 ms) [ RUN ] Image.CopyAssignmentOperator unknown file: Failure C++ exception with description "Lib: XMLRPC Timeout - can youping' the sensor?" thrown in the test body. [ FAILED ] Image.CopyAssignmentOperator (2037 ms) [ RUN ] Image.References unknown file: Failure C++ exception with description "Lib: XMLRPC Timeout - can you ping' the sensor?" thrown in the test body. [ FAILED ] Image.References (2031 ms) [ RUN ] Image.CloudMechanics unknown file: Failure C++ exception with description "Lib: XMLRPC Timeout - can youping' the sensor?" thrown in the test body. [ FAILED ] Image.CloudMechanics (2025 ms) [ RUN ] Image.XYZImage unknown file: Failure C++ exception with description "Lib: XMLRPC Timeout - can you ping' the sensor?" thrown in the test body. [ FAILED ] Image.XYZImage (2026 ms) [ RUN ] Image.ComputeCartesian unknown file: Failure C++ exception with description "Lib: XMLRPC Timeout - can youping' the sensor?" thrown in the test body. [ FAILED ] Image.ComputeCartesian (2034 ms) [ RUN ] Image.TimeStamp unknown file: Failure C++ exception with description "Lib: XMLRPC Timeout - can you ping' the sensor?" thrown in the test body. [ FAILED ] Image.TimeStamp (1019 ms) [ RUN ] Image.IlluTemp unknown file: Failure C++ exception with description "Lib: XMLRPC Timeout - can youping' the sensor?" thrown in the test body. [ FAILED ] Image.IlluTemp (1017 ms) [----------] 10 tests from Image (17281 ms total) [----------] Global test environment tear-down [==========] 10 tests from 1 test case ran. (17281 ms total) [ PASSED ] 0 tests. [ FAILED ] 10 tests, listed below: [ FAILED ] Image.MoveCtor [ FAILED ] Image.MoveAssignmentOperator [ FAILED ] Image.CopyCtor [ FAILED ] Image.CopyAssignmentOperator [ FAILED ] Image.References [ FAILED ] Image.CloudMechanics [ FAILED ] Image.XYZImage [ FAILED ] Image.ComputeCartesian [ FAILED ] Image.TimeStamp [ FAILED ] Image.IlluTemp 10 FAILED TESTS modules/image/test/CMakeFiles/check_image.dir/build.make:57: recipe for target 'modules/image/test/CMakeFiles/check_image' failed make[3]: *** [modules/image/test/CMakeFiles/check_image] Error 1 CMakeFiles/Makefile2:751: recipe for target 'modules/image/test/CMakeFiles/check_image.dir/all' failed make[2]: *** [modules/image/test/CMakeFiles/check_image.dir/all] Error 2 CMakeFiles/Makefile2:76: recipe for target 'CMakeFiles/check.dir/rule' failed make[1]: *** [CMakeFiles/check.dir/rule] Error 2 Makefile:184: recipe for target 'check' failed make: *** [check] Error 2 Do you guys understand my problem?

How can I visualize magnetometer data in Rviz?

$
0
0
Hi, I am using a magnetometer plugin (libuuv_gazebo_ros_magnetometer_plugin.so) from UUV Simulator in Gazebo and it delivers sensor_msgs/MagneticField messages. In order to see if it is working (well, I've already echoed the topic and it is indeed working), but I would like to have a way to visualize it in Rviz so that the data is easily understandable. A general view of what I wanted to do is to provide a way for the robot to know the North direction and I am assuming using the magnetometer is the best way to do that. Opinions are welcome.
Viewing all 1404 articles
Browse latest View live


<script src="https://jsc.adskeeper.com/r/s/rssing.com.1596347.js" async> </script>