-
 

Package Summary

Tags No category tags.
Version 1.13.1
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/common_msgs.git
VCS Type git
VCS Version noetic-devel
Last Updated 2021-01-11
Dev Status MAINTAINED
CI status
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

This package defines messages for commonly used sensors, including cameras and scanning laser rangefinders.

Additional Links

Maintainers

  • Michel Hidalgo

Authors

  • Tully Foote
README
No README found. No README in repository either.
CHANGELOG

Changelog for package sensor_msgs

1.13.1 (2021-01-11)

  • Update package maintainers (#168)
  • Contributors: Michel Hidalgo

1.13.0 (2020-05-21)

  • Update BatteryState.msg (#140)
  • Use setuptools instead of distutils (#159)
  • Bump CMake version to avoid CMP0048 warning (#158)
  • Fix TabError: inconsistent use of tabs and spaces in indentation (#155) * Fix TabError: inconsistent use of tabs and spaces in indentation Python 3 is much more strict for spacing.

  • Contributors: Ramon Wijnands, Rein Appeldoorn, Shane Loretz

1.12.7 (2018-11-06)

  • Include sstream on header that needs i (#131)
  • included missing import for the read_points_list method (#128)
    • included missing import for the read_points_list method
  • Merge pull request #127 from ros-1/fix-typos
  • Merge pull request #85 from ros/missing_test_target_dependency fix missing test target dependency
  • Contributors: Dirk Thomas, Jasper, Kuang Fangjun, Tully Foote, chapulina

1.12.6 (2018-05-03)

  • Return default value to prevent missing return warning.
  • Add function to convert PointCloud2 to namedtuples Add new function read_points_list that converts a PointCloud2 to a list of named tuples. It works on top of read_points, which generates lists containing the values. In consequence read_points_list is slower than read_points.
  • Added equidistant distortion model const
  • Added test_depend on rosunit in sensor_msgs
  • fix catkin_lint warnings
  • add mingration rule, copied from common_msgs-1.6
  • Add missing include for atoi. Fixes #97
  • Contributors: 2scholz, Adam Allevato, Ivor Wanders, Kei Okada, Tully Foote, alexzzhu

1.12.5 (2016-09-30)

  • Deal with abstract image encodings
  • Fix spelling mistakes
  • Fix year
  • Contributors: Jochen Sprickerhof, Kentaro Wada, trorornmn

1.12.4 (2016-02-22)

  • added type mapping and support for different types of points in point clouds
  • remove boost dependency fixes #81
  • adding a BatteryState message
  • fix iterator doc
  • remove warning due to anonymous namespace
  • Contributors: Sebastian Pütz, Tully Foote, Vincent Rabaud

1.12.3 (2015-04-20)

1.12.2 (2015-03-21)

1.12.1 (2015-03-17)

1.12.0 (2014-12-29)

1.11.6 (2014-11-04)

  • Fix compilation with Clang
  • Contributors: jmtatsch

1.11.5 (2014-10-27)

  • add a test for the operator+ fix The behavior of that operator also had to be fixed to return a proper child class
  • fix critical bug with operator+
  • Contributors: Michael Ferguson, Vincent Rabaud

1.11.4 (2014-06-19)

  • Fix bug caused by use of va_arg in argument list.
  • Contributors: Daniel Maturana

1.11.3 (2014-05-07)

  • clean up documentation of sensor_msgs so that wiki generated doxygen is readable
  • Export architecture_independent flag in package.xml
  • Contributors: Michael Ferguson, Scott K Logan

1.11.2 (2014-04-24)

1.11.1 (2014-04-16)

  • fix missing include dirs for tests
  • Contributors: Dirk Thomas

1.11.0 (2014-03-04)

  • add a PointCloud2 iterator and modifier
  • Contributors: Tully Foote, Vincent Rabaud

1.10.6 (2014-02-27)

1.10.5 (2014-02-25)

1.10.4 (2014-02-18)

  • Fix roslib import for message module, remove roslib.load_manifest
  • Contributors: Bence Magyar

1.10.3 (2014-01-07)

  • python 3 compatibility
  • line wrap Imu.msg comments

1.10.2 (2013-08-19)

  • adding __init__.py #11

1.10.1 (2013-08-16)

  • setup.py for #11
  • adding installation of point_cloud2.py to sensor_msgs fixes #11

1.10.0 (2013-07-13)

  • adding MultiDOFJointState message

1.9.16 (2013-05-21)

  • update email in package.xml

1.9.15 (2013-03-08)

1.9.14 (2013-01-19)

1.9.13 (2013-01-13)

  • YUV422 actually has an 8 bit depth

1.9.12 (2013-01-02)

  • do not consider YUV422 to be a color anymore
  • added missing license header

1.9.11 (2012-12-17)

  • modified dep type of catkin

1.9.10 (2012-12-13)

  • add missing downstream depend
  • switched from langs to message* packages

1.9.9 (2012-11-22)

  • Added Low-Cost/Android Sensors reviewed messages
  • Updated comments to reflect REP 117 for fixed-distance rangers
  • Adding reviewed MultiEchoLaserScan message.

1.9.8 (2012-11-14)

1.9.7 (2012-10-30)

  • fix catkin function order

1.9.6 (2012-10-18)

  • updated cmake min version to 2.8.3, use cmake_parse_arguments instead of custom macro
  • fix the bad number of channels for YUV422 UYVY

1.9.5 (2012-09-28)

  • fixed missing find genmsg

1.9.4 (2012-09-27 18:06)

1.9.3 (2012-09-27 17:39)

  • cleanup
  • add precision about YUV422
  • add YUV422 to some functions
  • cleaned up package.xml files
  • updated to latest catkin
  • fixed dependencies and more
  • updated to latest catkin: created package.xmls, updated CmakeLists.txt

1.9.2 (2012-09-05)

  • updated pkg-config in manifest.xml
  • updated catkin variables

1.9.1 (2012-09-04)

  • use install destination variables, removed manual installation of manifests

1.9.0 (2012-08-29)

  • update the docs

1.8.13 (2012-07-26 18:34:15 +0000)

  • made inline functions static inline
  • fix ODR violation and missing headers
  • moved c++ code from sensor_msgs to headers

1.8.8 (2012-06-12 22:36)

  • simplifying deps
  • make find_package REQUIRED
  • removed obsolete catkin tag from manifest files
  • fixed package dependency for another common message (#3956), removed unnecessary package name from another message
  • fixed package dependencies for several common messages (fixed #3956)
  • clarify NavSatFix message comments
  • normalize shared lib building, #3838
  • adding TimeReference to build
  • TimeReference decl was invalid
  • adding point_cloud2 as reviewed at http://ros.org/wiki/sensor_msgs/Reviews/Python%20PointCloud2%20_API_Review
  • TimeReference msg as reviewed #ros-pkg5355
  • install headers
  • adding manifest exports
  • fix boost-finding stuff
  • removed depend, added catkin
  • adding roscpp_core dependencies
  • stripping depend and export tags from common_msgs manifests as msg dependencies are now declared in cmake and stack.yaml. Also removed bag migration exports
  • install-related fixes
  • common_msgs: removing migration rules as all are over a year old
  • sensor_msgs: removing old octave support now that rosoct is gone
  • bye bye vestigial MSG_DIRS
  • sensor_msgs: getting rid of other build files
  • adios rosbuild2 in manifest.xml
  • catkin updates
  • catkin_project
  • Updated to work with new message generation macros
  • adios debian/ hello stack.yaml. (sketch/prototype/testing).
  • More tweaking for standalone message generation
  • Getting standalone message generation working... w/o munging rosbuild2
  • more rosbuild2 hacking
  • rosbuild2 tweaks
  • missing dependencies
  • sensor_msgs: Added YUV422 image encoding constant.
  • adding in explicit ros/console.h include for ros macros now that ros::Message base class is gone
  • adding JoyFeedback and JoyFeedbackArray
  • updating manifest.xml
  • adding Joy.msg
  • Add image encodings for 16-bit Bayer, RGB, and BGR formats. Update isMono(), isAlpha(), isBayer(), etc.
  • rosbuild2 taking shape
  • sensor_msgs: Source-compatible corrections to fillImage signature.
  • sensor_msgs: Functions for distinguishing categories of encodings. From cv_bridge redesign API review.
  • applying patch to this method like josh did in r33966 in rviz
  • sensor_msgs (rep0104): Migration rules for CameraInfo, RegionOfInterest.
  • sensor_msgs (rep0104): Doc improvements for CameraInfo.
  • sensor_msgs (rep0104): Cleaned up PointCloud2 msg docs. Restored original meaning of 'no invalid points' to is_dense (#4446).
  • sensor_msgs (rep0104): Documented u,v channel semantics for PointCloud msg (#4482).
  • sensor_msgs (rep0104): Added distortion model string constants.
  • sensor_msgs (rep0104): Include guard for image_encodings.h.
  • sensor_msgs (rep0104): Applied changes to CameraInfo and RegionOfInterest messages.
  • Clarify frame of reference for NavSatFix position covariance.
  • Add new satellite navigation messages approved by GPS API review.
  • adding Range message as reviewed #4488
  • adding missing file
  • cleaner fix for point_cloud_conversion definitions for #4451
  • inlining implementation in header for #4451
  • sensor_msgs: Fixed URL in CameraInfo.msg and indicated how to mark an uncalibrated camera. #4105
  • removing all the extra exports
  • add units to message description
  • bug fix in PC->PC2 conversion
  • include guards for point_cloud_conversions.h #4285
  • Added Ubuntu platform tags to manifest
  • added PointCloud2<->PointCloud conversion routines.
  • Updating link to camera calibration
  • updating message as per review http://www.ros.org/wiki/sensor_msgs/Reviews/2010-03-01%20PointCloud2_API_Review
  • sensor_msgs: Added size (number of elements for arrays) to PointField.
  • pushing the new PointCloud structure in trunk
  • Changed wording of angle convention for the LaserScan message. We are now specifying how angles are measured, not which way the laser spins.
  • Remove use of deprecated rosbuild macros
  • Added exporting of generated srv includes.
  • Added call to gen_srv now that there is a service.
  • Added the SetCameraInfo service.
  • octave image parsing function now handles all possible image format types
  • changing review status
  • adding JointState documentation ticket:3006
  • Typo in comments
  • updated parsing routines for octave
  • Adding 1 more rule for migration point clouds and bringing test_common_msgs back from future.
  • Adding JointState migration rule.
  • replace pr2_mechanism_msgs::JointStates by new non-pr2-specific sensor_msgs::JointState. Door test passes
  • better documentation of the CameraInfo message
  • updated url
  • sensor_msgs: Added rule to migrate from old laser_scan/LaserScan.
  • sensor_msgs: Added string constants for bayer encodings.
  • clearing API reviews for they've been through a bunch of them recently.
  • Removed the Timestamp message.
  • Updating migration rules to better support the intermediate Image message that existed.
  • comments for sensor_msgs
  • Adding a CompressedImage migration rule.
  • Fixing robot_msgs references
  • Changing the ordering of fields within the new image message so that all meta information comes before the data block.
  • Migration of RawStereo message.
  • Migration rule for CameraInfo.
  • First cut at migration rules for images.
  • Moving stereo messages out of sensor_msgs to stereo/stereo_msgs
  • Getting rid of PixelEncoding since it is encompassed in Image message instead.
  • update to IMU message comments and defined semantics for covariance
  • Changing naming of bag migration rules.
  • Image message and CvBridge change
  • moving FillImage.h to fill_image.h for Jeremy
  • Adding image_encodings header/cpp, since genmsg_cpp doesn't actually support constant string values
  • fixing spelling
  • Message documentation
  • Switching IMU to sensor_msgs/Imu related to #2277
  • adding IMU msg
  • Took out event_type field, as that would indeed make it more than a timestamp.
  • adding OpenCV doc comment
  • Rename rows,cols to height,width in Image message
  • Adding more migration rule tests and fixing assorted rules.
  • Added a timestamp message. (Will be used to track camera and perhaps some day hokuyo trigger times.)
  • sensor_msgs: Updates to CameraInfo, added pixel encoding and ROI.
  • New sensor_msgs::Image message
  • PointCloud:
    • pts -> points

    * chan -> channels ChannelFloat32:

    • vals -> values
  • sensor_msgs: Added explanation of reprojection matrix to StereoInfo.
  • sensor_msgs: Cleaned up CompressedImage. Updated image_publisher. Blacklisted jpeg.
  • merging in the changes to messages see ros-users email. THis is about half the common_msgs API changes
  • sensor_msgs: Comments to better describe CameraInfo and StereoInfo.
  • Renamed CamInfo message to CameraInfo.
  • sensor_msgs_processImage can now process empty images
    • update openrave and sensor_msgs octave scripts
  • Image from image_msgs -> sensor_msgs #1661
  • updating review status
  • moving LaserScan from laser_scan package to sensor_msgs package #1254
  • populating common_msgs

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Dependant Packages

Name Deps
ainstein_radar_tools
apriltag_ros
arbotix_python
aruco_ros
arm
comms_bridge
ff_hw_msgs
ff_msgs
epson_imu
handrail_detect
interest_point
localization_node
marker_tracking
vive_localization
msg_conversions
astrobee_gazebo
autoware_msgs
auv_msgs
avt_vimba_camera
axis_camera
basler_tof
rokubimini
rokubimini_description
rokubimini_msgs
calibration_estimation
calibration_msgs
image_cb_detector
cob_monitoring
cob_teleop
cob_frame_tracker
cob_hardware_emulation
cob_mecanum_controller
cob_model_identifier
cob_obstacle_distance
cob_omni_drive_controller
cob_trajectory_controller
cob_twist_controller
cob_base_drive_chain
cob_bms_driver
cob_light
cob_phidgets
cob_scan_unifier
cob_sick_lms1xx
cob_sick_s300
laser_scan_densifier
cob_hand_bridge
cob_grasp_generation
cob_lookat_action
cob_map_accessibility_analysis
cob_3d_mapping_msgs
cob_cam3d_throttle
cob_image_flip
cob_object_detection_msgs
cob_object_detection_visualizer
cob_perception_msgs
ipa_3d_fov_visualization
codec_image_transport
common_msgs
stereo_msgs
points_preprocessor
cras_imu_tools
cras_laser_geometry
cras_msgs
cras_cpp_common
image_transport_codecs
create_driver
criutils
cv_camera
dbw_fca_can
dbw_fca_joystick_demo
dbw_mkz_can
dbw_mkz_joystick_demo
dbw_polaris_can
dbw_polaris_joystick_demo
depthai_bridge
depthai_examples
depthai_filters
depthai_ros_driver
depthai_ros_msgs
depthimage_to_laserscan
dynamic_robot_state_publisher
dynamixel_workbench_controllers
dynamixel_workbench_operators
dynamixel_interface
ensenso_camera
ensenso_camera_msgs
ess_imu_ros1_uart_driver
exotica_examples
fetch_open_auto_dock
fetch_drivers
fetch_bringup
fetch_depth_layer
fetch_teleop
aruco_detect
fiducial_msgs
fiducial_slam
stag_detect
find_object_2d
fkie_message_filters
floam
franka_control
franka_gazebo
franka_gripper
franka_visualization
fuse_models
fuse_tutorials
gazebo_msgs
gazebo_plugins
geodesy
tf
tf2_sensor_msgs
gps_common
gpsd_client
graft
grasping_msgs
grid_map_demos
grid_map_ros
grid_map_visualization
haf_grasping
hector_pose_estimation
hector_pose_estimation_core
message_to_tf
hector_compressed_map_transport
hector_imu_attitude_to_tf
hector_imu_tools
hfl_driver
hls_lfcd_lds_driver
hokuyo3d
hri_msgs
ifm3d_ros_driver
camera_calibration_parsers
camera_info_manager
image_transport
polled_camera
camera_calibration
depth_image_proc
image_proc
image_publisher
image_view
stereo_image_proc
imagezero_image_transport
imagezero_ros
imu_processors
imu_transformer
imu_complementary_filter
imu_filter_madgwick
industrial_robot_client
industrial_robot_simulator
innopolis_vtol_dynamics
ira_laser_tools
ixblue_ins_driver
drone_wrapper
rotors_driver
rqt_drone_teleop
rqt_ground_robot_teleop
tello_driver
joint_state_publisher
joy
spacenav_node
wiimote
influxdb_store
opt_camera
zdepth_image_transport
audio_video_recorder
jsk_network_tools
image_view2
jsk_rosbag_tools
jsk_tilt_laser
jsk_topic_tools
virtual_force_publisher
jsk_gui_msgs
posedetection_msgs
eus_teleop
joy_mouse
jsk_footstep_controller
pr2eus_openrave
audio_to_spectrogram
checkerboard_detector
imagesift
jsk_pcl_ros
jsk_pcl_ros_utils
jsk_perception
jsk_recognition_msgs
jsk_recognition_utils
resized_image_transport
sound_classification
roseus
jsk_interactive_marker
kvh_geo_fog_3d_driver
laser_assembler
map_laser
laser_filters
laser_geometry
laser_proc
leo_bringup
leo_fw
lgsvl_msgs
hri
libuvc_camera
laptop_battery_monitor
lms1xx
lsc_ros_driver
lsm_localization
mapviz_plugins
swri_transform_util
marti_nav_msgs
marti_perception_msgs
marti_visualization_msgs
mavros
mavros_extras
mavros_msgs
mcl_3dl
microstrain_3dmgx2_imu
microstrain_inertial_driver
mir_driver
mir_dwb_critics
mobile_robot_simulator
move_basic
moveit_commander
moveit_core
moveit_servo
moveit_ros_perception
moveit_msgs
movie_publisher
mrpt_msgs
mrpt_local_obstacles
mrpt_localization
mrpt_rawlog
mrpt_sensorlib
mrpt_ekf_slam_2d
mrpt_ekf_slam_3d
mrpt_graphslam_2d
mrpt_icp_slam_2d
mrpt_rbpf_slam
multi_object_tracking_lidar
multisense_ros
mvsim
naoqi_bridge_msgs
naoqi_driver
amcl
base_local_planner
costmap_2d
dwa_local_planner
navfn
nav2d_localizer
nav2d_msgs
nav2d_operator
nav2d_remote
assisted_teleop
map_msgs
nearfield_map
costmap_cspace
joystick_interrupt
map_organizer
obj_to_pointcloud
planner_cspace
safety_limiter
track_odometry
nerian_stereo
nmea_navsat_driver
nonpersistent_voxel_layer
novatel_gps_driver
novatel_oem7_driver
ntpd_driver
object_recognition_msgs
octomap_server
octomap_pa
octomap_pa_msgs
octomap_ros
omron_os32c_driver
ov_core
ov_eval
ov_msckf
opencv_apps
openni2_camera
openni_camera
openzen_sensor
outsight_alb_driver
oxford_gps_eth
p2os_teleop
p2os_urdf
pcdfilter_pa
pcl_msgs
face_detector
leg_detector
people_tracking_filter
pcl_conversions
pcl_ros
pf_driver
phidgets_accelerometer
phidgets_gyroscope
phidgets_high_speed_encoder
phidgets_magnetometer
phidgets_spatial
pilz_testutils
prbt_hardware_support
prbt_support
pincher_arm_bringup
point_cloud_color
point_cloud_transport
draco_point_cloud_transport
pointcloud_to_laserscan
pointgrey_camera_driver
wfov_camera_msgs
pose_cov_ops
pr2_teleop_general
pr2_common_action_msgs
pr2_tilt_laser_interface
pr2_head_action
pr2_controller_manager
laser_tilt_controller_filter
pr2_navigation_perception
pr2_navigation_self_filter
imu_monitor
joint_qualification_controllers
pr2_gazebo_plugins
prosilica_camera
psen_scan_v2
py_trees_ros
qb_chain_controllers
quanergy_client_ros
radar_pa
raptor_dbw_can
raptor_dbw_joystick_demo
raptor_dbw_joystick_speed_demo
razor_imu_9dof
rc_genicam_camera
rc_genicam_driver
rc_visard_driver
remote_rosbag_record
robot_body_filter
robot_calibration
robot_calibration_msgs
robot_controllers
robot_localization
dwb_critics
dwb_local_planner
robot_pose_ekf
robot_self_filter
robot_state_publisher
ros_control_boilerplate
effort_controllers
imu_sensor_controller
joint_state_controller
ros_numpy
rosbridge_library
rospilot
rosserial_windows
rplidar_ros
rqt_bag_plugins
rqt_ez_publisher
rqt_image_view
rqt_moveit
rt_usb_9axisimu_driver
rtabmap_conversions
rtabmap_msgs
rtabmap_odom
rtabmap_rviz_plugins
rtabmap_slam
rtabmap_sync
rtabmap_util
rviz
rviz_satellite
rviz_visual_tools
sbg_driver
laser_ortho_projector
laser_scan_matcher
laser_scan_sparsifier
laser_scan_splitter
ncd_parser
polar_scan_matcher
schunk_powercube_chain
schunk_sdh
sciurus17_examples
sciurus17_msgs
sciurus17_vision
sensor_filters
septentrio_gnss_driver
sick_ldmrs_driver
sick_safetyscanners
sick_scan
sick_tim
simple_grasping
slam_karto
slam_toolbox
spatio_temporal_voxel_layer
stag_ros
stage_ros
joy_teleop
teleop_twist_joy
turtlebot3_bringup
turtlebot3_example
turtlebot3_slam
turtlebot3_fake
turtlebot3_gazebo
tuw_gazebo_msgs
uavcan_communicator
ublox_msgs
ueye_cam
um6
um7
ur_robot_driver
urg_node
urg_stamped
usb_cam
usb_cam_controllers
velo2cam_calibration
velodyne_gazebo_plugin
velodyne_laserscan
velodyne_pointcloud
velodyne_gazebo_plugins
video_stream_opencv
vision_msgs
cv_bridge
image_geometry
visp_auto_tracker
visp_bridge
visp_camera_calibration
visp_hand2eye_calibration
visp_tracker
visp_ros
rwt_moveit
vl53l1x
volta_teleoperator
webots_ros
wge100_camera
witmotion_ros
joy_listener
xpp_msgs
xv_11_laser_driver
ypspur_ros
darknet_ros
darknet_ros_msgs
dnn_detect
spinnaker_camera_driver
ipcamera_driver
oled_display_node
camera_aravis
cmvision
clober_simulation
clpe_ros
bosch_locator_bridge
massrobotics_amr_sender
ros_ign_bridge
ros_ign_image
ros_ign_point_cloud
adi_3dtof_image_stitching
astra_ros
beluga_ros
clearpath_localization_msgs
clearpath_logger_msgs
clearpath_onav_api_examples_lib
cob_fiducials
magnetometer_compass
cras_joy_tools
diffbot_base
diffbot_control
electronic_io
ergodic_exploration
ess_imu_driver
fields2cover_ros
flatland_plugins
gazebo_set_joint_positions_plugin
gmcl
gnss_info
imu_from_ios_sensorlog
iotbot
l3cam_ros
leo_example_line_follower
leo_example_object_detection
message_tf_frame_transformer
mia_hand_description
mitch_v2_driver
moveit_calibration_plugins
mrpt_apps
mrpt_libros_bridge
muse_v2_driver
nicla_vision_ros
point_cloud2_filters
pyhri
quori_arm_controller
quori_face
quori_teleop
reach_ros
rm_referee
rm_orientation_controller
sick_safevisionary_driver
sick_scan_xd
sick_visionary_ros
turtlebot3_autorace_camera
turtlebot3_autorace_detect
turtlebot3_autorace_driving
xsens_mti_driver

Recent questions tagged sensor_msgs at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 1.12.8
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/common_msgs.git
VCS Type git
VCS Version jade-devel
Last Updated 2021-01-12
Dev Status MAINTAINED
CI status Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

This package defines messages for commonly used sensors, including cameras and scanning laser rangefinders.

Additional Links

Maintainers

  • Michel Hidalgo

Authors

  • Tully Foote
README
No README found. No README in repository either.
CHANGELOG

Changelog for package sensor_msgs

1.12.8 (2021-01-12)

  • Update package maintainers (#170)
  • Use setuptools instead of distutils (#159)
  • Bump CMake version to avoid CMP0048 warning (#158)
  • Fix TabError: inconsistent use of tabs and spaces in indentation (#155)
  • Contributors: Michel Hidalgo, Ramon Wijnands, Shane Loretz

1.12.7 (2018-11-06)

  • Include sstream on header that needs i (#131)
  • included missing import for the read_points_list method (#128)
    • included missing import for the read_points_list method
  • Merge pull request #127 from ros-1/fix-typos
  • Merge pull request #85 from ros/missing_test_target_dependency fix missing test target dependency
  • Contributors: Dirk Thomas, Jasper, Kuang Fangjun, Tully Foote, chapulina

1.12.6 (2018-05-03)

  • Return default value to prevent missing return warning.
  • Add function to convert PointCloud2 to namedtuples Add new function read_points_list that converts a PointCloud2 to a list of named tuples. It works on top of read_points, which generates lists containing the values. In consequence read_points_list is slower than read_points.
  • Added equidistant distortion model const
  • Added test_depend on rosunit in sensor_msgs
  • fix catkin_lint warnings
  • add mingration rule, copied from common_msgs-1.6
  • Add missing include for atoi. Fixes #97
  • Contributors: 2scholz, Adam Allevato, Ivor Wanders, Kei Okada, Tully Foote, alexzzhu

1.12.5 (2016-09-30)

  • Deal with abstract image encodings
  • Fix spelling mistakes
  • Fix year
  • Contributors: Jochen Sprickerhof, Kentaro Wada, trorornmn

1.12.4 (2016-02-22)

  • added type mapping and support for different types of points in point clouds
  • remove boost dependency fixes #81
  • adding a BatteryState message
  • fix iterator doc
  • remove warning due to anonymous namespace
  • Contributors: Sebastian Pütz, Tully Foote, Vincent Rabaud

1.12.3 (2015-04-20)

1.12.2 (2015-03-21)

1.12.1 (2015-03-17)

1.12.0 (2014-12-29)

1.11.6 (2014-11-04)

  • Fix compilation with Clang
  • Contributors: jmtatsch

1.11.5 (2014-10-27)

  • add a test for the operator+ fix The behavior of that operator also had to be fixed to return a proper child class
  • fix critical bug with operator+
  • Contributors: Michael Ferguson, Vincent Rabaud

1.11.4 (2014-06-19)

  • Fix bug caused by use of va_arg in argument list.
  • Contributors: Daniel Maturana

1.11.3 (2014-05-07)

  • clean up documentation of sensor_msgs so that wiki generated doxygen is readable
  • Export architecture_independent flag in package.xml
  • Contributors: Michael Ferguson, Scott K Logan

1.11.2 (2014-04-24)

1.11.1 (2014-04-16)

  • fix missing include dirs for tests
  • Contributors: Dirk Thomas

1.11.0 (2014-03-04)

  • add a PointCloud2 iterator and modifier
  • Contributors: Tully Foote, Vincent Rabaud

1.10.6 (2014-02-27)

1.10.5 (2014-02-25)

1.10.4 (2014-02-18)

  • Fix roslib import for message module, remove roslib.load_manifest
  • Contributors: Bence Magyar

1.10.3 (2014-01-07)

  • python 3 compatibility
  • line wrap Imu.msg comments

1.10.2 (2013-08-19)

  • adding __init__.py #11

1.10.1 (2013-08-16)

  • setup.py for #11
  • adding installation of point_cloud2.py to sensor_msgs fixes #11

1.10.0 (2013-07-13)

  • adding MultiDOFJointState message

1.9.16 (2013-05-21)

  • update email in package.xml

1.9.15 (2013-03-08)

1.9.14 (2013-01-19)

1.9.13 (2013-01-13)

  • YUV422 actually has an 8 bit depth

1.9.12 (2013-01-02)

  • do not consider YUV422 to be a color anymore
  • added missing license header

1.9.11 (2012-12-17)

  • modified dep type of catkin

1.9.10 (2012-12-13)

  • add missing downstream depend
  • switched from langs to message* packages

1.9.9 (2012-11-22)

  • Added Low-Cost/Android Sensors reviewed messages
  • Updated comments to reflect REP 117 for fixed-distance rangers
  • Adding reviewed MultiEchoLaserScan message.

1.9.8 (2012-11-14)

1.9.7 (2012-10-30)

  • fix catkin function order

1.9.6 (2012-10-18)

  • updated cmake min version to 2.8.3, use cmake_parse_arguments instead of custom macro
  • fix the bad number of channels for YUV422 UYVY

1.9.5 (2012-09-28)

  • fixed missing find genmsg

1.9.4 (2012-09-27 18:06)

1.9.3 (2012-09-27 17:39)

  • cleanup
  • add precision about YUV422
  • add YUV422 to some functions
  • cleaned up package.xml files
  • updated to latest catkin
  • fixed dependencies and more
  • updated to latest catkin: created package.xmls, updated CmakeLists.txt

1.9.2 (2012-09-05)

  • updated pkg-config in manifest.xml
  • updated catkin variables

1.9.1 (2012-09-04)

  • use install destination variables, removed manual installation of manifests

1.9.0 (2012-08-29)

  • update the docs

1.8.13 (2012-07-26 18:34:15 +0000)

  • made inline functions static inline
  • fix ODR violation and missing headers
  • moved c++ code from sensor_msgs to headers

1.8.8 (2012-06-12 22:36)

  • simplifying deps
  • make find_package REQUIRED
  • removed obsolete catkin tag from manifest files
  • fixed package dependency for another common message (#3956), removed unnecessary package name from another message
  • fixed package dependencies for several common messages (fixed #3956)
  • clarify NavSatFix message comments
  • normalize shared lib building, #3838
  • adding TimeReference to build
  • TimeReference decl was invalid
  • adding point_cloud2 as reviewed at http://ros.org/wiki/sensor_msgs/Reviews/Python%20PointCloud2%20_API_Review
  • TimeReference msg as reviewed #ros-pkg5355
  • install headers
  • adding manifest exports
  • fix boost-finding stuff
  • removed depend, added catkin
  • adding roscpp_core dependencies
  • stripping depend and export tags from common_msgs manifests as msg dependencies are now declared in cmake and stack.yaml. Also removed bag migration exports
  • install-related fixes
  • common_msgs: removing migration rules as all are over a year old
  • sensor_msgs: removing old octave support now that rosoct is gone
  • bye bye vestigial MSG_DIRS
  • sensor_msgs: getting rid of other build files
  • adios rosbuild2 in manifest.xml
  • catkin updates
  • catkin_project
  • Updated to work with new message generation macros
  • adios debian/ hello stack.yaml. (sketch/prototype/testing).
  • More tweaking for standalone message generation
  • Getting standalone message generation working... w/o munging rosbuild2
  • more rosbuild2 hacking
  • rosbuild2 tweaks
  • missing dependencies
  • sensor_msgs: Added YUV422 image encoding constant.
  • adding in explicit ros/console.h include for ros macros now that ros::Message base class is gone
  • adding JoyFeedback and JoyFeedbackArray
  • updating manifest.xml
  • adding Joy.msg
  • Add image encodings for 16-bit Bayer, RGB, and BGR formats. Update isMono(), isAlpha(), isBayer(), etc.
  • rosbuild2 taking shape
  • sensor_msgs: Source-compatible corrections to fillImage signature.
  • sensor_msgs: Functions for distinguishing categories of encodings. From cv_bridge redesign API review.
  • applying patch to this method like josh did in r33966 in rviz
  • sensor_msgs (rep0104): Migration rules for CameraInfo, RegionOfInterest.
  • sensor_msgs (rep0104): Doc improvements for CameraInfo.
  • sensor_msgs (rep0104): Cleaned up PointCloud2 msg docs. Restored original meaning of 'no invalid points' to is_dense (#4446).
  • sensor_msgs (rep0104): Documented u,v channel semantics for PointCloud msg (#4482).
  • sensor_msgs (rep0104): Added distortion model string constants.
  • sensor_msgs (rep0104): Include guard for image_encodings.h.
  • sensor_msgs (rep0104): Applied changes to CameraInfo and RegionOfInterest messages.
  • Clarify frame of reference for NavSatFix position covariance.
  • Add new satellite navigation messages approved by GPS API review.
  • adding Range message as reviewed #4488
  • adding missing file
  • cleaner fix for point_cloud_conversion definitions for #4451
  • inlining implementation in header for #4451
  • sensor_msgs: Fixed URL in CameraInfo.msg and indicated how to mark an uncalibrated camera. #4105
  • removing all the extra exports
  • add units to message description
  • bug fix in PC->PC2 conversion
  • include guards for point_cloud_conversions.h #4285
  • Added Ubuntu platform tags to manifest
  • added PointCloud2<->PointCloud conversion routines.
  • Updating link to camera calibration
  • updating message as per review http://www.ros.org/wiki/sensor_msgs/Reviews/2010-03-01%20PointCloud2_API_Review
  • sensor_msgs: Added size (number of elements for arrays) to PointField.
  • pushing the new PointCloud structure in trunk
  • Changed wording of angle convention for the LaserScan message. We are now specifying how angles are measured, not which way the laser spins.
  • Remove use of deprecated rosbuild macros
  • Added exporting of generated srv includes.
  • Added call to gen_srv now that there is a service.
  • Added the SetCameraInfo service.
  • octave image parsing function now handles all possible image format types
  • changing review status
  • adding JointState documentation ticket:3006
  • Typo in comments
  • updated parsing routines for octave
  • Adding 1 more rule for migration point clouds and bringing test_common_msgs back from future.
  • Adding JointState migration rule.
  • replace pr2_mechanism_msgs::JointStates by new non-pr2-specific sensor_msgs::JointState. Door test passes
  • better documentation of the CameraInfo message
  • updated url
  • sensor_msgs: Added rule to migrate from old laser_scan/LaserScan.
  • sensor_msgs: Added string constants for bayer encodings.
  • clearing API reviews for they've been through a bunch of them recently.
  • Removed the Timestamp message.
  • Updating migration rules to better support the intermediate Image message that existed.
  • comments for sensor_msgs
  • Adding a CompressedImage migration rule.
  • Fixing robot_msgs references
  • Changing the ordering of fields within the new image message so that all meta information comes before the data block.
  • Migration of RawStereo message.
  • Migration rule for CameraInfo.
  • First cut at migration rules for images.
  • Moving stereo messages out of sensor_msgs to stereo/stereo_msgs
  • Getting rid of PixelEncoding since it is encompassed in Image message instead.
  • update to IMU message comments and defined semantics for covariance
  • Changing naming of bag migration rules.
  • Image message and CvBridge change
  • moving FillImage.h to fill_image.h for Jeremy
  • Adding image_encodings header/cpp, since genmsg_cpp doesn't actually support constant string values
  • fixing spelling
  • Message documentation
  • Switching IMU to sensor_msgs/Imu related to #2277
  • adding IMU msg
  • Took out event_type field, as that would indeed make it more than a timestamp.
  • adding OpenCV doc comment
  • Rename rows,cols to height,width in Image message
  • Adding more migration rule tests and fixing assorted rules.
  • Added a timestamp message. (Will be used to track camera and perhaps some day hokuyo trigger times.)
  • sensor_msgs: Updates to CameraInfo, added pixel encoding and ROI.
  • New sensor_msgs::Image message
  • PointCloud:
    • pts -> points

    * chan -> channels ChannelFloat32:

    • vals -> values
  • sensor_msgs: Added explanation of reprojection matrix to StereoInfo.
  • sensor_msgs: Cleaned up CompressedImage. Updated image_publisher. Blacklisted jpeg.
  • merging in the changes to messages see ros-users email. THis is about half the common_msgs API changes
  • sensor_msgs: Comments to better describe CameraInfo and StereoInfo.
  • Renamed CamInfo message to CameraInfo.
  • sensor_msgs_processImage can now process empty images
    • update openrave and sensor_msgs octave scripts
  • Image from image_msgs -> sensor_msgs #1661
  • updating review status
  • moving LaserScan from laser_scan package to sensor_msgs package #1254
  • populating common_msgs

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Dependant Packages

Name Deps
ar_track_alvar
arbotix_python
asr_msgs
auv_msgs
avt_vimba_camera
axis_camera
basler_tof
bta_tof_driver
calibration_estimation
calibration_msgs
image_cb_detector
camera_info_manager_py
jpeg_streamer
uvc_camera
cartographer_ros
common_msgs
stereo_msgs
cv_camera
dynamic_robot_state_publisher
ensenso_camera
ensenso_camera_msgs
fawkes_msgs
find_object_2d
flir_boson_usb
franka_control
franka_gripper
franka_visualization
gazebo_msgs
gazebo_plugins
generic_control_toolbox
geodesy
tf
tf2_sensor_msgs
gps_common
gpsd_client
grid_map_demos
grid_map_ros
grid_map_visualization
gscam
hokuyo3d
camera_calibration_parsers
camera_info_manager
image_transport
polled_camera
camera_calibration
depth_image_proc
image_proc
image_publisher
image_view
stereo_image_proc
imagezero_image_transport
imagezero_ros
imu_processors
imu_transformer
imu_complementary_filter
imu_filter_madgwick
ira_laser_tools
joint_state_publisher
joy
ps3joy
spacenav_node
wiimote
influxdb_store
opt_camera
zdepth_image_transport
jsk_gui_msgs
posedetection_msgs
roseus
laser_assembler
map_laser
laser_filters
laser_geometry
laser_proc
lgsvl_msgs
libuvc_camera
swri_transform_util
marti_nav_msgs
marti_perception_msgs
marti_visualization_msgs
mav_planning_msgs
mavros
mavros_extras
mavros_msgs
mcl_3dl
microstrain_3dmgx2_imu
mir_driver
mir_dwb_critics
moveit_commander
moveit_core
moveit_controller_manager_example
moveit_ros_perception
moveit_msgs
mrpt_ekf_slam_2d
mrpt_ekf_slam_3d
mrpt_graphslam_2d
mrpt_icp_slam_2d
mrpt_rbpf_slam
multi_object_tracking_lidar
mvsim
costmap_2d
robot_pose_ekf
nav2d_localizer
nav2d_msgs
nav2d_operator
nav2d_remote
assisted_teleop
map_msgs
costmap_cspace
joystick_interrupt
map_organizer
obj_to_pointcloud
planner_cspace
safety_limiter
track_odometry
nerian_stereo
novatel_gps_driver
novatel_span_driver
ntpd_driver
object_recognition_msgs
octomap_pa
octomap_pa_msgs
octomap_ros
omronsentech_camera
opencv_apps
openni2_camera
openni_camera
pacmod_game_control
pcdfilter_pa
pcl_msgs
face_detector
leg_detector
people_tracking_filter
pcl_ros
phidgets_high_speed_encoder
phidgets_ik
phidgets_imu
pointcloud_to_laserscan
pointgrey_camera_driver
wfov_camera_msgs
pr2_teleop_general
pr2_common_action_msgs
pr2_tilt_laser_interface
pr2_head_action
pr2_controller_manager
pr2_gazebo_plugins
rc_visard_driver
robot_localization
dwb_critics
dwb_local_planner
robot_self_filter
robot_state_publisher
ros_control_boilerplate
imu_sensor_controller
joint_state_controller
rosserial_windows
rplidar_ros
rqt_bag_plugins
rqt_ez_publisher
rqt_image_view
rqt_moveit
rtabmap_ros
rviz
rviz_visual_tools
sbg_driver
sick_ldmrs_driver
sick_safetyscanners
sick_scan
sick_tim
slam_karto
stage_ros
joy_teleop
urg_node
urg_stamped
usb_cam
uuv_assistants
uuv_gazebo_ros_plugins
uuv_sensor_ros_plugins
uuv_teleop
velo2cam_calibration
velodyne_gazebo_plugin
velodyne_laserscan
velodyne_pointcloud
velodyne_gazebo_plugins
video_stream_opencv
vision_msgs
cv_bridge
image_geometry
visp_auto_tracker
visp_bridge
visp_camera_calibration
visp_hand2eye_calibration
visp_tracker
volksbot_driver
webots_ros
joy_listener
xpp_msgs
xsens_driver
xv_11_laser_driver
ypspur_ros
ca_driver
ensenso
katana
katana_gazebo_plugins
katana_msgs
katana_teleop
katana_tutorials
nav_pcontroller
nerian_sp1
rosaria
rtt_sensor_msgs
rosbag_direct_write

Recent questions tagged sensor_msgs at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 1.12.8
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/common_msgs.git
VCS Type git
VCS Version jade-devel
Last Updated 2021-01-12
Dev Status MAINTAINED
CI status Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

This package defines messages for commonly used sensors, including cameras and scanning laser rangefinders.

Additional Links

Maintainers

  • Michel Hidalgo

Authors

  • Tully Foote
README
No README found. No README in repository either.
CHANGELOG

Changelog for package sensor_msgs

1.12.8 (2021-01-12)

  • Update package maintainers (#170)
  • Use setuptools instead of distutils (#159)
  • Bump CMake version to avoid CMP0048 warning (#158)
  • Fix TabError: inconsistent use of tabs and spaces in indentation (#155)
  • Contributors: Michel Hidalgo, Ramon Wijnands, Shane Loretz

1.12.7 (2018-11-06)

  • Include sstream on header that needs i (#131)
  • included missing import for the read_points_list method (#128)
    • included missing import for the read_points_list method
  • Merge pull request #127 from ros-1/fix-typos
  • Merge pull request #85 from ros/missing_test_target_dependency fix missing test target dependency
  • Contributors: Dirk Thomas, Jasper, Kuang Fangjun, Tully Foote, chapulina

1.12.6 (2018-05-03)

  • Return default value to prevent missing return warning.
  • Add function to convert PointCloud2 to namedtuples Add new function read_points_list that converts a PointCloud2 to a list of named tuples. It works on top of read_points, which generates lists containing the values. In consequence read_points_list is slower than read_points.
  • Added equidistant distortion model const
  • Added test_depend on rosunit in sensor_msgs
  • fix catkin_lint warnings
  • add mingration rule, copied from common_msgs-1.6
  • Add missing include for atoi. Fixes #97
  • Contributors: 2scholz, Adam Allevato, Ivor Wanders, Kei Okada, Tully Foote, alexzzhu

1.12.5 (2016-09-30)

  • Deal with abstract image encodings
  • Fix spelling mistakes
  • Fix year
  • Contributors: Jochen Sprickerhof, Kentaro Wada, trorornmn

1.12.4 (2016-02-22)

  • added type mapping and support for different types of points in point clouds
  • remove boost dependency fixes #81
  • adding a BatteryState message
  • fix iterator doc
  • remove warning due to anonymous namespace
  • Contributors: Sebastian Pütz, Tully Foote, Vincent Rabaud

1.12.3 (2015-04-20)

1.12.2 (2015-03-21)

1.12.1 (2015-03-17)

1.12.0 (2014-12-29)

1.11.6 (2014-11-04)

  • Fix compilation with Clang
  • Contributors: jmtatsch

1.11.5 (2014-10-27)

  • add a test for the operator+ fix The behavior of that operator also had to be fixed to return a proper child class
  • fix critical bug with operator+
  • Contributors: Michael Ferguson, Vincent Rabaud

1.11.4 (2014-06-19)

  • Fix bug caused by use of va_arg in argument list.
  • Contributors: Daniel Maturana

1.11.3 (2014-05-07)

  • clean up documentation of sensor_msgs so that wiki generated doxygen is readable
  • Export architecture_independent flag in package.xml
  • Contributors: Michael Ferguson, Scott K Logan

1.11.2 (2014-04-24)

1.11.1 (2014-04-16)

  • fix missing include dirs for tests
  • Contributors: Dirk Thomas

1.11.0 (2014-03-04)

  • add a PointCloud2 iterator and modifier
  • Contributors: Tully Foote, Vincent Rabaud

1.10.6 (2014-02-27)

1.10.5 (2014-02-25)

1.10.4 (2014-02-18)

  • Fix roslib import for message module, remove roslib.load_manifest
  • Contributors: Bence Magyar

1.10.3 (2014-01-07)

  • python 3 compatibility
  • line wrap Imu.msg comments

1.10.2 (2013-08-19)

  • adding __init__.py #11

1.10.1 (2013-08-16)

  • setup.py for #11
  • adding installation of point_cloud2.py to sensor_msgs fixes #11

1.10.0 (2013-07-13)

  • adding MultiDOFJointState message

1.9.16 (2013-05-21)

  • update email in package.xml

1.9.15 (2013-03-08)

1.9.14 (2013-01-19)

1.9.13 (2013-01-13)

  • YUV422 actually has an 8 bit depth

1.9.12 (2013-01-02)

  • do not consider YUV422 to be a color anymore
  • added missing license header

1.9.11 (2012-12-17)

  • modified dep type of catkin

1.9.10 (2012-12-13)

  • add missing downstream depend
  • switched from langs to message* packages

1.9.9 (2012-11-22)

  • Added Low-Cost/Android Sensors reviewed messages
  • Updated comments to reflect REP 117 for fixed-distance rangers
  • Adding reviewed MultiEchoLaserScan message.

1.9.8 (2012-11-14)

1.9.7 (2012-10-30)

  • fix catkin function order

1.9.6 (2012-10-18)

  • updated cmake min version to 2.8.3, use cmake_parse_arguments instead of custom macro
  • fix the bad number of channels for YUV422 UYVY

1.9.5 (2012-09-28)

  • fixed missing find genmsg

1.9.4 (2012-09-27 18:06)

1.9.3 (2012-09-27 17:39)

  • cleanup
  • add precision about YUV422
  • add YUV422 to some functions
  • cleaned up package.xml files
  • updated to latest catkin
  • fixed dependencies and more
  • updated to latest catkin: created package.xmls, updated CmakeLists.txt

1.9.2 (2012-09-05)

  • updated pkg-config in manifest.xml
  • updated catkin variables

1.9.1 (2012-09-04)

  • use install destination variables, removed manual installation of manifests

1.9.0 (2012-08-29)

  • update the docs

1.8.13 (2012-07-26 18:34:15 +0000)

  • made inline functions static inline
  • fix ODR violation and missing headers
  • moved c++ code from sensor_msgs to headers

1.8.8 (2012-06-12 22:36)

  • simplifying deps
  • make find_package REQUIRED
  • removed obsolete catkin tag from manifest files
  • fixed package dependency for another common message (#3956), removed unnecessary package name from another message
  • fixed package dependencies for several common messages (fixed #3956)
  • clarify NavSatFix message comments
  • normalize shared lib building, #3838
  • adding TimeReference to build
  • TimeReference decl was invalid
  • adding point_cloud2 as reviewed at http://ros.org/wiki/sensor_msgs/Reviews/Python%20PointCloud2%20_API_Review
  • TimeReference msg as reviewed #ros-pkg5355
  • install headers
  • adding manifest exports
  • fix boost-finding stuff
  • removed depend, added catkin
  • adding roscpp_core dependencies
  • stripping depend and export tags from common_msgs manifests as msg dependencies are now declared in cmake and stack.yaml. Also removed bag migration exports
  • install-related fixes
  • common_msgs: removing migration rules as all are over a year old
  • sensor_msgs: removing old octave support now that rosoct is gone
  • bye bye vestigial MSG_DIRS
  • sensor_msgs: getting rid of other build files
  • adios rosbuild2 in manifest.xml
  • catkin updates
  • catkin_project
  • Updated to work with new message generation macros
  • adios debian/ hello stack.yaml. (sketch/prototype/testing).
  • More tweaking for standalone message generation
  • Getting standalone message generation working... w/o munging rosbuild2
  • more rosbuild2 hacking
  • rosbuild2 tweaks
  • missing dependencies
  • sensor_msgs: Added YUV422 image encoding constant.
  • adding in explicit ros/console.h include for ros macros now that ros::Message base class is gone
  • adding JoyFeedback and JoyFeedbackArray
  • updating manifest.xml
  • adding Joy.msg
  • Add image encodings for 16-bit Bayer, RGB, and BGR formats. Update isMono(), isAlpha(), isBayer(), etc.
  • rosbuild2 taking shape
  • sensor_msgs: Source-compatible corrections to fillImage signature.
  • sensor_msgs: Functions for distinguishing categories of encodings. From cv_bridge redesign API review.
  • applying patch to this method like josh did in r33966 in rviz
  • sensor_msgs (rep0104): Migration rules for CameraInfo, RegionOfInterest.
  • sensor_msgs (rep0104): Doc improvements for CameraInfo.
  • sensor_msgs (rep0104): Cleaned up PointCloud2 msg docs. Restored original meaning of 'no invalid points' to is_dense (#4446).
  • sensor_msgs (rep0104): Documented u,v channel semantics for PointCloud msg (#4482).
  • sensor_msgs (rep0104): Added distortion model string constants.
  • sensor_msgs (rep0104): Include guard for image_encodings.h.
  • sensor_msgs (rep0104): Applied changes to CameraInfo and RegionOfInterest messages.
  • Clarify frame of reference for NavSatFix position covariance.
  • Add new satellite navigation messages approved by GPS API review.
  • adding Range message as reviewed #4488
  • adding missing file
  • cleaner fix for point_cloud_conversion definitions for #4451
  • inlining implementation in header for #4451
  • sensor_msgs: Fixed URL in CameraInfo.msg and indicated how to mark an uncalibrated camera. #4105
  • removing all the extra exports
  • add units to message description
  • bug fix in PC->PC2 conversion
  • include guards for point_cloud_conversions.h #4285
  • Added Ubuntu platform tags to manifest
  • added PointCloud2<->PointCloud conversion routines.
  • Updating link to camera calibration
  • updating message as per review http://www.ros.org/wiki/sensor_msgs/Reviews/2010-03-01%20PointCloud2_API_Review
  • sensor_msgs: Added size (number of elements for arrays) to PointField.
  • pushing the new PointCloud structure in trunk
  • Changed wording of angle convention for the LaserScan message. We are now specifying how angles are measured, not which way the laser spins.
  • Remove use of deprecated rosbuild macros
  • Added exporting of generated srv includes.
  • Added call to gen_srv now that there is a service.
  • Added the SetCameraInfo service.
  • octave image parsing function now handles all possible image format types
  • changing review status
  • adding JointState documentation ticket:3006
  • Typo in comments
  • updated parsing routines for octave
  • Adding 1 more rule for migration point clouds and bringing test_common_msgs back from future.
  • Adding JointState migration rule.
  • replace pr2_mechanism_msgs::JointStates by new non-pr2-specific sensor_msgs::JointState. Door test passes
  • better documentation of the CameraInfo message
  • updated url
  • sensor_msgs: Added rule to migrate from old laser_scan/LaserScan.
  • sensor_msgs: Added string constants for bayer encodings.
  • clearing API reviews for they've been through a bunch of them recently.
  • Removed the Timestamp message.
  • Updating migration rules to better support the intermediate Image message that existed.
  • comments for sensor_msgs
  • Adding a CompressedImage migration rule.
  • Fixing robot_msgs references
  • Changing the ordering of fields within the new image message so that all meta information comes before the data block.
  • Migration of RawStereo message.
  • Migration rule for CameraInfo.
  • First cut at migration rules for images.
  • Moving stereo messages out of sensor_msgs to stereo/stereo_msgs
  • Getting rid of PixelEncoding since it is encompassed in Image message instead.
  • update to IMU message comments and defined semantics for covariance
  • Changing naming of bag migration rules.
  • Image message and CvBridge change
  • moving FillImage.h to fill_image.h for Jeremy
  • Adding image_encodings header/cpp, since genmsg_cpp doesn't actually support constant string values
  • fixing spelling
  • Message documentation
  • Switching IMU to sensor_msgs/Imu related to #2277
  • adding IMU msg
  • Took out event_type field, as that would indeed make it more than a timestamp.
  • adding OpenCV doc comment
  • Rename rows,cols to height,width in Image message
  • Adding more migration rule tests and fixing assorted rules.
  • Added a timestamp message. (Will be used to track camera and perhaps some day hokuyo trigger times.)
  • sensor_msgs: Updates to CameraInfo, added pixel encoding and ROI.
  • New sensor_msgs::Image message
  • PointCloud:
    • pts -> points

    * chan -> channels ChannelFloat32:

    • vals -> values
  • sensor_msgs: Added explanation of reprojection matrix to StereoInfo.
  • sensor_msgs: Cleaned up CompressedImage. Updated image_publisher. Blacklisted jpeg.
  • merging in the changes to messages see ros-users email. THis is about half the common_msgs API changes
  • sensor_msgs: Comments to better describe CameraInfo and StereoInfo.
  • Renamed CamInfo message to CameraInfo.
  • sensor_msgs_processImage can now process empty images
    • update openrave and sensor_msgs octave scripts
  • Image from image_msgs -> sensor_msgs #1661
  • updating review status
  • moving LaserScan from laser_scan package to sensor_msgs package #1254
  • populating common_msgs

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Dependant Packages

Name Deps
ar_track_alvar
arbotix_python
aruco_ros
asr_msgs
auv_msgs
basler_tof
bta_tof_driver
calibration_estimation
calibration_msgs
image_cb_detector
camera_info_manager_py
jpeg_streamer
uvc_camera
common_msgs
stereo_msgs
cv_camera
depthcloud_encoder
depthimage_to_laserscan
fetch_depth_layer
fetch_teleop
gazebo_msgs
gazebo_plugins
geodesy
tf
tf2_sensor_msgs
gps_common
gpsd_client
graft
grid_map_demos
grid_map_ros
grid_map_visualization
gscam
haf_grasping
hector_pose_estimation
hector_pose_estimation_core
message_to_tf
hector_compressed_map_transport
hector_imu_tools
hokuyo3d
camera_calibration_parsers
camera_info_manager
image_transport
polled_camera
camera_calibration
depth_image_proc
image_proc
image_publisher
image_view
stereo_image_proc
imagezero_image_transport
imagezero_ros
imu_processors
imu_transformer
imu_complementary_filter
imu_filter_madgwick
industrial_robot_client
industrial_robot_simulator
joy
ps3joy
spacenav_node
wiimote
influxdb_store
opt_camera
zdepth_image_transport
audio_video_recorder
jsk_network_tools
image_view2
jsk_rosbag_tools
jsk_tilt_laser
jsk_topic_tools
virtual_force_publisher
jsk_gui_msgs
posedetection_msgs
eus_teleop
joy_mouse
jsk_footstep_controller
pr2eus_openrave
audio_to_spectrogram
checkerboard_detector
imagesift
jsk_pcl_ros
jsk_pcl_ros_utils
jsk_perception
jsk_recognition_msgs
jsk_recognition_utils
resized_image_transport
sound_classification
roseus
jsk_interactive_marker
laser_assembler
map_laser
laser_filters
laser_geometry
laser_proc
libuvc_camera
lms1xx
swri_transform_util
marti_nav_msgs
marti_perception_msgs
marti_visualization_msgs
mav_planning_msgs
mavros
mavros_extras
microstrain_3dmgx2_imu
moveit_commander
moveit_core
moveit_experimental
moveit_ros_perception
moveit_msgs
mrpt_ekf_slam_2d
mrpt_ekf_slam_3d
mrpt_graphslam_2d
mrpt_icp_slam_2d
mrpt_rbpf_slam
mvsim
naoqi_bridge_msgs
naoqi_driver
costmap_2d
robot_pose_ekf
nav2d_localizer
nav2d_msgs
nav2d_operator
nav2d_remote
range_sensor_layer
map_msgs
laser_scan_publisher_tutorial
point_cloud_publisher_tutorial
nmea_navsat_driver
novatel_gps_driver
novatel_span_driver
ntpd_driver
object_recognition_msgs
octomap_server
octomap_ros
opencv_apps
openni2_camera
openni_camera
optris_drivers
pcdfilter_pa
pcl_msgs
face_detector
leg_detector
people_tracking_filter
pepperl_fuchs_r2000
pcl_ros
phidgets_imu
pointcloud_to_laserscan
pointgrey_camera_driver
wfov_camera_msgs
pose_cov_ops
pr2_head_action
pr2_controller_manager
razor_imu_9dof
robot_calibration
robot_calibration_msgs
robot_controllers
robot_localization
robot_self_filter
robot_state_publisher
ros_control_boilerplate
imu_sensor_controller
joint_state_controller
ros_numpy
rospilot
rosserial_windows
rotors_control
rotors_gazebo
rotors_hil_interface
rotors_joy_interface
rplidar_ros
rqt_bag_plugins
rqt_ez_publisher
rqt_image_view
rqt_moveit
rtabmap_ros
hrpsys_ros_bridge
rviz
laser_ortho_projector
laser_scan_matcher
laser_scan_sparsifier
laser_scan_splitter
ncd_parser
polar_scan_matcher
sick_ldmrs_driver
sick_tim
slam_karto
joy_teleop
teleop_twist_joy
ublox_msgs
ueye_cam
um6
um7
underwater_vehicle_dynamics
uwsim
rgbd_rosbag_tools
rotunit_snapshotter
uos_diffdrive_teleop
uos_freespace
urg_node
usb_cam
velodyne_gazebo_plugins
video_stream_opencv
cv_bridge
image_geometry
visp_auto_tracker
visp_bridge
visp_camera_calibration
visp_hand2eye_calibration
visp_tracker
visp_ros
rwt_moveit
volksbot_driver
joy_listener
xsens_driver
ardrone_autonomy
ca_driver
diffdrive_gazebo_plugin
ecto_pcl
ecto_ros
force_torque_sensor_calib
gravity_compensation
geonav_transform
grizzly_teleop
hector_costmap
hector_elevation_mapping
hector_gps_calibration
hector_timestamp_alignment
hector_quadrotor_controller
hector_quadrotor_teleop
hector_heat_detection
hector_motion_detection
hector_soft_obstacle_detection
hector_barrel_detection_nodelet
hector_rqt_plugins
hector_stair_detection
hector_stair_detection_msgs
hector_worldmodel_msgs
katana
katana_gazebo_plugins
katana_msgs
katana_teleop
katana_tutorials
korg_nanokontrol
manipulation_msgs
nao_interaction_msgs
nao_description
naoqi_driver_py
naoqi_pose
naoqi_sensors_py
naoqi_dcm_driver
nav_pcontroller
nerian_sp1
object_recognition_core
object_recognition_reconstruction
rcll_fawkes_sim_msgs
joint_state_publisher
rosaria
rsv_balance_gazebo
rtt_sensor_msgs
schunk_canopen_driver
schunk_svh_driver
sicktoolbox_wrapper
stdr_gui
stdr_robot
stdr_samples
tiny_slam
bta_ros
head_pose_estimation
hokuyo_node
iai_content_msgs
iai_kinematics_msgs
nao_teleop
rosh_common
stereo_slam
camera_handler
imu_handler
manipulator_handler
quadrotor_handler
quadrotor_tk_handler
aubo_control
aubo_driver
aubo_new_driver
aubo_panel
aubo_trajectory
freefloating_gazebo
graspdb
rail_grasp_collection
rail_pick_and_place_msgs
rail_recognition
ros_ethernet_rmp
stream_manipulator_3d
microstrain_mips
screen_grab

Recent questions tagged sensor_msgs at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 1.11.10
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/common_msgs.git
VCS Type git
VCS Version indigo-devel
Last Updated 2018-05-03
Dev Status MAINTAINED
CI status Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

This package defines messages for commonly used sensors, including cameras and scanning laser rangefinders.

Additional Links

Maintainers

  • Tully Foote

Authors

No additional authors.
README
No README found. No README in repository either.
CHANGELOG

Changelog for package sensor_msgs

1.11.10 (2018-05-03)

  • Add missing include for atoi. Fixes #97
  • Add const variable for abstract image encoding prefixes
  • Deal with abstract image encodings in bitDepth
  • Deal with abstract image encodings in numChannels
  • Contributors: Kentaro Wada, Tully Foote

1.11.9 (2016-02-22)

  • added type mapping and support for different types of point cloud points
  • remove boost dependency fixes #81
  • adding a BatteryState message
  • Contributors: Sebastian Pütz, Tully Foote

1.11.8 (2015-04-20)

  • remove warning due to anonymous namespace
  • Contributors: Vincent Rabaud

1.11.7 (2015-03-21)

1.11.6 (2014-11-04)

  • Fix compilation with Clang
  • Contributors: jmtatsch

1.11.5 (2014-10-27)

  • add a test for the operator+ fix The behavior of that operator also had to be fixed to return a proper child class
  • fix critical bug with operator+
  • Contributors: Michael Ferguson, Vincent Rabaud

1.11.4 (2014-06-19)

  • Fix bug caused by use of va_arg in argument list.
  • Contributors: Daniel Maturana

1.11.3 (2014-05-07)

  • clean up documentation of sensor_msgs so that wiki generated doxygen is readable
  • Export architecture_independent flag in package.xml
  • Contributors: Michael Ferguson, Scott K Logan

1.11.2 (2014-04-24)

1.11.1 (2014-04-16)

  • fix missing include dirs for tests
  • Contributors: Dirk Thomas

1.11.0 (2014-03-04)

  • add a PointCloud2 iterator and modifier
  • Contributors: Tully Foote, Vincent Rabaud

1.10.6 (2014-02-27)

1.10.5 (2014-02-25)

1.10.4 (2014-02-18)

  • Fix roslib import for message module, remove roslib.load_manifest
  • Contributors: Bence Magyar

1.10.3 (2014-01-07)

  • python 3 compatibility
  • line wrap Imu.msg comments

1.10.2 (2013-08-19)

  • adding __init__.py #11

1.10.1 (2013-08-16)

  • setup.py for #11
  • adding installation of point_cloud2.py to sensor_msgs fixes #11

1.10.0 (2013-07-13)

  • adding MultiDOFJointState message

1.9.16 (2013-05-21)

  • update email in package.xml

1.9.15 (2013-03-08)

1.9.14 (2013-01-19)

1.9.13 (2013-01-13)

  • YUV422 actually has an 8 bit depth

1.9.12 (2013-01-02)

  • do not consider YUV422 to be a color anymore
  • added missing license header

1.9.11 (2012-12-17)

  • modified dep type of catkin

1.9.10 (2012-12-13)

  • add missing downstream depend
  • switched from langs to message* packages

1.9.9 (2012-11-22)

  • Added Low-Cost/Android Sensors reviewed messages
  • Updated comments to reflect REP 117 for fixed-distance rangers
  • Adding reviewed MultiEchoLaserScan message.

1.9.8 (2012-11-14)

1.9.7 (2012-10-30)

  • fix catkin function order

1.9.6 (2012-10-18)

  • updated cmake min version to 2.8.3, use cmake_parse_arguments instead of custom macro
  • fix the bad number of channels for YUV422 UYVY

1.9.5 (2012-09-28)

  • fixed missing find genmsg

1.9.4 (2012-09-27 18:06)

1.9.3 (2012-09-27 17:39)

  • cleanup
  • add precision about YUV422
  • add YUV422 to some functions
  • cleaned up package.xml files
  • updated to latest catkin
  • fixed dependencies and more
  • updated to latest catkin: created package.xmls, updated CmakeLists.txt

1.9.2 (2012-09-05)

  • updated pkg-config in manifest.xml
  • updated catkin variables

1.9.1 (2012-09-04)

  • use install destination variables, removed manual installation of manifests

1.9.0 (2012-08-29)

  • update the docs

1.8.13 (2012-07-26 18:34:15 +0000)

  • made inline functions static inline
  • fix ODR violation and missing headers
  • moved c++ code from sensor_msgs to headers

1.8.8 (2012-06-12 22:36)

  • simplifying deps
  • make find_package REQUIRED
  • removed obsolete catkin tag from manifest files
  • fixed package dependency for another common message (#3956), removed unnecessary package name from another message
  • fixed package dependencies for several common messages (fixed #3956)
  • clarify NavSatFix message comments
  • normalize shared lib building, #3838
  • adding TimeReference to build
  • TimeReference decl was invalid
  • adding point_cloud2 as reviewed at http://ros.org/wiki/sensor_msgs/Reviews/Python%20PointCloud2%20_API_Review
  • TimeReference msg as reviewed #ros-pkg5355
  • install headers
  • adding manifest exports
  • fix boost-finding stuff
  • removed depend, added catkin
  • adding roscpp_core dependencies
  • stripping depend and export tags from common_msgs manifests as msg dependencies are now declared in cmake and stack.yaml. Also removed bag migration exports
  • install-related fixes
  • common_msgs: removing migration rules as all are over a year old
  • sensor_msgs: removing old octave support now that rosoct is gone
  • bye bye vestigial MSG_DIRS
  • sensor_msgs: getting rid of other build files
  • adios rosbuild2 in manifest.xml
  • catkin updates
  • catkin_project
  • Updated to work with new message generation macros
  • adios debian/ hello stack.yaml. (sketch/prototype/testing).
  • More tweaking for standalone message generation
  • Getting standalone message generation working... w/o munging rosbuild2
  • more rosbuild2 hacking
  • rosbuild2 tweaks
  • missing dependencies
  • sensor_msgs: Added YUV422 image encoding constant.
  • adding in explicit ros/console.h include for ros macros now that ros::Message base class is gone
  • adding JoyFeedback and JoyFeedbackArray
  • updating manifest.xml
  • adding Joy.msg
  • Add image encodings for 16-bit Bayer, RGB, and BGR formats. Update isMono(), isAlpha(), isBayer(), etc.
  • rosbuild2 taking shape
  • sensor_msgs: Source-compatible corrections to fillImage signature.
  • sensor_msgs: Functions for distinguishing categories of encodings. From cv_bridge redesign API review.
  • applying patch to this method like josh did in r33966 in rviz
  • sensor_msgs (rep0104): Migration rules for CameraInfo, RegionOfInterest.
  • sensor_msgs (rep0104): Doc improvements for CameraInfo.
  • sensor_msgs (rep0104): Cleaned up PointCloud2 msg docs. Restored original meaning of 'no invalid points' to is_dense (#4446).
  • sensor_msgs (rep0104): Documented u,v channel semantics for PointCloud msg (#4482).
  • sensor_msgs (rep0104): Added distortion model string constants.
  • sensor_msgs (rep0104): Include guard for image_encodings.h.
  • sensor_msgs (rep0104): Applied changes to CameraInfo and RegionOfInterest messages.
  • Clarify frame of reference for NavSatFix position covariance.
  • Add new satellite navigation messages approved by GPS API review.
  • adding Range message as reviewed #4488
  • adding missing file
  • cleaner fix for point_cloud_conversion definitions for #4451
  • inlining implementation in header for #4451
  • sensor_msgs: Fixed URL in CameraInfo.msg and indicated how to mark an uncalibrated camera. #4105
  • removing all the extra exports
  • add units to message description
  • bug fix in PC->PC2 conversion
  • include guards for point_cloud_conversions.h #4285
  • Added Ubuntu platform tags to manifest
  • added PointCloud2<->PointCloud conversion routines.
  • Updating link to camera calibration
  • updating message as per review http://www.ros.org/wiki/sensor_msgs/Reviews/2010-03-01%20PointCloud2_API_Review
  • sensor_msgs: Added size (number of elements for arrays) to PointField.
  • pushing the new PointCloud structure in trunk
  • Changed wording of angle convention for the LaserScan message. We are now specifying how angles are measured, not which way the laser spins.
  • Remove use of deprecated rosbuild macros
  • Added exporting of generated srv includes.
  • Added call to gen_srv now that there is a service.
  • Added the SetCameraInfo service.
  • octave image parsing function now handles all possible image format types
  • changing review status
  • adding JointState documentation ticket:3006
  • Typo in comments
  • updated parsing routines for octave
  • Adding 1 more rule for migration point clouds and bringing test_common_msgs back from future.
  • Adding JointState migration rule.
  • replace pr2_mechanism_msgs::JointStates by new non-pr2-specific sensor_msgs::JointState. Door test passes
  • better documentation of the CameraInfo message
  • updated url
  • sensor_msgs: Added rule to migrate from old laser_scan/LaserScan.
  • sensor_msgs: Added string constants for bayer encodings.
  • clearing API reviews for they've been through a bunch of them recently.
  • Removed the Timestamp message.
  • Updating migration rules to better support the intermediate Image message that existed.
  • comments for sensor_msgs
  • Adding a CompressedImage migration rule.
  • Fixing robot_msgs references
  • Changing the ordering of fields within the new image message so that all meta information comes before the data block.
  • Migration of RawStereo message.
  • Migration rule for CameraInfo.
  • First cut at migration rules for images.
  • Moving stereo messages out of sensor_msgs to stereo/stereo_msgs
  • Getting rid of PixelEncoding since it is encompassed in Image message instead.
  • update to IMU message comments and defined semantics for covariance
  • Changing naming of bag migration rules.
  • Image message and CvBridge change
  • moving FillImage.h to fill_image.h for Jeremy
  • Adding image_encodings header/cpp, since genmsg_cpp doesn't actually support constant string values
  • fixing spelling
  • Message documentation
  • Switching IMU to sensor_msgs/Imu related to #2277
  • adding IMU msg
  • Took out event_type field, as that would indeed make it more than a timestamp.
  • adding OpenCV doc comment
  • Rename rows,cols to height,width in Image message
  • Adding more migration rule tests and fixing assorted rules.
  • Added a timestamp message. (Will be used to track camera and perhaps some day hokuyo trigger times.)
  • sensor_msgs: Updates to CameraInfo, added pixel encoding and ROI.
  • New sensor_msgs::Image message
  • PointCloud:
    • pts -> points

    * chan -> channels ChannelFloat32:

    • vals -> values
  • sensor_msgs: Added explanation of reprojection matrix to StereoInfo.
  • sensor_msgs: Cleaned up CompressedImage. Updated image_publisher. Blacklisted jpeg.
  • merging in the changes to messages see ros-users email. THis is about half the common_msgs API changes
  • sensor_msgs: Comments to better describe CameraInfo and StereoInfo.
  • Renamed CamInfo message to CameraInfo.
  • sensor_msgs_processImage can now process empty images
    • update openrave and sensor_msgs octave scripts
  • Image from image_msgs -> sensor_msgs #1661
  • updating review status
  • moving LaserScan from laser_scan package to sensor_msgs package #1254
  • populating common_msgs

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Package Dependencies

System Dependencies

No direct system dependencies.

Dependant Packages

Name Deps
adi_driver
ar_track_alvar
arbotix_python
aruco_ros
asr_calibration_tool_dome
asr_cyberglove_visualization
asr_descriptor_surface_based_recognition
asr_flir_ptu_controller
asr_flir_ptu_driver
asr_flock_of_birds_tracking
asr_halcon_bridge
asr_ivt_bridge
asr_msgs
asr_robot_model_services
auv_msgs
avt_vimba_camera
axis_camera
basler_tof
bta_tof_driver
calibration_estimation
calibration_msgs
image_cb_detector
camera_info_manager_py
jpeg_streamer
uvc_camera
cartographer_ros
cob_monitoring
cob_teleop
cob_frame_tracker
cob_model_identifier
cob_obstacle_distance
cob_omni_drive_controller
cob_trajectory_controller
cob_twist_controller
cob_base_drive_chain
cob_camera_sensors
cob_light
cob_phidgets
cob_scan_unifier
cob_sick_lms1xx
cob_sick_s300
laser_scan_densifier
cob_hand_bridge
cob_grasp_generation
cob_map_accessibility_analysis
cob_3d_mapping_msgs
cob_cam3d_throttle
cob_image_flip
cob_object_detection_msgs
cob_object_detection_visualizer
cob_perception_msgs
ipa_3d_fov_visualization
common_msgs
stereo_msgs
criutils
cv_camera
depthcloud_encoder
depthimage_to_laserscan
fawkes_msgs
fetch_depth_layer
fetch_teleop
fiducial_detect
fiducial_pose
flir_boson_usb
flir_ptu_driver
freenect_camera
gazebo_msgs
gazebo_plugins
generic_control_toolbox
geodesy
tf
tf2_sensor_msgs
gps_common
gpsd_client
graft
grid_map_demos
grid_map_ros
grid_map_visualization
gscam
haf_grasping
hector_pose_estimation
hector_pose_estimation_core
message_to_tf
hector_compressed_map_transport
hector_imu_tools
hokuyo3d
camera_calibration_parsers
camera_info_manager
image_transport
polled_camera
camera_calibration
depth_image_proc
image_proc
image_publisher
image_view
stereo_image_proc
imagezero_image_transport
imagezero_ros
imu_processors
imu_transformer
imu_complementary_filter
imu_filter_madgwick
industrial_robot_client
industrial_robot_simulator
joint_state_publisher
joy
ps3joy
spacenav_node
wiimote
influxdb_store
opt_camera
zdepth_image_transport
audio_video_recorder
jsk_network_tools
image_view2
jsk_rosbag_tools
jsk_tilt_laser
jsk_topic_tools
virtual_force_publisher
jsk_gui_msgs
posedetection_msgs
eus_teleop
joy_mouse
jsk_footstep_controller
pr2eus_openrave
audio_to_spectrogram
checkerboard_detector
imagesift
jsk_pcl_ros
jsk_pcl_ros_utils
jsk_perception
jsk_recognition_msgs
jsk_recognition_utils
resized_image_transport
sound_classification
roseus
jsk_interactive_marker
kobuki_bumper2pc
kobuki_node
kobuki_testsuite
kobuki_gazebo_plugins
laser_assembler
map_laser
laser_filters
laser_geometry
laser_proc
lgsvl_msgs
libuvc_camera
lms1xx
swri_transform_util
marti_nav_msgs
marti_perception_msgs
marti_visualization_msgs
mav_planning_msgs
mavros
mavros_extras
mcl_3dl
microstrain_3dmgx2_imu
microstrain_mips
minas_control
mir_driver
mir_dwb_critics
moveit_commander
moveit_core
moveit_experimental
moveit_ros_perception
moveit_msgs
movie_publisher
mrp2_hardware
mrpt_ekf_slam_2d
mrpt_ekf_slam_3d
mrpt_graphslam_2d
mrpt_icp_slam_2d
mrpt_rbpf_slam
multi_object_tracking_lidar
mvsim
naoqi_bridge_msgs
naoqi_driver
costmap_2d
robot_pose_ekf
nav2d_localizer
nav2d_msgs
nav2d_operator
nav2d_remote
assisted_teleop
range_sensor_layer
laser_scan_publisher_tutorial
point_cloud_publisher_tutorial
costmap_cspace
joystick_interrupt
map_organizer
obj_to_pointcloud
planner_cspace
safety_limiter
track_odometry
nmea_navsat_driver
novatel_gps_driver
novatel_span_driver
ntpd_driver
object_recognition_msgs
octomap_server
octomap_pa
octomap_ros
omron_os32c_driver
opencv_apps
openni2_camera
openni_camera
optris_drivers
pcdfilter_pa
pcl_msgs
face_detector
leg_detector
people_tracking_filter
pepperl_fuchs_r2000
pcl_ros
phidgets_imu
phidgets_ir
play_motion
pointcloud_to_laserscan
pointgrey_camera_driver
wfov_camera_msgs
pose_cov_ops
pr2_teleop_general
dense_laser_assembler
pr2_calibration_launch
pr2_common_action_msgs
pr2_tilt_laser_interface
pr2_head_action
pr2_controller_manager
laser_tilt_controller_filter
pr2_navigation_perception
pr2_navigation_self_filter
imu_monitor
joint_qualification_controllers
pr2_gazebo_plugins
prosilica_camera
raspimouse_control
razor_imu_9dof
rc_visard_driver
robot_calibration
robot_calibration_msgs
robot_controllers
robot_localization
dwb_critics
dwb_local_planner
robot_self_filter
robot_state_publisher
ros_control_boilerplate
imu_sensor_controller
joint_state_controller
ros_numpy
rosbridge_library
rospilot
rosserial_embeddedlinux
rosserial_windows
rotors_control
rotors_gazebo
rotors_joy_interface
rplidar_ros
rqt_bag_plugins
rqt_ez_publisher
rqt_image_view
rqt_moveit
rtabmap_ros
hrpsys_ros_bridge
rviz
laser_ortho_projector
laser_scan_matcher
laser_scan_sparsifier
laser_scan_splitter
ncd_parser
polar_scan_matcher
schunk_powercube_chain
schunk_sdh
sick_ldmrs_driver
sick_safetyscanners
sick_scan
sick_tim
slam_karto
joy_teleop
teleop_twist_joy
ublox_msgs
ueye_cam
um6
um7
underwater_vehicle_dynamics
uwsim
ur_driver
rgbd_rosbag_tools
rotunit_snapshotter
uos_diffdrive_teleop
uos_freespace
urg_node
urg_stamped
usb_cam
velodyne_laserscan
velodyne_pointcloud
velodyne_gazebo_plugins
video_stream_opencv
cv_bridge
image_geometry
visp_auto_tracker
visp_bridge
visp_camera_calibration
visp_hand2eye_calibration
visp_tracker
visp_ros
rwt_moveit
volksbot_driver
wge100_camera
joy_listener
xpp_msgs
xsens_driver
xv_11_laser_driver
ypspur_ros
yocs_ar_marker_tracking
yocs_ar_pair_tracking
yocs_diff_drive_pose_controller
yocs_joyop
yocs_safety_controller
yocs_virtual_sensor
agvs_pad
agvs_robot_control
ardrone_autonomy
bhand_controller
rqt_bhand
camera1394
ca_driver
declination
cliff_detector
depth_sensor_pose
laserscan_kinect
diffdrive_gazebo_plugin
ecto_pcl
ecto_ros
force_torque_sensor_calib
gravity_compensation
geonav_transform
grizzly_teleop
hector_costmap
hector_elevation_mapping
hector_gps_calibration
hector_timestamp_alignment
hector_quadrotor_controller
hector_quadrotor_teleop
hector_heat_detection
hector_motion_detection
hector_soft_obstacle_detection
hector_barrel_detection_nodelet
hector_rqt_plugins
hector_stair_detection
hector_stair_detection_msgs
hector_worldmodel_msgs
humanoid_localization
imu_compass
caljob_creator
industrial_extrinsic_cal
rgbd_depth_correction
target_finder
infinisoleil
katana
katana_gazebo_plugins
katana_msgs
katana_teleop
katana_tutorials
kobuki_softnode
korg_nanokontrol
manipulation_msgs
motoman_driver
myahrs_driver
nao_interaction_msgs
nao_description
naoqi_driver_py
naoqi_pose
naoqi_sensors_py
naoqi_dcm_driver
nav_pcontroller
nerian_sp1
object_recognition_core
object_recognition_reconstruction
feature_tracker
joint_tracker
omip_common
rb_tracker
shape_reconstruction
shape_tracker
omip_msgs
arm_navigation_msgs
openrave_actionlib
openrave_calibration
openrave_msgs
openrave_robot_control
openrave_robot_filter
openrave_sensors
pheeno_ros
pheeno_ros_sim
phoxi_camera
puma_motor_driver
rb1_base_pad
rbcar_pad
rbcar_joystick
rbcar_robot_control
rcll_fawkes_sim_msgs
roboteq_diff_driver
robotiq_joint_state_publisher
robotiq_s_model_articulated_gazebo_plugins
roch_navigation
roch_base
roch_msgs
roch_sensorpc
rosabridge_server
rosaria
rosjava_core
rosjava_extras
rosjava_messages
rtt_sensor_msgs
schunk_canopen_driver
schunk_svh_driver
sicktoolbox_wrapper
bag_tools
pointcloud_tools
stdr_gui
stdr_robot
stdr_samples
summit_x_robot_control
summit_xl_localization
summit_xl_pad
summit_xl_robot_control
tango_ros_native
tiny_slam
turtlebot_calibration
turtlebot_navigation
create_gazebo_plugins
turtlebot_msgs
ur_modern_driver
agile_grasp
apriltags_ros
argos3d_p100
asctec_hl_comm
asctec_hl_gps
asctec_hl_interface
baxter_core_msgs
baxter_examples
baxter_interface
baxter_tools
bta_ros
bwi_joystick_teleop
bwi_logging
bwi_msgs
bwi_rqt_plugins
calvin_joint_commander
cob_leg_detection
cob_openni2_tracker
cob_people_detection
cob_people_tracking_filter
crsm_slam
darwin_gazebo
enu
head_pose_estimation
hokuyo_node
iai_content_msgs
iai_kinematics_msgs
iav_depthimage_to_laserscan
jsk_pepper_startup
nao_jsk_teleop
jsk_robot_startup
kinect_aux
kurt3d
imu_recalibration
kurt_base
map_msgs
nao_teleop
orientus_driver
pr2_joint_teleop
slider_gui
pr2_precise_trajectory
ros_arduino_python
ros_web_video
rosbag_image_compressor
rosh_common
hrpsys_gazebo_msgs
s3000_laser
segbot_bringup
segbot_sensors
sentis_tof_m100
sr_ronex_msgs
stereo_slam
terarangerone
uos_rotunit_driver
uos_rotunit_snapshotter
uos_rotunit_teleop
velodyne_height_map
viso2_ros
camera_handler
imu_handler
manipulator_handler
quadrotor_handler
quadrotor_tk_handler
aubo_control
aubo_driver
aubo_new_driver
aubo_panel
aubo_trajectory
baxter_sim_kinematics
camera_pose_calibration
carl_dynamixel
carl_interactive_manipulation
carl_phidgets
carl_teleop
carl_tools
carl_moveit
carl_safety
cartographer_turtlebot
cirkit_unit03_base
cirkit_unit03_driver
cit_adis_imu
custom_landmark_2d
dlut_viso2_ros
ekf_localization
evarobot_gazebo
freefloating_gazebo
fulanghua_ekf_2d
grasp_planning_graspit_msgs
h4r_thermapp_camera
head_action
homer_mapping
homer_navigation
or_libs
or_msgs
or_nodes
robot_face
point_cloud_reducer
husky_base