No version for distro humble showing github. Known supported distros are highlighted in the buttons above.
Package symbol

vision_ssd_detect package from autoware_learn repo

amathutils_lib autoware_build_flags autoware_health_checker emergency_handler gnss lanelet2_extension libvectormap libwaypoint_follower map_file object_map op_planner op_ros_helpers op_simu op_utility ros_observer tvm_utility vector_map vector_map_server vehicle_sim_model autoware_connector ekf_localizer gnss_localizer image_processor imm_ukf_pda_track lidar_apollo_cnn_seg_detect lidar_euclidean_cluster_detect lidar_fake_perception lidar_kf_contour_track lidar_localizer lidar_naive_l_shape_detect lidar_point_pillars lidar_shape_estimation naive_motion_predict ndt_cpu ndt_gpu ndt_tku obj_db pcl_omp_registration pixel_cloud_fusion points_downsampler points_preprocessor pos_db range_vision_fusion road_occupancy_processor roi_object_filter trafficlight_recognizer twist_generator vel_pose_diff_checker vision_beyond_track vision_darknet_detect vision_lane_detect vision_segment_enet_detect vision_ssd_detect astar_search costmap_generator decision_maker dp_planner ff_waypoint_follower freespace_planner lane_planner lattice_planner ll2_global_planner mpc_follower op_global_planner op_local_planner op_simulation_package op_utilities pure_pursuit state_machine_lib twist_filter twist_gate way_planner waypoint_maker waypoint_planner autoware_quickstart_examples autoware_can_msgs autoware_config_msgs autoware_external_msgs autoware_lanelet2_msgs autoware_map_msgs autoware_msgs autoware_system_msgs tablet_socket_msgs vector_map_msgs carla_autoware_bridge gazebo_camera_description gazebo_imu_description lgsvl_simulator_bridge vehicle_gazebo_simulation_interface vehicle_gazebo_simulation_launcher wf_simulator autoware_bag_tools autoware_camera_lidar_calibrator autoware_launcher autoware_launcher_rviz calibration_publisher data_preprocessor graph_tools kitti_box_publisher kitti_launch kitti_player lanelet_aisan_converter log_tools map_tf_generator map_tools marker_downsampler mqtt_socket multi_lidar_calibrator oculus_socket pc2_downsampler rosbag_controller runtime_manager sound_player system_monitor tablet_socket twist2odom udon_socket vehicle_engage_panel vehicle_socket decision_maker_panel detected_objects_visualizer fastvirtualscan gazebo_world_description glviewer integrated_viewer points2image rosinterface autoware_rviz_plugins vehicle_description vehicle_model adi_driver as autoware_driveworks_gmsl_interface autoware_driveworks_interface vlg22c_cam custom_msgs garmin hokuyo javad_navsat_driver kvaser sick_lms5xx memsic_imu microstrain_driver nmea_navsat autoware_pointgrey_drivers sick_ldmrs_description sick_ldmrs_driver sick_ldmrs_laser sick_ldmrs_msgs sick_ldmrs_tools vectacam xsens_driver ymc ds4 ds4_driver ds4_msgs lanelet2 lanelet2_core lanelet2_examples lanelet2_io lanelet2_maps lanelet2_matching lanelet2_projection lanelet2_python lanelet2_routing lanelet2_traffic_rules lanelet2_validation mrt_cmake_modules

ROS Distro
github

Package Summary

Tags No category tags.
Version 1.12.0
License Apache 2
Build type CATKIN
Use RECOMMENDED

Repository Summary

Description autoware.ai perf
Checkout URI https://github.com/is-whale/autoware_learn.git
VCS Type git
VCS Version 1.14
Last Updated 2025-03-14
Dev Status UNKNOWN
Released UNRELEASED
Tags No category tags.
Contributing Help Wanted (-)
Good First Issues (-)
Pull Requests to Review (-)

Package Description

The vision_ssd_detect package

Additional Links

No additional links.

Maintainers

  • amc

Authors

No additional authors.

How to Install Caffe for SSD vision detector

Updated as of 2018-07-04

  1. Complete the pre-requisites.

  2. Clone the SSD Caffe fork in your home directory (CMake files will be looking for it there).

% git clone -b ssd https://github.com/weiliu89/caffe.git ssdcaffe
% cd ssdcaffe
% git checkout 4817bf8b4200b35ada8ed0dc378dceaf38c539e4

  1. Follow the authors’ instructions to complete the pre-requisites for compilation.

  2. Compile Caffe:

make && make distribute

  1. Download pre-trained models as provided at https://github.com/weiliu89/caffe/tree/ssd, or use your own.

Once compiled, run from the terminal, or launch from RunTimeManager:

% roslaunch vision_ssd_detect vision_ssd_detect network_definition_file:=/PATH/TO/deploy.prototxt pretrained_model_file:=/PATH/TO/model.caffemodel

Remember to modify the launch file located inside AUTOWARE_BASEDIR/ros/src/computing/perception/detection/vision_detector/packages/vision_ssd_detect/launch/vision_ssd_detect.launch and point the network and pre-trained models to your paths.

Launch file params

Parameter Type Description Default
use_gpu Bool Whether to use or not GPU acceleration. true
gpu_device_id Integer ID of the GPU to be used. 0
score_threshold Double Value between 0 and 1. Defines the minimum score value to filter detections. 0.5
network_definition_file String Path to the prototxt file . $SSDCAFFEPATH/models/VGGNet/VOC0712/SSD_512x512/deploy.prototxt
pretrained_model_file String Path to the prototxt file . $SSDCAFFEPATH/models/VGGNet/VOC0712/SSD_512x512/VGG_VOC0712_SSD_512x512_iter_120000.caffemodel
camera_id String Camera ID to subscribe, i.e. camera0 /
image_src String Name of the image topic to subscribe to /image_raw

Notes

Remember to modify the deploy.prototxt to use the FULL PATH to the VOC label prototxt file.

Open the file $SSDCAFFEPATH/models/VGGNet/VOC0712/SSD_512x512/deploy.prototxt

Change line 1803 to point to the full path of the labelmap_voc.prototxt file.

CHANGELOG

Changelog for package vision_ssd_detect

1.11.0 (2019-03-21)

  • [fix] Install commands for all the packages (#1861)
    • Initial fixes to detection, sensing, semantics and utils

    • fixing wrong filename on install command

    • Fixes to install commands

    • Hokuyo fix name

    • Fix obj db

    • Obj db include fixes

    • End of final cleaning sweep

    • Incorrect command order in runtime manager

    • Param tempfile not required by runtime_manager

      • Fixes to runtime manager install commands
    • Remove devel directory from catkin, if any

    • Updated launch files for robosense

    • Updated robosense

    • Fix/add missing install (#1977)

    • Added launch install to lidar_kf_contour_track

    • Added install to op_global_planner

    • Added install to way_planner

    • Added install to op_local_planner

    • Added install to op_simulation_package

    • Added install to op_utilities

    • Added install to sync

      • Improved installation script for pointgrey packages
    • Fixed nodelet error for gmsl cameras

    • USe install space in catkin as well

    • add install to catkin

    • Fix install directives (#1990)

    • Fixed installation path

    • Fixed params installation path

    • Fixed cfg installation path

    • Delete cache on colcon_release
  • Fix license notice in corresponding package.xml
  • Fix/remove obsolete range fusion (#1884)
    • Remove obsolete range_fusion
    • Removed range_fusion ui entry
    • Remove obsolete lidar_tracker_libs_fusion
    • Removed fusion dependency from vision_ssd_detect package
  • Initial release of object filter
  • Contributors: Abraham Monrroy, Abraham Monrroy Cano, Servando, amc-nu

1.10.0 (2019-01-17)

  • Fixes for catkin_make
  • [fix] SSD detector, cmake colcon (#1837)
    • Fixes for new colcon script on ssd cuda based node

    • Fixed to RTM and darknet launch files

    • catkin_fix

      • catkin & colcon build successfully
    • reverted back run to devel space (for the time being)
  • Switch to Apache 2 license (develop branch) (#1741)
    • Switch to Apache 2

    * Replace BSD-3 license header with Apache 2 and reassign copyright to the Autoware Foundation.

    • Update license on Python files
    • Update copyright years

File truncated at 100 lines see the full file

Launch files

  • launch/vision_ssd_detect.launch
      • use_gpu [default: true]
      • gpu_device_id [default: 0]
      • score_threshold [default: 0.5]
      • network_definition_file [default: $(env HOME)/ssdcaffe/models/VGGNet/VOC0712/SSD_512x512/deploy.prototxt]
      • pretrained_model_file [default: $(env HOME)/ssdcaffe/models/VGGNet/VOC0712/SSD_512x512/VGG_VOC0712_SSD_512x512_iter_120000.caffemodel]
      • camera_id [default: /]
      • image_src [default: /image_raw]

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged vision_ssd_detect at Robotics Stack Exchange

No version for distro jazzy showing github. Known supported distros are highlighted in the buttons above.
Package symbol

vision_ssd_detect package from autoware_learn repo

amathutils_lib autoware_build_flags autoware_health_checker emergency_handler gnss lanelet2_extension libvectormap libwaypoint_follower map_file object_map op_planner op_ros_helpers op_simu op_utility ros_observer tvm_utility vector_map vector_map_server vehicle_sim_model autoware_connector ekf_localizer gnss_localizer image_processor imm_ukf_pda_track lidar_apollo_cnn_seg_detect lidar_euclidean_cluster_detect lidar_fake_perception lidar_kf_contour_track lidar_localizer lidar_naive_l_shape_detect lidar_point_pillars lidar_shape_estimation naive_motion_predict ndt_cpu ndt_gpu ndt_tku obj_db pcl_omp_registration pixel_cloud_fusion points_downsampler points_preprocessor pos_db range_vision_fusion road_occupancy_processor roi_object_filter trafficlight_recognizer twist_generator vel_pose_diff_checker vision_beyond_track vision_darknet_detect vision_lane_detect vision_segment_enet_detect vision_ssd_detect astar_search costmap_generator decision_maker dp_planner ff_waypoint_follower freespace_planner lane_planner lattice_planner ll2_global_planner mpc_follower op_global_planner op_local_planner op_simulation_package op_utilities pure_pursuit state_machine_lib twist_filter twist_gate way_planner waypoint_maker waypoint_planner autoware_quickstart_examples autoware_can_msgs autoware_config_msgs autoware_external_msgs autoware_lanelet2_msgs autoware_map_msgs autoware_msgs autoware_system_msgs tablet_socket_msgs vector_map_msgs carla_autoware_bridge gazebo_camera_description gazebo_imu_description lgsvl_simulator_bridge vehicle_gazebo_simulation_interface vehicle_gazebo_simulation_launcher wf_simulator autoware_bag_tools autoware_camera_lidar_calibrator autoware_launcher autoware_launcher_rviz calibration_publisher data_preprocessor graph_tools kitti_box_publisher kitti_launch kitti_player lanelet_aisan_converter log_tools map_tf_generator map_tools marker_downsampler mqtt_socket multi_lidar_calibrator oculus_socket pc2_downsampler rosbag_controller runtime_manager sound_player system_monitor tablet_socket twist2odom udon_socket vehicle_engage_panel vehicle_socket decision_maker_panel detected_objects_visualizer fastvirtualscan gazebo_world_description glviewer integrated_viewer points2image rosinterface autoware_rviz_plugins vehicle_description vehicle_model adi_driver as autoware_driveworks_gmsl_interface autoware_driveworks_interface vlg22c_cam custom_msgs garmin hokuyo javad_navsat_driver kvaser sick_lms5xx memsic_imu microstrain_driver nmea_navsat autoware_pointgrey_drivers sick_ldmrs_description sick_ldmrs_driver sick_ldmrs_laser sick_ldmrs_msgs sick_ldmrs_tools vectacam xsens_driver ymc ds4 ds4_driver ds4_msgs lanelet2 lanelet2_core lanelet2_examples lanelet2_io lanelet2_maps lanelet2_matching lanelet2_projection lanelet2_python lanelet2_routing lanelet2_traffic_rules lanelet2_validation mrt_cmake_modules

ROS Distro
github

Package Summary

Tags No category tags.
Version 1.12.0
License Apache 2
Build type CATKIN
Use RECOMMENDED

Repository Summary

Description autoware.ai perf
Checkout URI https://github.com/is-whale/autoware_learn.git
VCS Type git
VCS Version 1.14
Last Updated 2025-03-14
Dev Status UNKNOWN
Released UNRELEASED
Tags No category tags.
Contributing Help Wanted (-)
Good First Issues (-)
Pull Requests to Review (-)

Package Description

The vision_ssd_detect package

Additional Links

No additional links.

Maintainers

  • amc

Authors

No additional authors.

How to Install Caffe for SSD vision detector

Updated as of 2018-07-04

  1. Complete the pre-requisites.

  2. Clone the SSD Caffe fork in your home directory (CMake files will be looking for it there).

% git clone -b ssd https://github.com/weiliu89/caffe.git ssdcaffe
% cd ssdcaffe
% git checkout 4817bf8b4200b35ada8ed0dc378dceaf38c539e4

  1. Follow the authors’ instructions to complete the pre-requisites for compilation.

  2. Compile Caffe:

make && make distribute

  1. Download pre-trained models as provided at https://github.com/weiliu89/caffe/tree/ssd, or use your own.

Once compiled, run from the terminal, or launch from RunTimeManager:

% roslaunch vision_ssd_detect vision_ssd_detect network_definition_file:=/PATH/TO/deploy.prototxt pretrained_model_file:=/PATH/TO/model.caffemodel

Remember to modify the launch file located inside AUTOWARE_BASEDIR/ros/src/computing/perception/detection/vision_detector/packages/vision_ssd_detect/launch/vision_ssd_detect.launch and point the network and pre-trained models to your paths.

Launch file params

Parameter Type Description Default
use_gpu Bool Whether to use or not GPU acceleration. true
gpu_device_id Integer ID of the GPU to be used. 0
score_threshold Double Value between 0 and 1. Defines the minimum score value to filter detections. 0.5
network_definition_file String Path to the prototxt file . $SSDCAFFEPATH/models/VGGNet/VOC0712/SSD_512x512/deploy.prototxt
pretrained_model_file String Path to the prototxt file . $SSDCAFFEPATH/models/VGGNet/VOC0712/SSD_512x512/VGG_VOC0712_SSD_512x512_iter_120000.caffemodel
camera_id String Camera ID to subscribe, i.e. camera0 /
image_src String Name of the image topic to subscribe to /image_raw

Notes

Remember to modify the deploy.prototxt to use the FULL PATH to the VOC label prototxt file.

Open the file $SSDCAFFEPATH/models/VGGNet/VOC0712/SSD_512x512/deploy.prototxt

Change line 1803 to point to the full path of the labelmap_voc.prototxt file.

CHANGELOG

Changelog for package vision_ssd_detect

1.11.0 (2019-03-21)

  • [fix] Install commands for all the packages (#1861)
    • Initial fixes to detection, sensing, semantics and utils

    • fixing wrong filename on install command

    • Fixes to install commands

    • Hokuyo fix name

    • Fix obj db

    • Obj db include fixes

    • End of final cleaning sweep

    • Incorrect command order in runtime manager

    • Param tempfile not required by runtime_manager

      • Fixes to runtime manager install commands
    • Remove devel directory from catkin, if any

    • Updated launch files for robosense

    • Updated robosense

    • Fix/add missing install (#1977)

    • Added launch install to lidar_kf_contour_track

    • Added install to op_global_planner

    • Added install to way_planner

    • Added install to op_local_planner

    • Added install to op_simulation_package

    • Added install to op_utilities

    • Added install to sync

      • Improved installation script for pointgrey packages
    • Fixed nodelet error for gmsl cameras

    • USe install space in catkin as well

    • add install to catkin

    • Fix install directives (#1990)

    • Fixed installation path

    • Fixed params installation path

    • Fixed cfg installation path

    • Delete cache on colcon_release
  • Fix license notice in corresponding package.xml
  • Fix/remove obsolete range fusion (#1884)
    • Remove obsolete range_fusion
    • Removed range_fusion ui entry
    • Remove obsolete lidar_tracker_libs_fusion
    • Removed fusion dependency from vision_ssd_detect package
  • Initial release of object filter
  • Contributors: Abraham Monrroy, Abraham Monrroy Cano, Servando, amc-nu

1.10.0 (2019-01-17)

  • Fixes for catkin_make
  • [fix] SSD detector, cmake colcon (#1837)
    • Fixes for new colcon script on ssd cuda based node

    • Fixed to RTM and darknet launch files

    • catkin_fix

      • catkin & colcon build successfully
    • reverted back run to devel space (for the time being)
  • Switch to Apache 2 license (develop branch) (#1741)
    • Switch to Apache 2

    * Replace BSD-3 license header with Apache 2 and reassign copyright to the Autoware Foundation.

    • Update license on Python files
    • Update copyright years

File truncated at 100 lines see the full file

Launch files

  • launch/vision_ssd_detect.launch
      • use_gpu [default: true]
      • gpu_device_id [default: 0]
      • score_threshold [default: 0.5]
      • network_definition_file [default: $(env HOME)/ssdcaffe/models/VGGNet/VOC0712/SSD_512x512/deploy.prototxt]
      • pretrained_model_file [default: $(env HOME)/ssdcaffe/models/VGGNet/VOC0712/SSD_512x512/VGG_VOC0712_SSD_512x512_iter_120000.caffemodel]
      • camera_id [default: /]
      • image_src [default: /image_raw]

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged vision_ssd_detect at Robotics Stack Exchange

No version for distro kilted showing github. Known supported distros are highlighted in the buttons above.
Package symbol

vision_ssd_detect package from autoware_learn repo

amathutils_lib autoware_build_flags autoware_health_checker emergency_handler gnss lanelet2_extension libvectormap libwaypoint_follower map_file object_map op_planner op_ros_helpers op_simu op_utility ros_observer tvm_utility vector_map vector_map_server vehicle_sim_model autoware_connector ekf_localizer gnss_localizer image_processor imm_ukf_pda_track lidar_apollo_cnn_seg_detect lidar_euclidean_cluster_detect lidar_fake_perception lidar_kf_contour_track lidar_localizer lidar_naive_l_shape_detect lidar_point_pillars lidar_shape_estimation naive_motion_predict ndt_cpu ndt_gpu ndt_tku obj_db pcl_omp_registration pixel_cloud_fusion points_downsampler points_preprocessor pos_db range_vision_fusion road_occupancy_processor roi_object_filter trafficlight_recognizer twist_generator vel_pose_diff_checker vision_beyond_track vision_darknet_detect vision_lane_detect vision_segment_enet_detect vision_ssd_detect astar_search costmap_generator decision_maker dp_planner ff_waypoint_follower freespace_planner lane_planner lattice_planner ll2_global_planner mpc_follower op_global_planner op_local_planner op_simulation_package op_utilities pure_pursuit state_machine_lib twist_filter twist_gate way_planner waypoint_maker waypoint_planner autoware_quickstart_examples autoware_can_msgs autoware_config_msgs autoware_external_msgs autoware_lanelet2_msgs autoware_map_msgs autoware_msgs autoware_system_msgs tablet_socket_msgs vector_map_msgs carla_autoware_bridge gazebo_camera_description gazebo_imu_description lgsvl_simulator_bridge vehicle_gazebo_simulation_interface vehicle_gazebo_simulation_launcher wf_simulator autoware_bag_tools autoware_camera_lidar_calibrator autoware_launcher autoware_launcher_rviz calibration_publisher data_preprocessor graph_tools kitti_box_publisher kitti_launch kitti_player lanelet_aisan_converter log_tools map_tf_generator map_tools marker_downsampler mqtt_socket multi_lidar_calibrator oculus_socket pc2_downsampler rosbag_controller runtime_manager sound_player system_monitor tablet_socket twist2odom udon_socket vehicle_engage_panel vehicle_socket decision_maker_panel detected_objects_visualizer fastvirtualscan gazebo_world_description glviewer integrated_viewer points2image rosinterface autoware_rviz_plugins vehicle_description vehicle_model adi_driver as autoware_driveworks_gmsl_interface autoware_driveworks_interface vlg22c_cam custom_msgs garmin hokuyo javad_navsat_driver kvaser sick_lms5xx memsic_imu microstrain_driver nmea_navsat autoware_pointgrey_drivers sick_ldmrs_description sick_ldmrs_driver sick_ldmrs_laser sick_ldmrs_msgs sick_ldmrs_tools vectacam xsens_driver ymc ds4 ds4_driver ds4_msgs lanelet2 lanelet2_core lanelet2_examples lanelet2_io lanelet2_maps lanelet2_matching lanelet2_projection lanelet2_python lanelet2_routing lanelet2_traffic_rules lanelet2_validation mrt_cmake_modules

ROS Distro
github

Package Summary

Tags No category tags.
Version 1.12.0
License Apache 2
Build type CATKIN
Use RECOMMENDED

Repository Summary

Description autoware.ai perf
Checkout URI https://github.com/is-whale/autoware_learn.git
VCS Type git
VCS Version 1.14
Last Updated 2025-03-14
Dev Status UNKNOWN
Released UNRELEASED
Tags No category tags.
Contributing Help Wanted (-)
Good First Issues (-)
Pull Requests to Review (-)

Package Description

The vision_ssd_detect package

Additional Links

No additional links.

Maintainers

  • amc

Authors

No additional authors.

How to Install Caffe for SSD vision detector

Updated as of 2018-07-04

  1. Complete the pre-requisites.

  2. Clone the SSD Caffe fork in your home directory (CMake files will be looking for it there).

% git clone -b ssd https://github.com/weiliu89/caffe.git ssdcaffe
% cd ssdcaffe
% git checkout 4817bf8b4200b35ada8ed0dc378dceaf38c539e4

  1. Follow the authors’ instructions to complete the pre-requisites for compilation.

  2. Compile Caffe:

make && make distribute

  1. Download pre-trained models as provided at https://github.com/weiliu89/caffe/tree/ssd, or use your own.

Once compiled, run from the terminal, or launch from RunTimeManager:

% roslaunch vision_ssd_detect vision_ssd_detect network_definition_file:=/PATH/TO/deploy.prototxt pretrained_model_file:=/PATH/TO/model.caffemodel

Remember to modify the launch file located inside AUTOWARE_BASEDIR/ros/src/computing/perception/detection/vision_detector/packages/vision_ssd_detect/launch/vision_ssd_detect.launch and point the network and pre-trained models to your paths.

Launch file params

Parameter Type Description Default
use_gpu Bool Whether to use or not GPU acceleration. true
gpu_device_id Integer ID of the GPU to be used. 0
score_threshold Double Value between 0 and 1. Defines the minimum score value to filter detections. 0.5
network_definition_file String Path to the prototxt file . $SSDCAFFEPATH/models/VGGNet/VOC0712/SSD_512x512/deploy.prototxt
pretrained_model_file String Path to the prototxt file . $SSDCAFFEPATH/models/VGGNet/VOC0712/SSD_512x512/VGG_VOC0712_SSD_512x512_iter_120000.caffemodel
camera_id String Camera ID to subscribe, i.e. camera0 /
image_src String Name of the image topic to subscribe to /image_raw

Notes

Remember to modify the deploy.prototxt to use the FULL PATH to the VOC label prototxt file.

Open the file $SSDCAFFEPATH/models/VGGNet/VOC0712/SSD_512x512/deploy.prototxt

Change line 1803 to point to the full path of the labelmap_voc.prototxt file.

CHANGELOG

Changelog for package vision_ssd_detect

1.11.0 (2019-03-21)

  • [fix] Install commands for all the packages (#1861)
    • Initial fixes to detection, sensing, semantics and utils

    • fixing wrong filename on install command

    • Fixes to install commands

    • Hokuyo fix name

    • Fix obj db

    • Obj db include fixes

    • End of final cleaning sweep

    • Incorrect command order in runtime manager

    • Param tempfile not required by runtime_manager

      • Fixes to runtime manager install commands
    • Remove devel directory from catkin, if any

    • Updated launch files for robosense

    • Updated robosense

    • Fix/add missing install (#1977)

    • Added launch install to lidar_kf_contour_track

    • Added install to op_global_planner

    • Added install to way_planner

    • Added install to op_local_planner

    • Added install to op_simulation_package

    • Added install to op_utilities

    • Added install to sync

      • Improved installation script for pointgrey packages
    • Fixed nodelet error for gmsl cameras

    • USe install space in catkin as well

    • add install to catkin

    • Fix install directives (#1990)

    • Fixed installation path

    • Fixed params installation path

    • Fixed cfg installation path

    • Delete cache on colcon_release
  • Fix license notice in corresponding package.xml
  • Fix/remove obsolete range fusion (#1884)
    • Remove obsolete range_fusion
    • Removed range_fusion ui entry
    • Remove obsolete lidar_tracker_libs_fusion
    • Removed fusion dependency from vision_ssd_detect package
  • Initial release of object filter
  • Contributors: Abraham Monrroy, Abraham Monrroy Cano, Servando, amc-nu

1.10.0 (2019-01-17)

  • Fixes for catkin_make
  • [fix] SSD detector, cmake colcon (#1837)
    • Fixes for new colcon script on ssd cuda based node

    • Fixed to RTM and darknet launch files

    • catkin_fix

      • catkin & colcon build successfully
    • reverted back run to devel space (for the time being)
  • Switch to Apache 2 license (develop branch) (#1741)
    • Switch to Apache 2

    * Replace BSD-3 license header with Apache 2 and reassign copyright to the Autoware Foundation.

    • Update license on Python files
    • Update copyright years

File truncated at 100 lines see the full file

Launch files

  • launch/vision_ssd_detect.launch
      • use_gpu [default: true]
      • gpu_device_id [default: 0]
      • score_threshold [default: 0.5]
      • network_definition_file [default: $(env HOME)/ssdcaffe/models/VGGNet/VOC0712/SSD_512x512/deploy.prototxt]
      • pretrained_model_file [default: $(env HOME)/ssdcaffe/models/VGGNet/VOC0712/SSD_512x512/VGG_VOC0712_SSD_512x512_iter_120000.caffemodel]
      • camera_id [default: /]
      • image_src [default: /image_raw]

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged vision_ssd_detect at Robotics Stack Exchange

No version for distro rolling showing github. Known supported distros are highlighted in the buttons above.
Package symbol

vision_ssd_detect package from autoware_learn repo

amathutils_lib autoware_build_flags autoware_health_checker emergency_handler gnss lanelet2_extension libvectormap libwaypoint_follower map_file object_map op_planner op_ros_helpers op_simu op_utility ros_observer tvm_utility vector_map vector_map_server vehicle_sim_model autoware_connector ekf_localizer gnss_localizer image_processor imm_ukf_pda_track lidar_apollo_cnn_seg_detect lidar_euclidean_cluster_detect lidar_fake_perception lidar_kf_contour_track lidar_localizer lidar_naive_l_shape_detect lidar_point_pillars lidar_shape_estimation naive_motion_predict ndt_cpu ndt_gpu ndt_tku obj_db pcl_omp_registration pixel_cloud_fusion points_downsampler points_preprocessor pos_db range_vision_fusion road_occupancy_processor roi_object_filter trafficlight_recognizer twist_generator vel_pose_diff_checker vision_beyond_track vision_darknet_detect vision_lane_detect vision_segment_enet_detect vision_ssd_detect astar_search costmap_generator decision_maker dp_planner ff_waypoint_follower freespace_planner lane_planner lattice_planner ll2_global_planner mpc_follower op_global_planner op_local_planner op_simulation_package op_utilities pure_pursuit state_machine_lib twist_filter twist_gate way_planner waypoint_maker waypoint_planner autoware_quickstart_examples autoware_can_msgs autoware_config_msgs autoware_external_msgs autoware_lanelet2_msgs autoware_map_msgs autoware_msgs autoware_system_msgs tablet_socket_msgs vector_map_msgs carla_autoware_bridge gazebo_camera_description gazebo_imu_description lgsvl_simulator_bridge vehicle_gazebo_simulation_interface vehicle_gazebo_simulation_launcher wf_simulator autoware_bag_tools autoware_camera_lidar_calibrator autoware_launcher autoware_launcher_rviz calibration_publisher data_preprocessor graph_tools kitti_box_publisher kitti_launch kitti_player lanelet_aisan_converter log_tools map_tf_generator map_tools marker_downsampler mqtt_socket multi_lidar_calibrator oculus_socket pc2_downsampler rosbag_controller runtime_manager sound_player system_monitor tablet_socket twist2odom udon_socket vehicle_engage_panel vehicle_socket decision_maker_panel detected_objects_visualizer fastvirtualscan gazebo_world_description glviewer integrated_viewer points2image rosinterface autoware_rviz_plugins vehicle_description vehicle_model adi_driver as autoware_driveworks_gmsl_interface autoware_driveworks_interface vlg22c_cam custom_msgs garmin hokuyo javad_navsat_driver kvaser sick_lms5xx memsic_imu microstrain_driver nmea_navsat autoware_pointgrey_drivers sick_ldmrs_description sick_ldmrs_driver sick_ldmrs_laser sick_ldmrs_msgs sick_ldmrs_tools vectacam xsens_driver ymc ds4 ds4_driver ds4_msgs lanelet2 lanelet2_core lanelet2_examples lanelet2_io lanelet2_maps lanelet2_matching lanelet2_projection lanelet2_python lanelet2_routing lanelet2_traffic_rules lanelet2_validation mrt_cmake_modules

ROS Distro
github

Package Summary

Tags No category tags.
Version 1.12.0
License Apache 2
Build type CATKIN
Use RECOMMENDED

Repository Summary

Description autoware.ai perf
Checkout URI https://github.com/is-whale/autoware_learn.git
VCS Type git
VCS Version 1.14
Last Updated 2025-03-14
Dev Status UNKNOWN
Released UNRELEASED
Tags No category tags.
Contributing Help Wanted (-)
Good First Issues (-)
Pull Requests to Review (-)

Package Description

The vision_ssd_detect package

Additional Links

No additional links.

Maintainers

  • amc

Authors

No additional authors.

How to Install Caffe for SSD vision detector

Updated as of 2018-07-04

  1. Complete the pre-requisites.

  2. Clone the SSD Caffe fork in your home directory (CMake files will be looking for it there).

% git clone -b ssd https://github.com/weiliu89/caffe.git ssdcaffe
% cd ssdcaffe
% git checkout 4817bf8b4200b35ada8ed0dc378dceaf38c539e4

  1. Follow the authors’ instructions to complete the pre-requisites for compilation.

  2. Compile Caffe:

make && make distribute

  1. Download pre-trained models as provided at https://github.com/weiliu89/caffe/tree/ssd, or use your own.

Once compiled, run from the terminal, or launch from RunTimeManager:

% roslaunch vision_ssd_detect vision_ssd_detect network_definition_file:=/PATH/TO/deploy.prototxt pretrained_model_file:=/PATH/TO/model.caffemodel

Remember to modify the launch file located inside AUTOWARE_BASEDIR/ros/src/computing/perception/detection/vision_detector/packages/vision_ssd_detect/launch/vision_ssd_detect.launch and point the network and pre-trained models to your paths.

Launch file params

Parameter Type Description Default
use_gpu Bool Whether to use or not GPU acceleration. true
gpu_device_id Integer ID of the GPU to be used. 0
score_threshold Double Value between 0 and 1. Defines the minimum score value to filter detections. 0.5
network_definition_file String Path to the prototxt file . $SSDCAFFEPATH/models/VGGNet/VOC0712/SSD_512x512/deploy.prototxt
pretrained_model_file String Path to the prototxt file . $SSDCAFFEPATH/models/VGGNet/VOC0712/SSD_512x512/VGG_VOC0712_SSD_512x512_iter_120000.caffemodel
camera_id String Camera ID to subscribe, i.e. camera0 /
image_src String Name of the image topic to subscribe to /image_raw

Notes

Remember to modify the deploy.prototxt to use the FULL PATH to the VOC label prototxt file.

Open the file $SSDCAFFEPATH/models/VGGNet/VOC0712/SSD_512x512/deploy.prototxt

Change line 1803 to point to the full path of the labelmap_voc.prototxt file.

CHANGELOG

Changelog for package vision_ssd_detect

1.11.0 (2019-03-21)

  • [fix] Install commands for all the packages (#1861)
    • Initial fixes to detection, sensing, semantics and utils

    • fixing wrong filename on install command

    • Fixes to install commands

    • Hokuyo fix name

    • Fix obj db

    • Obj db include fixes

    • End of final cleaning sweep

    • Incorrect command order in runtime manager

    • Param tempfile not required by runtime_manager

      • Fixes to runtime manager install commands
    • Remove devel directory from catkin, if any

    • Updated launch files for robosense

    • Updated robosense

    • Fix/add missing install (#1977)

    • Added launch install to lidar_kf_contour_track

    • Added install to op_global_planner

    • Added install to way_planner

    • Added install to op_local_planner

    • Added install to op_simulation_package

    • Added install to op_utilities

    • Added install to sync

      • Improved installation script for pointgrey packages
    • Fixed nodelet error for gmsl cameras

    • USe install space in catkin as well

    • add install to catkin

    • Fix install directives (#1990)

    • Fixed installation path

    • Fixed params installation path

    • Fixed cfg installation path

    • Delete cache on colcon_release
  • Fix license notice in corresponding package.xml
  • Fix/remove obsolete range fusion (#1884)
    • Remove obsolete range_fusion
    • Removed range_fusion ui entry
    • Remove obsolete lidar_tracker_libs_fusion
    • Removed fusion dependency from vision_ssd_detect package
  • Initial release of object filter
  • Contributors: Abraham Monrroy, Abraham Monrroy Cano, Servando, amc-nu

1.10.0 (2019-01-17)

  • Fixes for catkin_make
  • [fix] SSD detector, cmake colcon (#1837)
    • Fixes for new colcon script on ssd cuda based node

    • Fixed to RTM and darknet launch files

    • catkin_fix

      • catkin & colcon build successfully
    • reverted back run to devel space (for the time being)
  • Switch to Apache 2 license (develop branch) (#1741)
    • Switch to Apache 2

    * Replace BSD-3 license header with Apache 2 and reassign copyright to the Autoware Foundation.

    • Update license on Python files
    • Update copyright years

File truncated at 100 lines see the full file

Launch files

  • launch/vision_ssd_detect.launch
      • use_gpu [default: true]
      • gpu_device_id [default: 0]
      • score_threshold [default: 0.5]
      • network_definition_file [default: $(env HOME)/ssdcaffe/models/VGGNet/VOC0712/SSD_512x512/deploy.prototxt]
      • pretrained_model_file [default: $(env HOME)/ssdcaffe/models/VGGNet/VOC0712/SSD_512x512/VGG_VOC0712_SSD_512x512_iter_120000.caffemodel]
      • camera_id [default: /]
      • image_src [default: /image_raw]

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged vision_ssd_detect at Robotics Stack Exchange

Package symbol

vision_ssd_detect package from autoware_learn repo

amathutils_lib autoware_build_flags autoware_health_checker emergency_handler gnss lanelet2_extension libvectormap libwaypoint_follower map_file object_map op_planner op_ros_helpers op_simu op_utility ros_observer tvm_utility vector_map vector_map_server vehicle_sim_model autoware_connector ekf_localizer gnss_localizer image_processor imm_ukf_pda_track lidar_apollo_cnn_seg_detect lidar_euclidean_cluster_detect lidar_fake_perception lidar_kf_contour_track lidar_localizer lidar_naive_l_shape_detect lidar_point_pillars lidar_shape_estimation naive_motion_predict ndt_cpu ndt_gpu ndt_tku obj_db pcl_omp_registration pixel_cloud_fusion points_downsampler points_preprocessor pos_db range_vision_fusion road_occupancy_processor roi_object_filter trafficlight_recognizer twist_generator vel_pose_diff_checker vision_beyond_track vision_darknet_detect vision_lane_detect vision_segment_enet_detect vision_ssd_detect astar_search costmap_generator decision_maker dp_planner ff_waypoint_follower freespace_planner lane_planner lattice_planner ll2_global_planner mpc_follower op_global_planner op_local_planner op_simulation_package op_utilities pure_pursuit state_machine_lib twist_filter twist_gate way_planner waypoint_maker waypoint_planner autoware_quickstart_examples autoware_can_msgs autoware_config_msgs autoware_external_msgs autoware_lanelet2_msgs autoware_map_msgs autoware_msgs autoware_system_msgs tablet_socket_msgs vector_map_msgs carla_autoware_bridge gazebo_camera_description gazebo_imu_description lgsvl_simulator_bridge vehicle_gazebo_simulation_interface vehicle_gazebo_simulation_launcher wf_simulator autoware_bag_tools autoware_camera_lidar_calibrator autoware_launcher autoware_launcher_rviz calibration_publisher data_preprocessor graph_tools kitti_box_publisher kitti_launch kitti_player lanelet_aisan_converter log_tools map_tf_generator map_tools marker_downsampler mqtt_socket multi_lidar_calibrator oculus_socket pc2_downsampler rosbag_controller runtime_manager sound_player system_monitor tablet_socket twist2odom udon_socket vehicle_engage_panel vehicle_socket decision_maker_panel detected_objects_visualizer fastvirtualscan gazebo_world_description glviewer integrated_viewer points2image rosinterface autoware_rviz_plugins vehicle_description vehicle_model adi_driver as autoware_driveworks_gmsl_interface autoware_driveworks_interface vlg22c_cam custom_msgs garmin hokuyo javad_navsat_driver kvaser sick_lms5xx memsic_imu microstrain_driver nmea_navsat autoware_pointgrey_drivers sick_ldmrs_description sick_ldmrs_driver sick_ldmrs_laser sick_ldmrs_msgs sick_ldmrs_tools vectacam xsens_driver ymc ds4 ds4_driver ds4_msgs lanelet2 lanelet2_core lanelet2_examples lanelet2_io lanelet2_maps lanelet2_matching lanelet2_projection lanelet2_python lanelet2_routing lanelet2_traffic_rules lanelet2_validation mrt_cmake_modules

ROS Distro
github

Package Summary

Tags No category tags.
Version 1.12.0
License Apache 2
Build type CATKIN
Use RECOMMENDED

Repository Summary

Description autoware.ai perf
Checkout URI https://github.com/is-whale/autoware_learn.git
VCS Type git
VCS Version 1.14
Last Updated 2025-03-14
Dev Status UNKNOWN
Released UNRELEASED
Tags No category tags.
Contributing Help Wanted (-)
Good First Issues (-)
Pull Requests to Review (-)

Package Description

The vision_ssd_detect package

Additional Links

No additional links.

Maintainers

  • amc

Authors

No additional authors.

How to Install Caffe for SSD vision detector

Updated as of 2018-07-04

  1. Complete the pre-requisites.

  2. Clone the SSD Caffe fork in your home directory (CMake files will be looking for it there).

% git clone -b ssd https://github.com/weiliu89/caffe.git ssdcaffe
% cd ssdcaffe
% git checkout 4817bf8b4200b35ada8ed0dc378dceaf38c539e4

  1. Follow the authors’ instructions to complete the pre-requisites for compilation.

  2. Compile Caffe:

make && make distribute

  1. Download pre-trained models as provided at https://github.com/weiliu89/caffe/tree/ssd, or use your own.

Once compiled, run from the terminal, or launch from RunTimeManager:

% roslaunch vision_ssd_detect vision_ssd_detect network_definition_file:=/PATH/TO/deploy.prototxt pretrained_model_file:=/PATH/TO/model.caffemodel

Remember to modify the launch file located inside AUTOWARE_BASEDIR/ros/src/computing/perception/detection/vision_detector/packages/vision_ssd_detect/launch/vision_ssd_detect.launch and point the network and pre-trained models to your paths.

Launch file params

Parameter Type Description Default
use_gpu Bool Whether to use or not GPU acceleration. true
gpu_device_id Integer ID of the GPU to be used. 0
score_threshold Double Value between 0 and 1. Defines the minimum score value to filter detections. 0.5
network_definition_file String Path to the prototxt file . $SSDCAFFEPATH/models/VGGNet/VOC0712/SSD_512x512/deploy.prototxt
pretrained_model_file String Path to the prototxt file . $SSDCAFFEPATH/models/VGGNet/VOC0712/SSD_512x512/VGG_VOC0712_SSD_512x512_iter_120000.caffemodel
camera_id String Camera ID to subscribe, i.e. camera0 /
image_src String Name of the image topic to subscribe to /image_raw

Notes

Remember to modify the deploy.prototxt to use the FULL PATH to the VOC label prototxt file.

Open the file $SSDCAFFEPATH/models/VGGNet/VOC0712/SSD_512x512/deploy.prototxt

Change line 1803 to point to the full path of the labelmap_voc.prototxt file.

CHANGELOG

Changelog for package vision_ssd_detect

1.11.0 (2019-03-21)

  • [fix] Install commands for all the packages (#1861)
    • Initial fixes to detection, sensing, semantics and utils

    • fixing wrong filename on install command

    • Fixes to install commands

    • Hokuyo fix name

    • Fix obj db

    • Obj db include fixes

    • End of final cleaning sweep

    • Incorrect command order in runtime manager

    • Param tempfile not required by runtime_manager

      • Fixes to runtime manager install commands
    • Remove devel directory from catkin, if any

    • Updated launch files for robosense

    • Updated robosense

    • Fix/add missing install (#1977)

    • Added launch install to lidar_kf_contour_track

    • Added install to op_global_planner

    • Added install to way_planner

    • Added install to op_local_planner

    • Added install to op_simulation_package

    • Added install to op_utilities

    • Added install to sync

      • Improved installation script for pointgrey packages
    • Fixed nodelet error for gmsl cameras

    • USe install space in catkin as well

    • add install to catkin

    • Fix install directives (#1990)

    • Fixed installation path

    • Fixed params installation path

    • Fixed cfg installation path

    • Delete cache on colcon_release
  • Fix license notice in corresponding package.xml
  • Fix/remove obsolete range fusion (#1884)
    • Remove obsolete range_fusion
    • Removed range_fusion ui entry
    • Remove obsolete lidar_tracker_libs_fusion
    • Removed fusion dependency from vision_ssd_detect package
  • Initial release of object filter
  • Contributors: Abraham Monrroy, Abraham Monrroy Cano, Servando, amc-nu

1.10.0 (2019-01-17)

  • Fixes for catkin_make
  • [fix] SSD detector, cmake colcon (#1837)
    • Fixes for new colcon script on ssd cuda based node

    • Fixed to RTM and darknet launch files

    • catkin_fix

      • catkin & colcon build successfully
    • reverted back run to devel space (for the time being)
  • Switch to Apache 2 license (develop branch) (#1741)
    • Switch to Apache 2

    * Replace BSD-3 license header with Apache 2 and reassign copyright to the Autoware Foundation.

    • Update license on Python files
    • Update copyright years

File truncated at 100 lines see the full file

Launch files

  • launch/vision_ssd_detect.launch
      • use_gpu [default: true]
      • gpu_device_id [default: 0]
      • score_threshold [default: 0.5]
      • network_definition_file [default: $(env HOME)/ssdcaffe/models/VGGNet/VOC0712/SSD_512x512/deploy.prototxt]
      • pretrained_model_file [default: $(env HOME)/ssdcaffe/models/VGGNet/VOC0712/SSD_512x512/VGG_VOC0712_SSD_512x512_iter_120000.caffemodel]
      • camera_id [default: /]
      • image_src [default: /image_raw]

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged vision_ssd_detect at Robotics Stack Exchange

No version for distro galactic showing github. Known supported distros are highlighted in the buttons above.
Package symbol

vision_ssd_detect package from autoware_learn repo

amathutils_lib autoware_build_flags autoware_health_checker emergency_handler gnss lanelet2_extension libvectormap libwaypoint_follower map_file object_map op_planner op_ros_helpers op_simu op_utility ros_observer tvm_utility vector_map vector_map_server vehicle_sim_model autoware_connector ekf_localizer gnss_localizer image_processor imm_ukf_pda_track lidar_apollo_cnn_seg_detect lidar_euclidean_cluster_detect lidar_fake_perception lidar_kf_contour_track lidar_localizer lidar_naive_l_shape_detect lidar_point_pillars lidar_shape_estimation naive_motion_predict ndt_cpu ndt_gpu ndt_tku obj_db pcl_omp_registration pixel_cloud_fusion points_downsampler points_preprocessor pos_db range_vision_fusion road_occupancy_processor roi_object_filter trafficlight_recognizer twist_generator vel_pose_diff_checker vision_beyond_track vision_darknet_detect vision_lane_detect vision_segment_enet_detect vision_ssd_detect astar_search costmap_generator decision_maker dp_planner ff_waypoint_follower freespace_planner lane_planner lattice_planner ll2_global_planner mpc_follower op_global_planner op_local_planner op_simulation_package op_utilities pure_pursuit state_machine_lib twist_filter twist_gate way_planner waypoint_maker waypoint_planner autoware_quickstart_examples autoware_can_msgs autoware_config_msgs autoware_external_msgs autoware_lanelet2_msgs autoware_map_msgs autoware_msgs autoware_system_msgs tablet_socket_msgs vector_map_msgs carla_autoware_bridge gazebo_camera_description gazebo_imu_description lgsvl_simulator_bridge vehicle_gazebo_simulation_interface vehicle_gazebo_simulation_launcher wf_simulator autoware_bag_tools autoware_camera_lidar_calibrator autoware_launcher autoware_launcher_rviz calibration_publisher data_preprocessor graph_tools kitti_box_publisher kitti_launch kitti_player lanelet_aisan_converter log_tools map_tf_generator map_tools marker_downsampler mqtt_socket multi_lidar_calibrator oculus_socket pc2_downsampler rosbag_controller runtime_manager sound_player system_monitor tablet_socket twist2odom udon_socket vehicle_engage_panel vehicle_socket decision_maker_panel detected_objects_visualizer fastvirtualscan gazebo_world_description glviewer integrated_viewer points2image rosinterface autoware_rviz_plugins vehicle_description vehicle_model adi_driver as autoware_driveworks_gmsl_interface autoware_driveworks_interface vlg22c_cam custom_msgs garmin hokuyo javad_navsat_driver kvaser sick_lms5xx memsic_imu microstrain_driver nmea_navsat autoware_pointgrey_drivers sick_ldmrs_description sick_ldmrs_driver sick_ldmrs_laser sick_ldmrs_msgs sick_ldmrs_tools vectacam xsens_driver ymc ds4 ds4_driver ds4_msgs lanelet2 lanelet2_core lanelet2_examples lanelet2_io lanelet2_maps lanelet2_matching lanelet2_projection lanelet2_python lanelet2_routing lanelet2_traffic_rules lanelet2_validation mrt_cmake_modules

ROS Distro
github

Package Summary

Tags No category tags.
Version 1.12.0
License Apache 2
Build type CATKIN
Use RECOMMENDED

Repository Summary

Description autoware.ai perf
Checkout URI https://github.com/is-whale/autoware_learn.git
VCS Type git
VCS Version 1.14
Last Updated 2025-03-14
Dev Status UNKNOWN
Released UNRELEASED
Tags No category tags.
Contributing Help Wanted (-)
Good First Issues (-)
Pull Requests to Review (-)

Package Description

The vision_ssd_detect package

Additional Links

No additional links.

Maintainers

  • amc

Authors

No additional authors.

How to Install Caffe for SSD vision detector

Updated as of 2018-07-04

  1. Complete the pre-requisites.

  2. Clone the SSD Caffe fork in your home directory (CMake files will be looking for it there).

% git clone -b ssd https://github.com/weiliu89/caffe.git ssdcaffe
% cd ssdcaffe
% git checkout 4817bf8b4200b35ada8ed0dc378dceaf38c539e4

  1. Follow the authors’ instructions to complete the pre-requisites for compilation.

  2. Compile Caffe:

make && make distribute

  1. Download pre-trained models as provided at https://github.com/weiliu89/caffe/tree/ssd, or use your own.

Once compiled, run from the terminal, or launch from RunTimeManager:

% roslaunch vision_ssd_detect vision_ssd_detect network_definition_file:=/PATH/TO/deploy.prototxt pretrained_model_file:=/PATH/TO/model.caffemodel

Remember to modify the launch file located inside AUTOWARE_BASEDIR/ros/src/computing/perception/detection/vision_detector/packages/vision_ssd_detect/launch/vision_ssd_detect.launch and point the network and pre-trained models to your paths.

Launch file params

Parameter Type Description Default
use_gpu Bool Whether to use or not GPU acceleration. true
gpu_device_id Integer ID of the GPU to be used. 0
score_threshold Double Value between 0 and 1. Defines the minimum score value to filter detections. 0.5
network_definition_file String Path to the prototxt file . $SSDCAFFEPATH/models/VGGNet/VOC0712/SSD_512x512/deploy.prototxt
pretrained_model_file String Path to the prototxt file . $SSDCAFFEPATH/models/VGGNet/VOC0712/SSD_512x512/VGG_VOC0712_SSD_512x512_iter_120000.caffemodel
camera_id String Camera ID to subscribe, i.e. camera0 /
image_src String Name of the image topic to subscribe to /image_raw

Notes

Remember to modify the deploy.prototxt to use the FULL PATH to the VOC label prototxt file.

Open the file $SSDCAFFEPATH/models/VGGNet/VOC0712/SSD_512x512/deploy.prototxt

Change line 1803 to point to the full path of the labelmap_voc.prototxt file.

CHANGELOG

Changelog for package vision_ssd_detect

1.11.0 (2019-03-21)

  • [fix] Install commands for all the packages (#1861)
    • Initial fixes to detection, sensing, semantics and utils

    • fixing wrong filename on install command

    • Fixes to install commands

    • Hokuyo fix name

    • Fix obj db

    • Obj db include fixes

    • End of final cleaning sweep

    • Incorrect command order in runtime manager

    • Param tempfile not required by runtime_manager

      • Fixes to runtime manager install commands
    • Remove devel directory from catkin, if any

    • Updated launch files for robosense

    • Updated robosense

    • Fix/add missing install (#1977)

    • Added launch install to lidar_kf_contour_track

    • Added install to op_global_planner

    • Added install to way_planner

    • Added install to op_local_planner

    • Added install to op_simulation_package

    • Added install to op_utilities

    • Added install to sync

      • Improved installation script for pointgrey packages
    • Fixed nodelet error for gmsl cameras

    • USe install space in catkin as well

    • add install to catkin

    • Fix install directives (#1990)

    • Fixed installation path

    • Fixed params installation path

    • Fixed cfg installation path

    • Delete cache on colcon_release
  • Fix license notice in corresponding package.xml
  • Fix/remove obsolete range fusion (#1884)
    • Remove obsolete range_fusion
    • Removed range_fusion ui entry
    • Remove obsolete lidar_tracker_libs_fusion
    • Removed fusion dependency from vision_ssd_detect package
  • Initial release of object filter
  • Contributors: Abraham Monrroy, Abraham Monrroy Cano, Servando, amc-nu

1.10.0 (2019-01-17)

  • Fixes for catkin_make
  • [fix] SSD detector, cmake colcon (#1837)
    • Fixes for new colcon script on ssd cuda based node

    • Fixed to RTM and darknet launch files

    • catkin_fix

      • catkin & colcon build successfully
    • reverted back run to devel space (for the time being)
  • Switch to Apache 2 license (develop branch) (#1741)
    • Switch to Apache 2

    * Replace BSD-3 license header with Apache 2 and reassign copyright to the Autoware Foundation.

    • Update license on Python files
    • Update copyright years

File truncated at 100 lines see the full file

Launch files

  • launch/vision_ssd_detect.launch
      • use_gpu [default: true]
      • gpu_device_id [default: 0]
      • score_threshold [default: 0.5]
      • network_definition_file [default: $(env HOME)/ssdcaffe/models/VGGNet/VOC0712/SSD_512x512/deploy.prototxt]
      • pretrained_model_file [default: $(env HOME)/ssdcaffe/models/VGGNet/VOC0712/SSD_512x512/VGG_VOC0712_SSD_512x512_iter_120000.caffemodel]
      • camera_id [default: /]
      • image_src [default: /image_raw]

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged vision_ssd_detect at Robotics Stack Exchange

No version for distro iron showing github. Known supported distros are highlighted in the buttons above.
Package symbol

vision_ssd_detect package from autoware_learn repo

amathutils_lib autoware_build_flags autoware_health_checker emergency_handler gnss lanelet2_extension libvectormap libwaypoint_follower map_file object_map op_planner op_ros_helpers op_simu op_utility ros_observer tvm_utility vector_map vector_map_server vehicle_sim_model autoware_connector ekf_localizer gnss_localizer image_processor imm_ukf_pda_track lidar_apollo_cnn_seg_detect lidar_euclidean_cluster_detect lidar_fake_perception lidar_kf_contour_track lidar_localizer lidar_naive_l_shape_detect lidar_point_pillars lidar_shape_estimation naive_motion_predict ndt_cpu ndt_gpu ndt_tku obj_db pcl_omp_registration pixel_cloud_fusion points_downsampler points_preprocessor pos_db range_vision_fusion road_occupancy_processor roi_object_filter trafficlight_recognizer twist_generator vel_pose_diff_checker vision_beyond_track vision_darknet_detect vision_lane_detect vision_segment_enet_detect vision_ssd_detect astar_search costmap_generator decision_maker dp_planner ff_waypoint_follower freespace_planner lane_planner lattice_planner ll2_global_planner mpc_follower op_global_planner op_local_planner op_simulation_package op_utilities pure_pursuit state_machine_lib twist_filter twist_gate way_planner waypoint_maker waypoint_planner autoware_quickstart_examples autoware_can_msgs autoware_config_msgs autoware_external_msgs autoware_lanelet2_msgs autoware_map_msgs autoware_msgs autoware_system_msgs tablet_socket_msgs vector_map_msgs carla_autoware_bridge gazebo_camera_description gazebo_imu_description lgsvl_simulator_bridge vehicle_gazebo_simulation_interface vehicle_gazebo_simulation_launcher wf_simulator autoware_bag_tools autoware_camera_lidar_calibrator autoware_launcher autoware_launcher_rviz calibration_publisher data_preprocessor graph_tools kitti_box_publisher kitti_launch kitti_player lanelet_aisan_converter log_tools map_tf_generator map_tools marker_downsampler mqtt_socket multi_lidar_calibrator oculus_socket pc2_downsampler rosbag_controller runtime_manager sound_player system_monitor tablet_socket twist2odom udon_socket vehicle_engage_panel vehicle_socket decision_maker_panel detected_objects_visualizer fastvirtualscan gazebo_world_description glviewer integrated_viewer points2image rosinterface autoware_rviz_plugins vehicle_description vehicle_model adi_driver as autoware_driveworks_gmsl_interface autoware_driveworks_interface vlg22c_cam custom_msgs garmin hokuyo javad_navsat_driver kvaser sick_lms5xx memsic_imu microstrain_driver nmea_navsat autoware_pointgrey_drivers sick_ldmrs_description sick_ldmrs_driver sick_ldmrs_laser sick_ldmrs_msgs sick_ldmrs_tools vectacam xsens_driver ymc ds4 ds4_driver ds4_msgs lanelet2 lanelet2_core lanelet2_examples lanelet2_io lanelet2_maps lanelet2_matching lanelet2_projection lanelet2_python lanelet2_routing lanelet2_traffic_rules lanelet2_validation mrt_cmake_modules

ROS Distro
github

Package Summary

Tags No category tags.
Version 1.12.0
License Apache 2
Build type CATKIN
Use RECOMMENDED

Repository Summary

Description autoware.ai perf
Checkout URI https://github.com/is-whale/autoware_learn.git
VCS Type git
VCS Version 1.14
Last Updated 2025-03-14
Dev Status UNKNOWN
Released UNRELEASED
Tags No category tags.
Contributing Help Wanted (-)
Good First Issues (-)
Pull Requests to Review (-)

Package Description

The vision_ssd_detect package

Additional Links

No additional links.

Maintainers

  • amc

Authors

No additional authors.

How to Install Caffe for SSD vision detector

Updated as of 2018-07-04

  1. Complete the pre-requisites.

  2. Clone the SSD Caffe fork in your home directory (CMake files will be looking for it there).

% git clone -b ssd https://github.com/weiliu89/caffe.git ssdcaffe
% cd ssdcaffe
% git checkout 4817bf8b4200b35ada8ed0dc378dceaf38c539e4

  1. Follow the authors’ instructions to complete the pre-requisites for compilation.

  2. Compile Caffe:

make && make distribute

  1. Download pre-trained models as provided at https://github.com/weiliu89/caffe/tree/ssd, or use your own.

Once compiled, run from the terminal, or launch from RunTimeManager:

% roslaunch vision_ssd_detect vision_ssd_detect network_definition_file:=/PATH/TO/deploy.prototxt pretrained_model_file:=/PATH/TO/model.caffemodel

Remember to modify the launch file located inside AUTOWARE_BASEDIR/ros/src/computing/perception/detection/vision_detector/packages/vision_ssd_detect/launch/vision_ssd_detect.launch and point the network and pre-trained models to your paths.

Launch file params

Parameter Type Description Default
use_gpu Bool Whether to use or not GPU acceleration. true
gpu_device_id Integer ID of the GPU to be used. 0
score_threshold Double Value between 0 and 1. Defines the minimum score value to filter detections. 0.5
network_definition_file String Path to the prototxt file . $SSDCAFFEPATH/models/VGGNet/VOC0712/SSD_512x512/deploy.prototxt
pretrained_model_file String Path to the prototxt file . $SSDCAFFEPATH/models/VGGNet/VOC0712/SSD_512x512/VGG_VOC0712_SSD_512x512_iter_120000.caffemodel
camera_id String Camera ID to subscribe, i.e. camera0 /
image_src String Name of the image topic to subscribe to /image_raw

Notes

Remember to modify the deploy.prototxt to use the FULL PATH to the VOC label prototxt file.

Open the file $SSDCAFFEPATH/models/VGGNet/VOC0712/SSD_512x512/deploy.prototxt

Change line 1803 to point to the full path of the labelmap_voc.prototxt file.

CHANGELOG

Changelog for package vision_ssd_detect

1.11.0 (2019-03-21)

  • [fix] Install commands for all the packages (#1861)
    • Initial fixes to detection, sensing, semantics and utils

    • fixing wrong filename on install command

    • Fixes to install commands

    • Hokuyo fix name

    • Fix obj db

    • Obj db include fixes

    • End of final cleaning sweep

    • Incorrect command order in runtime manager

    • Param tempfile not required by runtime_manager

      • Fixes to runtime manager install commands
    • Remove devel directory from catkin, if any

    • Updated launch files for robosense

    • Updated robosense

    • Fix/add missing install (#1977)

    • Added launch install to lidar_kf_contour_track

    • Added install to op_global_planner

    • Added install to way_planner

    • Added install to op_local_planner

    • Added install to op_simulation_package

    • Added install to op_utilities

    • Added install to sync

      • Improved installation script for pointgrey packages
    • Fixed nodelet error for gmsl cameras

    • USe install space in catkin as well

    • add install to catkin

    • Fix install directives (#1990)

    • Fixed installation path

    • Fixed params installation path

    • Fixed cfg installation path

    • Delete cache on colcon_release
  • Fix license notice in corresponding package.xml
  • Fix/remove obsolete range fusion (#1884)
    • Remove obsolete range_fusion
    • Removed range_fusion ui entry
    • Remove obsolete lidar_tracker_libs_fusion
    • Removed fusion dependency from vision_ssd_detect package
  • Initial release of object filter
  • Contributors: Abraham Monrroy, Abraham Monrroy Cano, Servando, amc-nu

1.10.0 (2019-01-17)

  • Fixes for catkin_make
  • [fix] SSD detector, cmake colcon (#1837)
    • Fixes for new colcon script on ssd cuda based node

    • Fixed to RTM and darknet launch files

    • catkin_fix

      • catkin & colcon build successfully
    • reverted back run to devel space (for the time being)
  • Switch to Apache 2 license (develop branch) (#1741)
    • Switch to Apache 2

    * Replace BSD-3 license header with Apache 2 and reassign copyright to the Autoware Foundation.

    • Update license on Python files
    • Update copyright years

File truncated at 100 lines see the full file

Launch files

  • launch/vision_ssd_detect.launch
      • use_gpu [default: true]
      • gpu_device_id [default: 0]
      • score_threshold [default: 0.5]
      • network_definition_file [default: $(env HOME)/ssdcaffe/models/VGGNet/VOC0712/SSD_512x512/deploy.prototxt]
      • pretrained_model_file [default: $(env HOME)/ssdcaffe/models/VGGNet/VOC0712/SSD_512x512/VGG_VOC0712_SSD_512x512_iter_120000.caffemodel]
      • camera_id [default: /]
      • image_src [default: /image_raw]

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged vision_ssd_detect at Robotics Stack Exchange

No version for distro melodic showing github. Known supported distros are highlighted in the buttons above.
Package symbol

vision_ssd_detect package from autoware_learn repo

amathutils_lib autoware_build_flags autoware_health_checker emergency_handler gnss lanelet2_extension libvectormap libwaypoint_follower map_file object_map op_planner op_ros_helpers op_simu op_utility ros_observer tvm_utility vector_map vector_map_server vehicle_sim_model autoware_connector ekf_localizer gnss_localizer image_processor imm_ukf_pda_track lidar_apollo_cnn_seg_detect lidar_euclidean_cluster_detect lidar_fake_perception lidar_kf_contour_track lidar_localizer lidar_naive_l_shape_detect lidar_point_pillars lidar_shape_estimation naive_motion_predict ndt_cpu ndt_gpu ndt_tku obj_db pcl_omp_registration pixel_cloud_fusion points_downsampler points_preprocessor pos_db range_vision_fusion road_occupancy_processor roi_object_filter trafficlight_recognizer twist_generator vel_pose_diff_checker vision_beyond_track vision_darknet_detect vision_lane_detect vision_segment_enet_detect vision_ssd_detect astar_search costmap_generator decision_maker dp_planner ff_waypoint_follower freespace_planner lane_planner lattice_planner ll2_global_planner mpc_follower op_global_planner op_local_planner op_simulation_package op_utilities pure_pursuit state_machine_lib twist_filter twist_gate way_planner waypoint_maker waypoint_planner autoware_quickstart_examples autoware_can_msgs autoware_config_msgs autoware_external_msgs autoware_lanelet2_msgs autoware_map_msgs autoware_msgs autoware_system_msgs tablet_socket_msgs vector_map_msgs carla_autoware_bridge gazebo_camera_description gazebo_imu_description lgsvl_simulator_bridge vehicle_gazebo_simulation_interface vehicle_gazebo_simulation_launcher wf_simulator autoware_bag_tools autoware_camera_lidar_calibrator autoware_launcher autoware_launcher_rviz calibration_publisher data_preprocessor graph_tools kitti_box_publisher kitti_launch kitti_player lanelet_aisan_converter log_tools map_tf_generator map_tools marker_downsampler mqtt_socket multi_lidar_calibrator oculus_socket pc2_downsampler rosbag_controller runtime_manager sound_player system_monitor tablet_socket twist2odom udon_socket vehicle_engage_panel vehicle_socket decision_maker_panel detected_objects_visualizer fastvirtualscan gazebo_world_description glviewer integrated_viewer points2image rosinterface autoware_rviz_plugins vehicle_description vehicle_model adi_driver as autoware_driveworks_gmsl_interface autoware_driveworks_interface vlg22c_cam custom_msgs garmin hokuyo javad_navsat_driver kvaser sick_lms5xx memsic_imu microstrain_driver nmea_navsat autoware_pointgrey_drivers sick_ldmrs_description sick_ldmrs_driver sick_ldmrs_laser sick_ldmrs_msgs sick_ldmrs_tools vectacam xsens_driver ymc ds4 ds4_driver ds4_msgs lanelet2 lanelet2_core lanelet2_examples lanelet2_io lanelet2_maps lanelet2_matching lanelet2_projection lanelet2_python lanelet2_routing lanelet2_traffic_rules lanelet2_validation mrt_cmake_modules

ROS Distro
github

Package Summary

Tags No category tags.
Version 1.12.0
License Apache 2
Build type CATKIN
Use RECOMMENDED

Repository Summary

Description autoware.ai perf
Checkout URI https://github.com/is-whale/autoware_learn.git
VCS Type git
VCS Version 1.14
Last Updated 2025-03-14
Dev Status UNKNOWN
Released UNRELEASED
Tags No category tags.
Contributing Help Wanted (-)
Good First Issues (-)
Pull Requests to Review (-)

Package Description

The vision_ssd_detect package

Additional Links

No additional links.

Maintainers

  • amc

Authors

No additional authors.

How to Install Caffe for SSD vision detector

Updated as of 2018-07-04

  1. Complete the pre-requisites.

  2. Clone the SSD Caffe fork in your home directory (CMake files will be looking for it there).

% git clone -b ssd https://github.com/weiliu89/caffe.git ssdcaffe
% cd ssdcaffe
% git checkout 4817bf8b4200b35ada8ed0dc378dceaf38c539e4

  1. Follow the authors’ instructions to complete the pre-requisites for compilation.

  2. Compile Caffe:

make && make distribute

  1. Download pre-trained models as provided at https://github.com/weiliu89/caffe/tree/ssd, or use your own.

Once compiled, run from the terminal, or launch from RunTimeManager:

% roslaunch vision_ssd_detect vision_ssd_detect network_definition_file:=/PATH/TO/deploy.prototxt pretrained_model_file:=/PATH/TO/model.caffemodel

Remember to modify the launch file located inside AUTOWARE_BASEDIR/ros/src/computing/perception/detection/vision_detector/packages/vision_ssd_detect/launch/vision_ssd_detect.launch and point the network and pre-trained models to your paths.

Launch file params

Parameter Type Description Default
use_gpu Bool Whether to use or not GPU acceleration. true
gpu_device_id Integer ID of the GPU to be used. 0
score_threshold Double Value between 0 and 1. Defines the minimum score value to filter detections. 0.5
network_definition_file String Path to the prototxt file . $SSDCAFFEPATH/models/VGGNet/VOC0712/SSD_512x512/deploy.prototxt
pretrained_model_file String Path to the prototxt file . $SSDCAFFEPATH/models/VGGNet/VOC0712/SSD_512x512/VGG_VOC0712_SSD_512x512_iter_120000.caffemodel
camera_id String Camera ID to subscribe, i.e. camera0 /
image_src String Name of the image topic to subscribe to /image_raw

Notes

Remember to modify the deploy.prototxt to use the FULL PATH to the VOC label prototxt file.

Open the file $SSDCAFFEPATH/models/VGGNet/VOC0712/SSD_512x512/deploy.prototxt

Change line 1803 to point to the full path of the labelmap_voc.prototxt file.

CHANGELOG

Changelog for package vision_ssd_detect

1.11.0 (2019-03-21)

  • [fix] Install commands for all the packages (#1861)
    • Initial fixes to detection, sensing, semantics and utils

    • fixing wrong filename on install command

    • Fixes to install commands

    • Hokuyo fix name

    • Fix obj db

    • Obj db include fixes

    • End of final cleaning sweep

    • Incorrect command order in runtime manager

    • Param tempfile not required by runtime_manager

      • Fixes to runtime manager install commands
    • Remove devel directory from catkin, if any

    • Updated launch files for robosense

    • Updated robosense

    • Fix/add missing install (#1977)

    • Added launch install to lidar_kf_contour_track

    • Added install to op_global_planner

    • Added install to way_planner

    • Added install to op_local_planner

    • Added install to op_simulation_package

    • Added install to op_utilities

    • Added install to sync

      • Improved installation script for pointgrey packages
    • Fixed nodelet error for gmsl cameras

    • USe install space in catkin as well

    • add install to catkin

    • Fix install directives (#1990)

    • Fixed installation path

    • Fixed params installation path

    • Fixed cfg installation path

    • Delete cache on colcon_release
  • Fix license notice in corresponding package.xml
  • Fix/remove obsolete range fusion (#1884)
    • Remove obsolete range_fusion
    • Removed range_fusion ui entry
    • Remove obsolete lidar_tracker_libs_fusion
    • Removed fusion dependency from vision_ssd_detect package
  • Initial release of object filter
  • Contributors: Abraham Monrroy, Abraham Monrroy Cano, Servando, amc-nu

1.10.0 (2019-01-17)

  • Fixes for catkin_make
  • [fix] SSD detector, cmake colcon (#1837)
    • Fixes for new colcon script on ssd cuda based node

    • Fixed to RTM and darknet launch files

    • catkin_fix

      • catkin & colcon build successfully
    • reverted back run to devel space (for the time being)
  • Switch to Apache 2 license (develop branch) (#1741)
    • Switch to Apache 2

    * Replace BSD-3 license header with Apache 2 and reassign copyright to the Autoware Foundation.

    • Update license on Python files
    • Update copyright years

File truncated at 100 lines see the full file

Launch files

  • launch/vision_ssd_detect.launch
      • use_gpu [default: true]
      • gpu_device_id [default: 0]
      • score_threshold [default: 0.5]
      • network_definition_file [default: $(env HOME)/ssdcaffe/models/VGGNet/VOC0712/SSD_512x512/deploy.prototxt]
      • pretrained_model_file [default: $(env HOME)/ssdcaffe/models/VGGNet/VOC0712/SSD_512x512/VGG_VOC0712_SSD_512x512_iter_120000.caffemodel]
      • camera_id [default: /]
      • image_src [default: /image_raw]

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged vision_ssd_detect at Robotics Stack Exchange

No version for distro noetic showing github. Known supported distros are highlighted in the buttons above.
Package symbol

vision_ssd_detect package from autoware_learn repo

amathutils_lib autoware_build_flags autoware_health_checker emergency_handler gnss lanelet2_extension libvectormap libwaypoint_follower map_file object_map op_planner op_ros_helpers op_simu op_utility ros_observer tvm_utility vector_map vector_map_server vehicle_sim_model autoware_connector ekf_localizer gnss_localizer image_processor imm_ukf_pda_track lidar_apollo_cnn_seg_detect lidar_euclidean_cluster_detect lidar_fake_perception lidar_kf_contour_track lidar_localizer lidar_naive_l_shape_detect lidar_point_pillars lidar_shape_estimation naive_motion_predict ndt_cpu ndt_gpu ndt_tku obj_db pcl_omp_registration pixel_cloud_fusion points_downsampler points_preprocessor pos_db range_vision_fusion road_occupancy_processor roi_object_filter trafficlight_recognizer twist_generator vel_pose_diff_checker vision_beyond_track vision_darknet_detect vision_lane_detect vision_segment_enet_detect vision_ssd_detect astar_search costmap_generator decision_maker dp_planner ff_waypoint_follower freespace_planner lane_planner lattice_planner ll2_global_planner mpc_follower op_global_planner op_local_planner op_simulation_package op_utilities pure_pursuit state_machine_lib twist_filter twist_gate way_planner waypoint_maker waypoint_planner autoware_quickstart_examples autoware_can_msgs autoware_config_msgs autoware_external_msgs autoware_lanelet2_msgs autoware_map_msgs autoware_msgs autoware_system_msgs tablet_socket_msgs vector_map_msgs carla_autoware_bridge gazebo_camera_description gazebo_imu_description lgsvl_simulator_bridge vehicle_gazebo_simulation_interface vehicle_gazebo_simulation_launcher wf_simulator autoware_bag_tools autoware_camera_lidar_calibrator autoware_launcher autoware_launcher_rviz calibration_publisher data_preprocessor graph_tools kitti_box_publisher kitti_launch kitti_player lanelet_aisan_converter log_tools map_tf_generator map_tools marker_downsampler mqtt_socket multi_lidar_calibrator oculus_socket pc2_downsampler rosbag_controller runtime_manager sound_player system_monitor tablet_socket twist2odom udon_socket vehicle_engage_panel vehicle_socket decision_maker_panel detected_objects_visualizer fastvirtualscan gazebo_world_description glviewer integrated_viewer points2image rosinterface autoware_rviz_plugins vehicle_description vehicle_model adi_driver as autoware_driveworks_gmsl_interface autoware_driveworks_interface vlg22c_cam custom_msgs garmin hokuyo javad_navsat_driver kvaser sick_lms5xx memsic_imu microstrain_driver nmea_navsat autoware_pointgrey_drivers sick_ldmrs_description sick_ldmrs_driver sick_ldmrs_laser sick_ldmrs_msgs sick_ldmrs_tools vectacam xsens_driver ymc ds4 ds4_driver ds4_msgs lanelet2 lanelet2_core lanelet2_examples lanelet2_io lanelet2_maps lanelet2_matching lanelet2_projection lanelet2_python lanelet2_routing lanelet2_traffic_rules lanelet2_validation mrt_cmake_modules

ROS Distro
github

Package Summary

Tags No category tags.
Version 1.12.0
License Apache 2
Build type CATKIN
Use RECOMMENDED

Repository Summary

Description autoware.ai perf
Checkout URI https://github.com/is-whale/autoware_learn.git
VCS Type git
VCS Version 1.14
Last Updated 2025-03-14
Dev Status UNKNOWN
Released UNRELEASED
Tags No category tags.
Contributing Help Wanted (-)
Good First Issues (-)
Pull Requests to Review (-)

Package Description

The vision_ssd_detect package

Additional Links

No additional links.

Maintainers

  • amc

Authors

No additional authors.

How to Install Caffe for SSD vision detector

Updated as of 2018-07-04

  1. Complete the pre-requisites.

  2. Clone the SSD Caffe fork in your home directory (CMake files will be looking for it there).

% git clone -b ssd https://github.com/weiliu89/caffe.git ssdcaffe
% cd ssdcaffe
% git checkout 4817bf8b4200b35ada8ed0dc378dceaf38c539e4

  1. Follow the authors’ instructions to complete the pre-requisites for compilation.

  2. Compile Caffe:

make && make distribute

  1. Download pre-trained models as provided at https://github.com/weiliu89/caffe/tree/ssd, or use your own.

Once compiled, run from the terminal, or launch from RunTimeManager:

% roslaunch vision_ssd_detect vision_ssd_detect network_definition_file:=/PATH/TO/deploy.prototxt pretrained_model_file:=/PATH/TO/model.caffemodel

Remember to modify the launch file located inside AUTOWARE_BASEDIR/ros/src/computing/perception/detection/vision_detector/packages/vision_ssd_detect/launch/vision_ssd_detect.launch and point the network and pre-trained models to your paths.

Launch file params

Parameter Type Description Default
use_gpu Bool Whether to use or not GPU acceleration. true
gpu_device_id Integer ID of the GPU to be used. 0
score_threshold Double Value between 0 and 1. Defines the minimum score value to filter detections. 0.5
network_definition_file String Path to the prototxt file . $SSDCAFFEPATH/models/VGGNet/VOC0712/SSD_512x512/deploy.prototxt
pretrained_model_file String Path to the prototxt file . $SSDCAFFEPATH/models/VGGNet/VOC0712/SSD_512x512/VGG_VOC0712_SSD_512x512_iter_120000.caffemodel
camera_id String Camera ID to subscribe, i.e. camera0 /
image_src String Name of the image topic to subscribe to /image_raw

Notes

Remember to modify the deploy.prototxt to use the FULL PATH to the VOC label prototxt file.

Open the file $SSDCAFFEPATH/models/VGGNet/VOC0712/SSD_512x512/deploy.prototxt

Change line 1803 to point to the full path of the labelmap_voc.prototxt file.

CHANGELOG

Changelog for package vision_ssd_detect

1.11.0 (2019-03-21)

  • [fix] Install commands for all the packages (#1861)
    • Initial fixes to detection, sensing, semantics and utils

    • fixing wrong filename on install command

    • Fixes to install commands

    • Hokuyo fix name

    • Fix obj db

    • Obj db include fixes

    • End of final cleaning sweep

    • Incorrect command order in runtime manager

    • Param tempfile not required by runtime_manager

      • Fixes to runtime manager install commands
    • Remove devel directory from catkin, if any

    • Updated launch files for robosense

    • Updated robosense

    • Fix/add missing install (#1977)

    • Added launch install to lidar_kf_contour_track

    • Added install to op_global_planner

    • Added install to way_planner

    • Added install to op_local_planner

    • Added install to op_simulation_package

    • Added install to op_utilities

    • Added install to sync

      • Improved installation script for pointgrey packages
    • Fixed nodelet error for gmsl cameras

    • USe install space in catkin as well

    • add install to catkin

    • Fix install directives (#1990)

    • Fixed installation path

    • Fixed params installation path

    • Fixed cfg installation path

    • Delete cache on colcon_release
  • Fix license notice in corresponding package.xml
  • Fix/remove obsolete range fusion (#1884)
    • Remove obsolete range_fusion
    • Removed range_fusion ui entry
    • Remove obsolete lidar_tracker_libs_fusion
    • Removed fusion dependency from vision_ssd_detect package
  • Initial release of object filter
  • Contributors: Abraham Monrroy, Abraham Monrroy Cano, Servando, amc-nu

1.10.0 (2019-01-17)

  • Fixes for catkin_make
  • [fix] SSD detector, cmake colcon (#1837)
    • Fixes for new colcon script on ssd cuda based node

    • Fixed to RTM and darknet launch files

    • catkin_fix

      • catkin & colcon build successfully
    • reverted back run to devel space (for the time being)
  • Switch to Apache 2 license (develop branch) (#1741)
    • Switch to Apache 2

    * Replace BSD-3 license header with Apache 2 and reassign copyright to the Autoware Foundation.

    • Update license on Python files
    • Update copyright years

File truncated at 100 lines see the full file

Launch files

  • launch/vision_ssd_detect.launch
      • use_gpu [default: true]
      • gpu_device_id [default: 0]
      • score_threshold [default: 0.5]
      • network_definition_file [default: $(env HOME)/ssdcaffe/models/VGGNet/VOC0712/SSD_512x512/deploy.prototxt]
      • pretrained_model_file [default: $(env HOME)/ssdcaffe/models/VGGNet/VOC0712/SSD_512x512/VGG_VOC0712_SSD_512x512_iter_120000.caffemodel]
      • camera_id [default: /]
      • image_src [default: /image_raw]

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged vision_ssd_detect at Robotics Stack Exchange